From: Greg Kroah-Hartman <gregkh@linuxfoundation.org>
To: linux-kernel@vger.kernel.org
Cc: Greg Kroah-Hartman <gregkh@linuxfoundation.org>,
stable@vger.kernel.org, Erwan Le Ray <erwan.leray@foss.st.com>,
Valentin Caron <valentin.caron@foss.st.com>,
Sasha Levin <sashal@kernel.org>
Subject: [PATCH 5.10 129/530] serial: stm32: add "_usart" prefix in functions name
Date: Wed, 12 May 2021 16:43:59 +0200 [thread overview]
Message-ID: <20210512144824.055831420@linuxfoundation.org> (raw)
In-Reply-To: <20210512144819.664462530@linuxfoundation.org>
From: Erwan Le Ray <erwan.leray@foss.st.com>
[ Upstream commit 56f9a76c27b51bc8e9bb938734e3de03819569ae ]
Adds the prefix "_usart" in the name of stm32 usart functions in order to
ease the usage of kernel trace and tools, such as f-trace.
Allows to trace "stm32_usart_*" functions with f-trace. Without this patch,
all the driver functions needs to be added manually in f-trace filter.
Signed-off-by: Erwan Le Ray <erwan.leray@foss.st.com>
Signed-off-by: Valentin Caron <valentin.caron@foss.st.com>
Link: https://lore.kernel.org/r/20210106162203.28854-4-erwan.leray@foss.st.com
Signed-off-by: Greg Kroah-Hartman <gregkh@linuxfoundation.org>
Signed-off-by: Sasha Levin <sashal@kernel.org>
---
drivers/tty/serial/stm32-usart.c | 348 ++++++++++++++++---------------
1 file changed, 177 insertions(+), 171 deletions(-)
diff --git a/drivers/tty/serial/stm32-usart.c b/drivers/tty/serial/stm32-usart.c
index a0ef86d71317..717a97759928 100644
--- a/drivers/tty/serial/stm32-usart.c
+++ b/drivers/tty/serial/stm32-usart.c
@@ -34,15 +34,15 @@
#include "serial_mctrl_gpio.h"
#include "stm32-usart.h"
-static void stm32_stop_tx(struct uart_port *port);
-static void stm32_transmit_chars(struct uart_port *port);
+static void stm32_usart_stop_tx(struct uart_port *port);
+static void stm32_usart_transmit_chars(struct uart_port *port);
static inline struct stm32_port *to_stm32_port(struct uart_port *port)
{
return container_of(port, struct stm32_port, port);
}
-static void stm32_set_bits(struct uart_port *port, u32 reg, u32 bits)
+static void stm32_usart_set_bits(struct uart_port *port, u32 reg, u32 bits)
{
u32 val;
@@ -51,7 +51,7 @@ static void stm32_set_bits(struct uart_port *port, u32 reg, u32 bits)
writel_relaxed(val, port->membase + reg);
}
-static void stm32_clr_bits(struct uart_port *port, u32 reg, u32 bits)
+static void stm32_usart_clr_bits(struct uart_port *port, u32 reg, u32 bits)
{
u32 val;
@@ -60,8 +60,8 @@ static void stm32_clr_bits(struct uart_port *port, u32 reg, u32 bits)
writel_relaxed(val, port->membase + reg);
}
-static void stm32_config_reg_rs485(u32 *cr1, u32 *cr3, u32 delay_ADE,
- u32 delay_DDE, u32 baud)
+static void stm32_usart_config_reg_rs485(u32 *cr1, u32 *cr3, u32 delay_ADE,
+ u32 delay_DDE, u32 baud)
{
u32 rs485_deat_dedt;
u32 rs485_deat_dedt_max = (USART_CR1_DEAT_MASK >> USART_CR1_DEAT_SHIFT);
@@ -95,8 +95,8 @@ static void stm32_config_reg_rs485(u32 *cr1, u32 *cr3, u32 delay_ADE,
*cr1 |= rs485_deat_dedt;
}
-static int stm32_config_rs485(struct uart_port *port,
- struct serial_rs485 *rs485conf)
+static int stm32_usart_config_rs485(struct uart_port *port,
+ struct serial_rs485 *rs485conf)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -104,7 +104,7 @@ static int stm32_config_rs485(struct uart_port *port,
u32 usartdiv, baud, cr1, cr3;
bool over8;
- stm32_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
port->rs485 = *rs485conf;
@@ -122,9 +122,10 @@ static int stm32_config_rs485(struct uart_port *port,
<< USART_BRR_04_R_SHIFT;
baud = DIV_ROUND_CLOSEST(port->uartclk, usartdiv);
- stm32_config_reg_rs485(&cr1, &cr3,
- rs485conf->delay_rts_before_send,
- rs485conf->delay_rts_after_send, baud);
+ stm32_usart_config_reg_rs485(&cr1, &cr3,
+ rs485conf->delay_rts_before_send,
+ rs485conf->delay_rts_after_send,
+ baud);
if (rs485conf->flags & SER_RS485_RTS_ON_SEND) {
cr3 &= ~USART_CR3_DEP;
@@ -137,18 +138,19 @@ static int stm32_config_rs485(struct uart_port *port,
writel_relaxed(cr3, port->membase + ofs->cr3);
writel_relaxed(cr1, port->membase + ofs->cr1);
} else {
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DEM | USART_CR3_DEP);
- stm32_clr_bits(port, ofs->cr1,
- USART_CR1_DEDT_MASK | USART_CR1_DEAT_MASK);
+ stm32_usart_clr_bits(port, ofs->cr3,
+ USART_CR3_DEM | USART_CR3_DEP);
+ stm32_usart_clr_bits(port, ofs->cr1,
+ USART_CR1_DEDT_MASK | USART_CR1_DEAT_MASK);
}
- stm32_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
return 0;
}
-static int stm32_init_rs485(struct uart_port *port,
- struct platform_device *pdev)
+static int stm32_usart_init_rs485(struct uart_port *port,
+ struct platform_device *pdev)
{
struct serial_rs485 *rs485conf = &port->rs485;
@@ -162,8 +164,8 @@ static int stm32_init_rs485(struct uart_port *port,
return uart_get_rs485_mode(port);
}
-static int stm32_pending_rx(struct uart_port *port, u32 *sr, int *last_res,
- bool threaded)
+static int stm32_usart_pending_rx(struct uart_port *port, u32 *sr,
+ int *last_res, bool threaded)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -186,8 +188,8 @@ static int stm32_pending_rx(struct uart_port *port, u32 *sr, int *last_res,
return 0;
}
-static unsigned long stm32_get_char(struct uart_port *port, u32 *sr,
- int *last_res)
+static unsigned long stm32_usart_get_char(struct uart_port *port, u32 *sr,
+ int *last_res)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -206,7 +208,7 @@ static unsigned long stm32_get_char(struct uart_port *port, u32 *sr,
return c;
}
-static void stm32_receive_chars(struct uart_port *port, bool threaded)
+static void stm32_usart_receive_chars(struct uart_port *port, bool threaded)
{
struct tty_port *tport = &port->state->port;
struct stm32_port *stm32_port = to_stm32_port(port);
@@ -218,7 +220,8 @@ static void stm32_receive_chars(struct uart_port *port, bool threaded)
if (irqd_is_wakeup_set(irq_get_irq_data(port->irq)))
pm_wakeup_event(tport->tty->dev, 0);
- while (stm32_pending_rx(port, &sr, &stm32_port->last_res, threaded)) {
+ while (stm32_usart_pending_rx(port, &sr, &stm32_port->last_res,
+ threaded)) {
sr |= USART_SR_DUMMY_RX;
flag = TTY_NORMAL;
@@ -237,7 +240,7 @@ static void stm32_receive_chars(struct uart_port *port, bool threaded)
writel_relaxed(sr & USART_SR_ERR_MASK,
port->membase + ofs->icr);
- c = stm32_get_char(port, &sr, &stm32_port->last_res);
+ c = stm32_usart_get_char(port, &sr, &stm32_port->last_res);
port->icount.rx++;
if (sr & USART_SR_ERR_MASK) {
if (sr & USART_SR_ORE) {
@@ -277,20 +280,20 @@ static void stm32_receive_chars(struct uart_port *port, bool threaded)
spin_lock(&port->lock);
}
-static void stm32_tx_dma_complete(void *arg)
+static void stm32_usart_tx_dma_complete(void *arg)
{
struct uart_port *port = arg;
struct stm32_port *stm32port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32port->info->ofs;
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
stm32port->tx_dma_busy = false;
/* Let's see if we have pending data to send */
- stm32_transmit_chars(port);
+ stm32_usart_transmit_chars(port);
}
-static void stm32_tx_interrupt_enable(struct uart_port *port)
+static void stm32_usart_tx_interrupt_enable(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -300,30 +303,30 @@ static void stm32_tx_interrupt_enable(struct uart_port *port)
* or TX empty irq when FIFO is disabled
*/
if (stm32_port->fifoen)
- stm32_set_bits(port, ofs->cr3, USART_CR3_TXFTIE);
+ stm32_usart_set_bits(port, ofs->cr3, USART_CR3_TXFTIE);
else
- stm32_set_bits(port, ofs->cr1, USART_CR1_TXEIE);
+ stm32_usart_set_bits(port, ofs->cr1, USART_CR1_TXEIE);
}
-static void stm32_tx_interrupt_disable(struct uart_port *port)
+static void stm32_usart_tx_interrupt_disable(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
if (stm32_port->fifoen)
- stm32_clr_bits(port, ofs->cr3, USART_CR3_TXFTIE);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_TXFTIE);
else
- stm32_clr_bits(port, ofs->cr1, USART_CR1_TXEIE);
+ stm32_usart_clr_bits(port, ofs->cr1, USART_CR1_TXEIE);
}
-static void stm32_transmit_chars_pio(struct uart_port *port)
+static void stm32_usart_transmit_chars_pio(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
struct circ_buf *xmit = &port->state->xmit;
if (stm32_port->tx_dma_busy) {
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
stm32_port->tx_dma_busy = false;
}
@@ -338,12 +341,12 @@ static void stm32_transmit_chars_pio(struct uart_port *port)
/* rely on TXE irq (mask or unmask) for sending remaining data */
if (uart_circ_empty(xmit))
- stm32_tx_interrupt_disable(port);
+ stm32_usart_tx_interrupt_disable(port);
else
- stm32_tx_interrupt_enable(port);
+ stm32_usart_tx_interrupt_enable(port);
}
-static void stm32_transmit_chars_dma(struct uart_port *port)
+static void stm32_usart_transmit_chars_dma(struct uart_port *port)
{
struct stm32_port *stm32port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32port->info->ofs;
@@ -385,7 +388,7 @@ static void stm32_transmit_chars_dma(struct uart_port *port)
if (!desc)
goto fallback_err;
- desc->callback = stm32_tx_dma_complete;
+ desc->callback = stm32_usart_tx_dma_complete;
desc->callback_param = port;
/* Push current DMA TX transaction in the pending queue */
@@ -398,7 +401,7 @@ static void stm32_transmit_chars_dma(struct uart_port *port)
/* Issue pending DMA TX requests */
dma_async_issue_pending(stm32port->tx_ch);
- stm32_set_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_set_bits(port, ofs->cr3, USART_CR3_DMAT);
xmit->tail = (xmit->tail + count) & (UART_XMIT_SIZE - 1);
port->icount.tx += count;
@@ -406,10 +409,10 @@ static void stm32_transmit_chars_dma(struct uart_port *port)
fallback_err:
for (i = count; i > 0; i--)
- stm32_transmit_chars_pio(port);
+ stm32_usart_transmit_chars_pio(port);
}
-static void stm32_transmit_chars(struct uart_port *port)
+static void stm32_usart_transmit_chars(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -417,38 +420,38 @@ static void stm32_transmit_chars(struct uart_port *port)
if (port->x_char) {
if (stm32_port->tx_dma_busy)
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
writel_relaxed(port->x_char, port->membase + ofs->tdr);
port->x_char = 0;
port->icount.tx++;
if (stm32_port->tx_dma_busy)
- stm32_set_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_set_bits(port, ofs->cr3, USART_CR3_DMAT);
return;
}
if (uart_circ_empty(xmit) || uart_tx_stopped(port)) {
- stm32_tx_interrupt_disable(port);
+ stm32_usart_tx_interrupt_disable(port);
return;
}
if (ofs->icr == UNDEF_REG)
- stm32_clr_bits(port, ofs->isr, USART_SR_TC);
+ stm32_usart_clr_bits(port, ofs->isr, USART_SR_TC);
else
writel_relaxed(USART_ICR_TCCF, port->membase + ofs->icr);
if (stm32_port->tx_ch)
- stm32_transmit_chars_dma(port);
+ stm32_usart_transmit_chars_dma(port);
else
- stm32_transmit_chars_pio(port);
+ stm32_usart_transmit_chars_pio(port);
if (uart_circ_chars_pending(xmit) < WAKEUP_CHARS)
uart_write_wakeup(port);
if (uart_circ_empty(xmit))
- stm32_tx_interrupt_disable(port);
+ stm32_usart_tx_interrupt_disable(port);
}
-static irqreturn_t stm32_interrupt(int irq, void *ptr)
+static irqreturn_t stm32_usart_interrupt(int irq, void *ptr)
{
struct uart_port *port = ptr;
struct stm32_port *stm32_port = to_stm32_port(port);
@@ -468,10 +471,10 @@ static irqreturn_t stm32_interrupt(int irq, void *ptr)
port->membase + ofs->icr);
if ((sr & USART_SR_RXNE) && !(stm32_port->rx_ch))
- stm32_receive_chars(port, false);
+ stm32_usart_receive_chars(port, false);
if ((sr & USART_SR_TXE) && !(stm32_port->tx_ch))
- stm32_transmit_chars(port);
+ stm32_usart_transmit_chars(port);
spin_unlock(&port->lock);
@@ -481,7 +484,7 @@ static irqreturn_t stm32_interrupt(int irq, void *ptr)
return IRQ_HANDLED;
}
-static irqreturn_t stm32_threaded_interrupt(int irq, void *ptr)
+static irqreturn_t stm32_usart_threaded_interrupt(int irq, void *ptr)
{
struct uart_port *port = ptr;
struct stm32_port *stm32_port = to_stm32_port(port);
@@ -489,14 +492,14 @@ static irqreturn_t stm32_threaded_interrupt(int irq, void *ptr)
spin_lock(&port->lock);
if (stm32_port->rx_ch)
- stm32_receive_chars(port, true);
+ stm32_usart_receive_chars(port, true);
spin_unlock(&port->lock);
return IRQ_HANDLED;
}
-static unsigned int stm32_tx_empty(struct uart_port *port)
+static unsigned int stm32_usart_tx_empty(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -504,20 +507,20 @@ static unsigned int stm32_tx_empty(struct uart_port *port)
return readl_relaxed(port->membase + ofs->isr) & USART_SR_TXE;
}
-static void stm32_set_mctrl(struct uart_port *port, unsigned int mctrl)
+static void stm32_usart_set_mctrl(struct uart_port *port, unsigned int mctrl)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
if ((mctrl & TIOCM_RTS) && (port->status & UPSTAT_AUTORTS))
- stm32_set_bits(port, ofs->cr3, USART_CR3_RTSE);
+ stm32_usart_set_bits(port, ofs->cr3, USART_CR3_RTSE);
else
- stm32_clr_bits(port, ofs->cr3, USART_CR3_RTSE);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_RTSE);
mctrl_gpio_set(stm32_port->gpios, mctrl);
}
-static unsigned int stm32_get_mctrl(struct uart_port *port)
+static unsigned int stm32_usart_get_mctrl(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
unsigned int ret;
@@ -528,23 +531,23 @@ static unsigned int stm32_get_mctrl(struct uart_port *port)
return mctrl_gpio_get(stm32_port->gpios, &ret);
}
-static void stm32_enable_ms(struct uart_port *port)
+static void stm32_usart_enable_ms(struct uart_port *port)
{
mctrl_gpio_enable_ms(to_stm32_port(port)->gpios);
}
-static void stm32_disable_ms(struct uart_port *port)
+static void stm32_usart_disable_ms(struct uart_port *port)
{
mctrl_gpio_disable_ms(to_stm32_port(port)->gpios);
}
/* Transmit stop */
-static void stm32_stop_tx(struct uart_port *port)
+static void stm32_usart_stop_tx(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct serial_rs485 *rs485conf = &port->rs485;
- stm32_tx_interrupt_disable(port);
+ stm32_usart_tx_interrupt_disable(port);
if (rs485conf->flags & SER_RS485_ENABLED) {
if (rs485conf->flags & SER_RS485_RTS_ON_SEND) {
@@ -558,7 +561,7 @@ static void stm32_stop_tx(struct uart_port *port)
}
/* There are probably characters waiting to be transmitted. */
-static void stm32_start_tx(struct uart_port *port)
+static void stm32_usart_start_tx(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct serial_rs485 *rs485conf = &port->rs485;
@@ -577,56 +580,56 @@ static void stm32_start_tx(struct uart_port *port)
}
}
- stm32_transmit_chars(port);
+ stm32_usart_transmit_chars(port);
}
/* Throttle the remote when input buffer is about to overflow. */
-static void stm32_throttle(struct uart_port *port)
+static void stm32_usart_throttle(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
unsigned long flags;
spin_lock_irqsave(&port->lock, flags);
- stm32_clr_bits(port, ofs->cr1, stm32_port->cr1_irq);
+ stm32_usart_clr_bits(port, ofs->cr1, stm32_port->cr1_irq);
if (stm32_port->cr3_irq)
- stm32_clr_bits(port, ofs->cr3, stm32_port->cr3_irq);
+ stm32_usart_clr_bits(port, ofs->cr3, stm32_port->cr3_irq);
spin_unlock_irqrestore(&port->lock, flags);
}
/* Unthrottle the remote, the input buffer can now accept data. */
-static void stm32_unthrottle(struct uart_port *port)
+static void stm32_usart_unthrottle(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
unsigned long flags;
spin_lock_irqsave(&port->lock, flags);
- stm32_set_bits(port, ofs->cr1, stm32_port->cr1_irq);
+ stm32_usart_set_bits(port, ofs->cr1, stm32_port->cr1_irq);
if (stm32_port->cr3_irq)
- stm32_set_bits(port, ofs->cr3, stm32_port->cr3_irq);
+ stm32_usart_set_bits(port, ofs->cr3, stm32_port->cr3_irq);
spin_unlock_irqrestore(&port->lock, flags);
}
/* Receive stop */
-static void stm32_stop_rx(struct uart_port *port)
+static void stm32_usart_stop_rx(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
- stm32_clr_bits(port, ofs->cr1, stm32_port->cr1_irq);
+ stm32_usart_clr_bits(port, ofs->cr1, stm32_port->cr1_irq);
if (stm32_port->cr3_irq)
- stm32_clr_bits(port, ofs->cr3, stm32_port->cr3_irq);
+ stm32_usart_clr_bits(port, ofs->cr3, stm32_port->cr3_irq);
}
/* Handle breaks - ignored by us */
-static void stm32_break_ctl(struct uart_port *port, int break_state)
+static void stm32_usart_break_ctl(struct uart_port *port, int break_state)
{
}
-static int stm32_startup(struct uart_port *port)
+static int stm32_usart_startup(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -634,15 +637,15 @@ static int stm32_startup(struct uart_port *port)
u32 val;
int ret;
- ret = request_threaded_irq(port->irq, stm32_interrupt,
- stm32_threaded_interrupt,
+ ret = request_threaded_irq(port->irq, stm32_usart_interrupt,
+ stm32_usart_threaded_interrupt,
IRQF_NO_SUSPEND, name, port);
if (ret)
return ret;
/* RX FIFO Flush */
if (ofs->rqr != UNDEF_REG)
- stm32_set_bits(port, ofs->rqr, USART_RQR_RXFRQ);
+ stm32_usart_set_bits(port, ofs->rqr, USART_RQR_RXFRQ);
/* Tx and RX FIFO configuration */
if (stm32_port->fifoen) {
@@ -657,12 +660,12 @@ static int stm32_startup(struct uart_port *port)
val = stm32_port->cr1_irq | USART_CR1_RE;
if (stm32_port->fifoen)
val |= USART_CR1_FIFOEN;
- stm32_set_bits(port, ofs->cr1, val);
+ stm32_usart_set_bits(port, ofs->cr1, val);
return 0;
}
-static void stm32_shutdown(struct uart_port *port)
+static void stm32_usart_shutdown(struct uart_port *port)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -671,7 +674,7 @@ static void stm32_shutdown(struct uart_port *port)
int ret;
/* Disable modem control interrupts */
- stm32_disable_ms(port);
+ stm32_usart_disable_ms(port);
val = USART_CR1_TXEIE | USART_CR1_TE;
val |= stm32_port->cr1_irq | USART_CR1_RE;
@@ -686,12 +689,12 @@ static void stm32_shutdown(struct uart_port *port)
if (ret)
dev_err(port->dev, "transmission complete not set\n");
- stm32_clr_bits(port, ofs->cr1, val);
+ stm32_usart_clr_bits(port, ofs->cr1, val);
free_irq(port->irq, port);
}
-static unsigned int stm32_get_databits(struct ktermios *termios)
+static unsigned int stm32_usart_get_databits(struct ktermios *termios)
{
unsigned int bits;
@@ -721,8 +724,9 @@ static unsigned int stm32_get_databits(struct ktermios *termios)
return bits;
}
-static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
- struct ktermios *old)
+static void stm32_usart_set_termios(struct uart_port *port,
+ struct ktermios *termios,
+ struct ktermios *old)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -746,8 +750,8 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
/* flush RX & TX FIFO */
if (ofs->rqr != UNDEF_REG)
- stm32_set_bits(port, ofs->rqr,
- USART_RQR_TXFRQ | USART_RQR_RXFRQ);
+ stm32_usart_set_bits(port, ofs->rqr,
+ USART_RQR_TXFRQ | USART_RQR_RXFRQ);
cr1 = USART_CR1_TE | USART_CR1_RE;
if (stm32_port->fifoen)
@@ -760,7 +764,7 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
if (cflag & CSTOPB)
cr2 |= USART_CR2_STOP_2B;
- bits = stm32_get_databits(termios);
+ bits = stm32_usart_get_databits(termios);
stm32_port->rdr_mask = (BIT(bits) - 1);
if (cflag & PARENB) {
@@ -813,9 +817,9 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
/* Handle modem control interrupts */
if (UART_ENABLE_MS(port, termios->c_cflag))
- stm32_enable_ms(port);
+ stm32_usart_enable_ms(port);
else
- stm32_disable_ms(port);
+ stm32_usart_disable_ms(port);
usartdiv = DIV_ROUND_CLOSEST(port->uartclk, baud);
@@ -828,11 +832,11 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
if (usartdiv < 16) {
oversampling = 8;
cr1 |= USART_CR1_OVER8;
- stm32_set_bits(port, ofs->cr1, USART_CR1_OVER8);
+ stm32_usart_set_bits(port, ofs->cr1, USART_CR1_OVER8);
} else {
oversampling = 16;
cr1 &= ~USART_CR1_OVER8;
- stm32_clr_bits(port, ofs->cr1, USART_CR1_OVER8);
+ stm32_usart_clr_bits(port, ofs->cr1, USART_CR1_OVER8);
}
mantissa = (usartdiv / oversampling) << USART_BRR_DIV_M_SHIFT;
@@ -869,9 +873,10 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
cr3 |= USART_CR3_DMAR;
if (rs485conf->flags & SER_RS485_ENABLED) {
- stm32_config_reg_rs485(&cr1, &cr3,
- rs485conf->delay_rts_before_send,
- rs485conf->delay_rts_after_send, baud);
+ stm32_usart_config_reg_rs485(&cr1, &cr3,
+ rs485conf->delay_rts_before_send,
+ rs485conf->delay_rts_after_send,
+ baud);
if (rs485conf->flags & SER_RS485_RTS_ON_SEND) {
cr3 &= ~USART_CR3_DEP;
rs485conf->flags &= ~SER_RS485_RTS_AFTER_SEND;
@@ -889,39 +894,39 @@ static void stm32_set_termios(struct uart_port *port, struct ktermios *termios,
writel_relaxed(cr2, port->membase + ofs->cr2);
writel_relaxed(cr1, port->membase + ofs->cr1);
- stm32_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
spin_unlock_irqrestore(&port->lock, flags);
}
-static const char *stm32_type(struct uart_port *port)
+static const char *stm32_usart_type(struct uart_port *port)
{
return (port->type == PORT_STM32) ? DRIVER_NAME : NULL;
}
-static void stm32_release_port(struct uart_port *port)
+static void stm32_usart_release_port(struct uart_port *port)
{
}
-static int stm32_request_port(struct uart_port *port)
+static int stm32_usart_request_port(struct uart_port *port)
{
return 0;
}
-static void stm32_config_port(struct uart_port *port, int flags)
+static void stm32_usart_config_port(struct uart_port *port, int flags)
{
if (flags & UART_CONFIG_TYPE)
port->type = PORT_STM32;
}
static int
-stm32_verify_port(struct uart_port *port, struct serial_struct *ser)
+stm32_usart_verify_port(struct uart_port *port, struct serial_struct *ser)
{
/* No user changeable parameters */
return -EINVAL;
}
-static void stm32_pm(struct uart_port *port, unsigned int state,
- unsigned int oldstate)
+static void stm32_usart_pm(struct uart_port *port, unsigned int state,
+ unsigned int oldstate)
{
struct stm32_port *stm32port = container_of(port,
struct stm32_port, port);
@@ -935,7 +940,7 @@ static void stm32_pm(struct uart_port *port, unsigned int state,
break;
case UART_PM_STATE_OFF:
spin_lock_irqsave(&port->lock, flags);
- stm32_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
spin_unlock_irqrestore(&port->lock, flags);
pm_runtime_put_sync(port->dev);
break;
@@ -943,29 +948,29 @@ static void stm32_pm(struct uart_port *port, unsigned int state,
}
static const struct uart_ops stm32_uart_ops = {
- .tx_empty = stm32_tx_empty,
- .set_mctrl = stm32_set_mctrl,
- .get_mctrl = stm32_get_mctrl,
- .stop_tx = stm32_stop_tx,
- .start_tx = stm32_start_tx,
- .throttle = stm32_throttle,
- .unthrottle = stm32_unthrottle,
- .stop_rx = stm32_stop_rx,
- .enable_ms = stm32_enable_ms,
- .break_ctl = stm32_break_ctl,
- .startup = stm32_startup,
- .shutdown = stm32_shutdown,
- .set_termios = stm32_set_termios,
- .pm = stm32_pm,
- .type = stm32_type,
- .release_port = stm32_release_port,
- .request_port = stm32_request_port,
- .config_port = stm32_config_port,
- .verify_port = stm32_verify_port,
+ .tx_empty = stm32_usart_tx_empty,
+ .set_mctrl = stm32_usart_set_mctrl,
+ .get_mctrl = stm32_usart_get_mctrl,
+ .stop_tx = stm32_usart_stop_tx,
+ .start_tx = stm32_usart_start_tx,
+ .throttle = stm32_usart_throttle,
+ .unthrottle = stm32_usart_unthrottle,
+ .stop_rx = stm32_usart_stop_rx,
+ .enable_ms = stm32_usart_enable_ms,
+ .break_ctl = stm32_usart_break_ctl,
+ .startup = stm32_usart_startup,
+ .shutdown = stm32_usart_shutdown,
+ .set_termios = stm32_usart_set_termios,
+ .pm = stm32_usart_pm,
+ .type = stm32_usart_type,
+ .release_port = stm32_usart_release_port,
+ .request_port = stm32_usart_request_port,
+ .config_port = stm32_usart_config_port,
+ .verify_port = stm32_usart_verify_port,
};
-static int stm32_init_port(struct stm32_port *stm32port,
- struct platform_device *pdev)
+static int stm32_usart_init_port(struct stm32_port *stm32port,
+ struct platform_device *pdev)
{
struct uart_port *port = &stm32port->port;
struct resource *res;
@@ -982,9 +987,9 @@ static int stm32_init_port(struct stm32_port *stm32port,
port->fifosize = stm32port->info->cfg.fifosize;
port->has_sysrq = IS_ENABLED(CONFIG_SERIAL_STM32_CONSOLE);
port->irq = ret;
- port->rs485_config = stm32_config_rs485;
+ port->rs485_config = stm32_usart_config_rs485;
- ret = stm32_init_rs485(port, pdev);
+ ret = stm32_usart_init_rs485(port, pdev);
if (ret)
return ret;
@@ -1043,7 +1048,7 @@ err_clk:
return ret;
}
-static struct stm32_port *stm32_of_get_stm32_port(struct platform_device *pdev)
+static struct stm32_port *stm32_usart_of_get_port(struct platform_device *pdev)
{
struct device_node *np = pdev->dev.of_node;
int id;
@@ -1081,8 +1086,8 @@ static const struct of_device_id stm32_match[] = {
MODULE_DEVICE_TABLE(of, stm32_match);
#endif
-static int stm32_of_dma_rx_probe(struct stm32_port *stm32port,
- struct platform_device *pdev)
+static int stm32_usart_of_dma_rx_probe(struct stm32_port *stm32port,
+ struct platform_device *pdev)
{
struct stm32_usart_offsets *ofs = &stm32port->info->ofs;
struct uart_port *port = &stm32port->port;
@@ -1156,8 +1161,8 @@ alloc_err:
return ret;
}
-static int stm32_of_dma_tx_probe(struct stm32_port *stm32port,
- struct platform_device *pdev)
+static int stm32_usart_of_dma_tx_probe(struct stm32_port *stm32port,
+ struct platform_device *pdev)
{
struct stm32_usart_offsets *ofs = &stm32port->info->ofs;
struct uart_port *port = &stm32port->port;
@@ -1207,13 +1212,13 @@ alloc_err:
return ret;
}
-static int stm32_serial_probe(struct platform_device *pdev)
+static int stm32_usart_serial_probe(struct platform_device *pdev)
{
const struct of_device_id *match;
struct stm32_port *stm32port;
int ret;
- stm32port = stm32_of_get_stm32_port(pdev);
+ stm32port = stm32_usart_of_get_port(pdev);
if (!stm32port)
return -ENODEV;
@@ -1223,7 +1228,7 @@ static int stm32_serial_probe(struct platform_device *pdev)
else
return -EINVAL;
- ret = stm32_init_port(stm32port, pdev);
+ ret = stm32_usart_init_port(stm32port, pdev);
if (ret)
return ret;
@@ -1244,11 +1249,11 @@ static int stm32_serial_probe(struct platform_device *pdev)
if (ret)
goto err_wirq;
- ret = stm32_of_dma_rx_probe(stm32port, pdev);
+ ret = stm32_usart_of_dma_rx_probe(stm32port, pdev);
if (ret)
dev_info(&pdev->dev, "interrupt mode used for rx (no dma)\n");
- ret = stm32_of_dma_tx_probe(stm32port, pdev);
+ ret = stm32_usart_of_dma_tx_probe(stm32port, pdev);
if (ret)
dev_info(&pdev->dev, "interrupt mode used for tx (no dma)\n");
@@ -1275,7 +1280,7 @@ err_uninit:
return ret;
}
-static int stm32_serial_remove(struct platform_device *pdev)
+static int stm32_usart_serial_remove(struct platform_device *pdev)
{
struct uart_port *port = platform_get_drvdata(pdev);
struct stm32_port *stm32_port = to_stm32_port(port);
@@ -1284,7 +1289,7 @@ static int stm32_serial_remove(struct platform_device *pdev)
pm_runtime_get_sync(&pdev->dev);
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DMAR);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_DMAR);
if (stm32_port->rx_ch)
dma_release_channel(stm32_port->rx_ch);
@@ -1294,7 +1299,7 @@ static int stm32_serial_remove(struct platform_device *pdev)
RX_BUF_L, stm32_port->rx_buf,
stm32_port->rx_dma_buf);
- stm32_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
+ stm32_usart_clr_bits(port, ofs->cr3, USART_CR3_DMAT);
if (stm32_port->tx_ch)
dma_release_channel(stm32_port->tx_ch);
@@ -1320,7 +1325,7 @@ static int stm32_serial_remove(struct platform_device *pdev)
}
#ifdef CONFIG_SERIAL_STM32_CONSOLE
-static void stm32_console_putchar(struct uart_port *port, int ch)
+static void stm32_usart_console_putchar(struct uart_port *port, int ch)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -1331,8 +1336,8 @@ static void stm32_console_putchar(struct uart_port *port, int ch)
writel_relaxed(ch, port->membase + ofs->tdr);
}
-static void stm32_console_write(struct console *co, const char *s,
- unsigned int cnt)
+static void stm32_usart_console_write(struct console *co, const char *s,
+ unsigned int cnt)
{
struct uart_port *port = &stm32_ports[co->index].port;
struct stm32_port *stm32_port = to_stm32_port(port);
@@ -1356,7 +1361,7 @@ static void stm32_console_write(struct console *co, const char *s,
new_cr1 |= USART_CR1_TE | BIT(cfg->uart_enable_bit);
writel_relaxed(new_cr1, port->membase + ofs->cr1);
- uart_console_write(port, s, cnt, stm32_console_putchar);
+ uart_console_write(port, s, cnt, stm32_usart_console_putchar);
/* Restore interrupt state */
writel_relaxed(old_cr1, port->membase + ofs->cr1);
@@ -1366,7 +1371,7 @@ static void stm32_console_write(struct console *co, const char *s,
local_irq_restore(flags);
}
-static int stm32_console_setup(struct console *co, char *options)
+static int stm32_usart_console_setup(struct console *co, char *options)
{
struct stm32_port *stm32port;
int baud = 9600;
@@ -1397,8 +1402,8 @@ static int stm32_console_setup(struct console *co, char *options)
static struct console stm32_console = {
.name = STM32_SERIAL_NAME,
.device = uart_console_device,
- .write = stm32_console_write,
- .setup = stm32_console_setup,
+ .write = stm32_usart_console_write,
+ .setup = stm32_usart_console_setup,
.flags = CON_PRINTBUFFER,
.index = -1,
.data = &stm32_usart_driver,
@@ -1419,8 +1424,8 @@ static struct uart_driver stm32_usart_driver = {
.cons = STM32_SERIAL_CONSOLE,
};
-static void __maybe_unused stm32_serial_enable_wakeup(struct uart_port *port,
- bool enable)
+static void __maybe_unused stm32_usart_serial_en_wakeup(struct uart_port *port,
+ bool enable)
{
struct stm32_port *stm32_port = to_stm32_port(port);
struct stm32_usart_offsets *ofs = &stm32_port->info->ofs;
@@ -1431,29 +1436,29 @@ static void __maybe_unused stm32_serial_enable_wakeup(struct uart_port *port,
return;
if (enable) {
- stm32_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
- stm32_set_bits(port, ofs->cr1, USART_CR1_UESM);
+ stm32_usart_clr_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_set_bits(port, ofs->cr1, USART_CR1_UESM);
val = readl_relaxed(port->membase + ofs->cr3);
val &= ~USART_CR3_WUS_MASK;
/* Enable Wake up interrupt from low power on start bit */
val |= USART_CR3_WUS_START_BIT | USART_CR3_WUFIE;
writel_relaxed(val, port->membase + ofs->cr3);
- stm32_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
+ stm32_usart_set_bits(port, ofs->cr1, BIT(cfg->uart_enable_bit));
} else {
- stm32_clr_bits(port, ofs->cr1, USART_CR1_UESM);
+ stm32_usart_clr_bits(port, ofs->cr1, USART_CR1_UESM);
}
}
-static int __maybe_unused stm32_serial_suspend(struct device *dev)
+static int __maybe_unused stm32_usart_serial_suspend(struct device *dev)
{
struct uart_port *port = dev_get_drvdata(dev);
uart_suspend_port(&stm32_usart_driver, port);
if (device_may_wakeup(dev))
- stm32_serial_enable_wakeup(port, true);
+ stm32_usart_serial_en_wakeup(port, true);
else
- stm32_serial_enable_wakeup(port, false);
+ stm32_usart_serial_en_wakeup(port, false);
/*
* When "no_console_suspend" is enabled, keep the pinctrl default state
@@ -1471,19 +1476,19 @@ static int __maybe_unused stm32_serial_suspend(struct device *dev)
return 0;
}
-static int __maybe_unused stm32_serial_resume(struct device *dev)
+static int __maybe_unused stm32_usart_serial_resume(struct device *dev)
{
struct uart_port *port = dev_get_drvdata(dev);
pinctrl_pm_select_default_state(dev);
if (device_may_wakeup(dev))
- stm32_serial_enable_wakeup(port, false);
+ stm32_usart_serial_en_wakeup(port, false);
return uart_resume_port(&stm32_usart_driver, port);
}
-static int __maybe_unused stm32_serial_runtime_suspend(struct device *dev)
+static int __maybe_unused stm32_usart_runtime_suspend(struct device *dev)
{
struct uart_port *port = dev_get_drvdata(dev);
struct stm32_port *stm32port = container_of(port,
@@ -1494,7 +1499,7 @@ static int __maybe_unused stm32_serial_runtime_suspend(struct device *dev)
return 0;
}
-static int __maybe_unused stm32_serial_runtime_resume(struct device *dev)
+static int __maybe_unused stm32_usart_runtime_resume(struct device *dev)
{
struct uart_port *port = dev_get_drvdata(dev);
struct stm32_port *stm32port = container_of(port,
@@ -1504,14 +1509,15 @@ static int __maybe_unused stm32_serial_runtime_resume(struct device *dev)
}
static const struct dev_pm_ops stm32_serial_pm_ops = {
- SET_RUNTIME_PM_OPS(stm32_serial_runtime_suspend,
- stm32_serial_runtime_resume, NULL)
- SET_SYSTEM_SLEEP_PM_OPS(stm32_serial_suspend, stm32_serial_resume)
+ SET_RUNTIME_PM_OPS(stm32_usart_runtime_suspend,
+ stm32_usart_runtime_resume, NULL)
+ SET_SYSTEM_SLEEP_PM_OPS(stm32_usart_serial_suspend,
+ stm32_usart_serial_resume)
};
static struct platform_driver stm32_serial_driver = {
- .probe = stm32_serial_probe,
- .remove = stm32_serial_remove,
+ .probe = stm32_usart_serial_probe,
+ .remove = stm32_usart_serial_remove,
.driver = {
.name = DRIVER_NAME,
.pm = &stm32_serial_pm_ops,
@@ -1519,7 +1525,7 @@ static struct platform_driver stm32_serial_driver = {
},
};
-static int __init usart_init(void)
+static int __init stm32_usart_init(void)
{
static char banner[] __initdata = "STM32 USART driver initialized";
int ret;
@@ -1537,14 +1543,14 @@ static int __init usart_init(void)
return ret;
}
-static void __exit usart_exit(void)
+static void __exit stm32_usart_exit(void)
{
platform_driver_unregister(&stm32_serial_driver);
uart_unregister_driver(&stm32_usart_driver);
}
-module_init(usart_init);
-module_exit(usart_exit);
+module_init(stm32_usart_init);
+module_exit(stm32_usart_exit);
MODULE_ALIAS("platform:" DRIVER_NAME);
MODULE_DESCRIPTION("STMicroelectronics STM32 serial port driver");
--
2.30.2
next prev parent reply other threads:[~2021-05-12 15:20 UTC|newest]
Thread overview: 572+ messages / expand[flat|nested] mbox.gz Atom feed top
2021-05-12 14:41 [PATCH 5.10 000/530] 5.10.37-rc1 review Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 001/530] Bluetooth: verify AMP hci_chan before amp_destroy Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 002/530] bluetooth: eliminate the potential race condition when removing the HCI controller Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 003/530] net/nfc: fix use-after-free llcp_sock_bind/connect Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 004/530] io_uring: truncate lengths larger than MAX_RW_COUNT on provide buffers Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 005/530] Revert "USB: cdc-acm: fix rounding error in TIOCSSERIAL" Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 006/530] usb: roles: Call try_module_get() from usb_role_switch_find_by_fwnode() Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 007/530] tty: moxa: fix TIOCSSERIAL jiffies conversions Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 008/530] tty: amiserial: fix TIOCSSERIAL permission check Greg Kroah-Hartman
2021-05-12 14:41 ` [PATCH 5.10 009/530] USB: serial: usb_wwan: fix TIOCSSERIAL jiffies conversions Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 010/530] staging: greybus: uart: " Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 011/530] USB: serial: ti_usb_3410_5052: fix TIOCSSERIAL permission check Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 012/530] staging: fwserial: fix TIOCSSERIAL jiffies conversions Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 013/530] tty: moxa: fix TIOCSSERIAL permission check Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 014/530] staging: fwserial: " Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 015/530] drm: bridge: fix LONTIUM use of mipi_dsi_() functions Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 016/530] usb: typec: tcpm: Address incorrect values of tcpm psy for fixed supply Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 017/530] usb: typec: tcpm: Address incorrect values of tcpm psy for pps supply Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 018/530] usb: typec: tcpm: update power supply once partner accepts Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 019/530] usb: xhci-mtk: remove or operator for setting schedule parameters Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 020/530] usb: xhci-mtk: improve bandwidth scheduling with TT Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 021/530] ASoC: samsung: tm2_wm5110: check of of_parse return value Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 022/530] ASoC: Intel: kbl_da7219_max98927: Fix kabylake_ssp_fixup function Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 023/530] ASoC: tlv320aic32x4: Register clocks before registering component Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 024/530] ASoC: tlv320aic32x4: Increase maximum register in regmap Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 025/530] MIPS: pci-mt7620: fix PLL lock check Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 026/530] MIPS: pci-rt2880: fix slot 0 configuration Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 027/530] FDDI: defxx: Bail out gracefully with unassigned PCI resource for CSR Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 028/530] PCI: Allow VPD access for QLogic ISP2722 Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 029/530] KVM: x86: Defer the MMU unload to the normal path on an global INVPCID Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 030/530] PCI: xgene: Fix cfg resource mapping Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 031/530] PCI: keystone: Let AM65 use the pci_ops defined in pcie-designware-host.c Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 032/530] PM / devfreq: Unlock mutex and free devfreq struct in error path Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 033/530] soc/tegra: regulators: Fix locking up when voltage-spread is out of range Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 034/530] iio: inv_mpu6050: Fully validate gyro and accel scale writes Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 035/530] iio:accel:adis16201: Fix wrong axis assignment that prevents loading Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 036/530] iio:adc:ad7476: Fix remove handling Greg Kroah-Hartman
2021-05-15 19:52 ` Pavel Machek
2021-05-16 5:28 ` Alexandru Ardelean
2021-05-12 14:42 ` [PATCH 5.10 037/530] sc16is7xx: Defer probe if device read fails Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 038/530] phy: cadence: Sierra: Fix PHY power_on sequence Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 039/530] misc: lis3lv02d: Fix false-positive WARN on various HP models Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 040/530] phy: ti: j721e-wiz: Invoke wiz_init() before of_platform_device_create() Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 041/530] misc: vmw_vmci: explicitly initialize vmci_notify_bm_set_msg struct Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 042/530] misc: vmw_vmci: explicitly initialize vmci_datagram payload Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 043/530] selinux: add proper NULL termination to the secclass_map permissions Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 044/530] x86, sched: Treat Intel SNC topology as default, COD as exception Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 045/530] async_xor: increase src_offs when dropping destination page Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 046/530] md/bitmap: wait for external bitmap writes to complete during tear down Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 047/530] md-cluster: fix use-after-free issue when removing rdev Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 048/530] md: split mddev_find Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 049/530] md: factor out a mddev_find_locked helper from mddev_find Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 050/530] md: md_open returns -EBUSY when entering racing area Greg Kroah-Hartman
2021-05-13 7:59 ` Pavel Machek
2021-05-13 9:47 ` Greg Kroah-Hartman
2021-05-13 9:48 ` Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 051/530] md: Fix missing unused status line of /proc/mdstat Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 052/530] MIPS: Reinstate platform `__div64_32 handler Greg Kroah-Hartman
2021-05-13 8:46 ` Sudip Mukherjee
2021-05-13 10:14 ` Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 053/530] mt76: mt7615: use ieee80211_free_txskb() in mt7615_tx_token_put() Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 054/530] ipw2x00: potential buffer overflow in libipw_wx_set_encodeext() Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 055/530] cfg80211: scan: drop entry from hidden_list on overflow Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 056/530] rtw88: Fix array overrun in rtw_get_tx_power_params() Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 057/530] mt76: fix potential DMA mapping leak Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 058/530] FDDI: defxx: Make MMIO the configuration default except for EISA Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 059/530] drm/i915/gvt: Fix virtual display setup for BXT/APL Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 060/530] drm/i915/gvt: Fix vfio_edid issue " Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 061/530] drm/qxl: use ttm bo priorities Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 062/530] drm/panfrost: Clear MMU irqs before handling the fault Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 063/530] drm/panfrost: Dont try to map pages that are already mapped Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 064/530] drm/radeon: fix copy of uninitialized variable back to userspace Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 065/530] drm/dp_mst: Revise broadcast msg lct & lcr Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 066/530] drm/dp_mst: Set CLEAR_PAYLOAD_ID_TABLE as broadcast Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 067/530] drm: bridge/panel: Cleanup connector on bridge detach Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 068/530] drm/amd/display: Reject non-zero src_y and src_x for video planes Greg Kroah-Hartman
2021-05-12 14:42 ` [PATCH 5.10 069/530] drm/amdgpu: fix concurrent VM flushes on Vega/Navi v2 Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 070/530] ALSA: hda/realtek: Re-order ALC882 Acer quirk table entries Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 071/530] ALSA: hda/realtek: Re-order ALC882 Sony " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 072/530] ALSA: hda/realtek: Re-order ALC882 Clevo " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 073/530] ALSA: hda/realtek: Re-order ALC269 HP " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 074/530] ALSA: hda/realtek: Re-order ALC269 Acer " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 075/530] ALSA: hda/realtek: Re-order ALC269 Dell " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 076/530] ALSA: hda/realtek: Re-order ALC269 ASUS " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 077/530] ALSA: hda/realtek: Re-order ALC269 Sony " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 078/530] ALSA: hda/realtek: Re-order ALC269 Lenovo " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 079/530] ALSA: hda/realtek: Re-order remaining ALC269 " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 080/530] ALSA: hda/realtek: Re-order ALC662 " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 081/530] ALSA: hda/realtek: Remove redundant entry for ALC861 Haier/Uniwill devices Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 082/530] ALSA: hda/realtek: ALC285 Thinkpad jack pin quirk is unreachable Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 083/530] ALSA: hda/realtek: Fix speaker amp on HP Envy AiO 32 Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 084/530] KVM: s390: VSIE: correctly handle MVPG when in VSIE Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 085/530] KVM: s390: split kvm_s390_logical_to_effective Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 086/530] KVM: s390: fix guarded storage control register handling Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 087/530] s390: fix detection of vector enhancements facility 1 vs. vector packed decimal facility Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 088/530] KVM: s390: VSIE: fix MVPG handling for prefixing and MSO Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 089/530] KVM: s390: split kvm_s390_real_to_abs Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 090/530] KVM: s390: extend kvm_s390_shadow_fault to return entry pointer Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 091/530] KVM: x86/mmu: Alloc page for PDPTEs when shadowing 32-bit NPT with 64-bit Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 092/530] KVM: x86: Remove emulators broken checks on CR0/CR3/CR4 loads Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 093/530] KVM: nSVM: Set the shadow root level to the TDP level for nested NPT Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 094/530] KVM: SVM: Dont strip the C-bit from CR2 on #PF interception Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 095/530] KVM: SVM: Do not allow SEV/SEV-ES initialization after vCPUs are created Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 096/530] KVM: SVM: Inject #GP on guest MSR_TSC_AUX accesses if RDTSCP unsupported Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 097/530] KVM: nVMX: Defer the MMU reload to the normal path on an EPTP switch Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 098/530] KVM: nVMX: Truncate bits 63:32 of VMCS field on nested check in !64-bit Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 099/530] KVM: nVMX: Truncate base/index GPR value on address calc " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 100/530] KVM: arm/arm64: Fix KVM_VGIC_V3_ADDR_TYPE_REDIST read Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 101/530] KVM: Destroy I/O bus devices on unregister failure _after_ syncing SRCU Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 102/530] KVM: Stop looking for coalesced MMIO zones if the bus is destroyed Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 103/530] KVM: arm64: Fully zero the vcpu state on reset Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 104/530] KVM: arm64: Fix KVM_VGIC_V3_ADDR_TYPE_REDIST_REGION read Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 105/530] Revert "drivers/net/wan/hdlc_fr: Fix a double free in pvc_xmit" Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 106/530] Revert "i3c master: fix missing destroy_workqueue() on error in i3c_master_register" Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 107/530] ovl: fix missing revert_creds() on error path Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 108/530] Revert "drm/qxl: do not run release if qxl failed to init" Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 109/530] usb: gadget: pch_udc: Revert d3cb25a12138 completely Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 110/530] Revert "tools/power turbostat: adjust for temperature offset" Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 111/530] firmware: xilinx: Fix dereferencing freed memory Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 112/530] firmware: xilinx: Add a blank line after function declaration Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 113/530] firmware: xilinx: Remove zynqmp_pm_get_eemi_ops() in IS_REACHABLE(CONFIG_ZYNQMP_FIRMWARE) Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 114/530] fpga: fpga-mgr: xilinx-spi: fix error messages on -EPROBE_DEFER Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 115/530] crypto: sun8i-ss - fix result memory leak on error path Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 116/530] memory: gpmc: fix out of bounds read and dereference on gpmc_cs[] Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 117/530] ARM: dts: exynos: correct fuel gauge interrupt trigger level on GT-I9100 Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 118/530] ARM: dts: exynos: correct fuel gauge interrupt trigger level on Midas family Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 119/530] ARM: dts: exynos: correct MUIC " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 120/530] ARM: dts: exynos: correct PMIC " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 121/530] ARM: dts: exynos: correct PMIC interrupt trigger level on Odroid X/U3 family Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 122/530] ARM: dts: exynos: correct PMIC interrupt trigger level on SMDK5250 Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 123/530] ARM: dts: exynos: correct PMIC interrupt trigger level on Snow Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 124/530] ARM: dts: s5pv210: correct fuel gauge interrupt trigger level on Fascinate family Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 125/530] ARM: dts: renesas: Add mmc aliases into R-Car Gen2 board dts files Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 126/530] arm64: dts: renesas: Add mmc aliases into " Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 127/530] x86/platform/uv: Set section block size for hubless architectures Greg Kroah-Hartman
2021-05-12 14:43 ` [PATCH 5.10 128/530] serial: stm32: fix code cleaning warnings and checks Greg Kroah-Hartman
2021-05-12 14:43 ` Greg Kroah-Hartman [this message]
2021-05-12 14:44 ` [PATCH 5.10 130/530] serial: stm32: fix probe and remove order for dma Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 131/530] serial: stm32: Use of_device_get_match_data() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 132/530] serial: stm32: fix startup by enabling usart for reception Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 133/530] serial: stm32: fix incorrect characters on console Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 134/530] serial: stm32: fix TX and RX FIFO thresholds Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 135/530] serial: stm32: fix a deadlock condition with wakeup event Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 136/530] serial: stm32: fix wake-up flag handling Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 137/530] serial: stm32: fix a deadlock in set_termios Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 138/530] serial: stm32: fix tx dma completion, release channel Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 139/530] serial: stm32: call stm32_transmit_chars locked Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 140/530] serial: stm32: fix FIFO flush in startup and set_termios Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 141/530] serial: stm32: add FIFO flush when port is closed Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 142/530] serial: stm32: fix tx_empty condition Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 143/530] usb: typec: tcpci: Check ROLE_CONTROL while interpreting CC_STATUS Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 144/530] usb: typec: tps6598x: Fix return value check in tps6598x_probe() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 145/530] usb: typec: stusb160x: fix return value check in stusb160x_probe() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 146/530] regmap: set debugfs_name to NULL after it is freed Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 147/530] spi: rockchip: avoid objtool warning Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 148/530] mtd: rawnand: fsmc: Fix error code in fsmc_nand_probe() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 149/530] mtd: rawnand: brcmnand: fix OOB R/W with Hamming ECC Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 150/530] mtd: Handle possible -EPROBE_DEFER from parse_mtd_partitions() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 151/530] mtd: rawnand: qcom: Return actual error code instead of -ENODEV Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 152/530] mtd: dont lock when recursively deleting partitions Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 153/530] mtd: maps: fix error return code of physmap_flash_remove() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 154/530] ARM: dts: stm32: fix usart 2 & 3 pinconf to wake up with flow control Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 155/530] arm64: dts: qcom: sm8250: Fix level triggered PMU interrupt polarity Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 156/530] arm64: dts: qcom: sm8250: Fix timer interrupt to specify EL2 physical timer Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 157/530] arm64: dts: qcom: sdm845: fix number of pins in gpio-ranges Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 158/530] arm64: dts: qcom: sm8150: " Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 159/530] arm64: dts: qcom: sm8250: " Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 160/530] arm64: dts: qcom: db845c: fix correct powerdown pin for WSA881x Greg Kroah-Hartman
2021-05-15 8:18 ` Pavel Machek
2021-05-17 8:46 ` Srinivas Kandagatla
2021-05-25 0:23 ` Linus Walleij
2021-05-12 14:44 ` [PATCH 5.10 161/530] crypto: sun8i-ss - Fix memory leak of object d when dma_iv fails to map Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 162/530] spi: stm32: drop devres version of spi_register_master Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 163/530] regulator: bd9576: Fix return from bd957x_probe() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 164/530] arm64: dts: renesas: r8a77980: Fix vin4-7 endpoint binding Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 165/530] spi: stm32: Fix use-after-free on unbind Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 166/530] x86/microcode: Check for offline CPUs before requesting new microcode Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 167/530] devtmpfs: fix placement of complete() call Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 168/530] usb: gadget: pch_udc: Replace cpu_to_le32() by lower_32_bits() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 169/530] usb: gadget: pch_udc: Check if driver is present before calling ->setup() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 170/530] usb: gadget: pch_udc: Check for DMA mapping error Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 171/530] usb: gadget: pch_udc: Initialize device pointer before use Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 172/530] usb: gadget: pch_udc: Provide a GPIO line used on Intel Minnowboard (v1) Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 173/530] crypto: ccp - fix command queuing to TEE ring buffer Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 174/530] crypto: qat - dont release uninitialized resources Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 175/530] crypto: qat - ADF_STATUS_PF_RUNNING should be set after adf_dev_init Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 176/530] fotg210-udc: Fix DMA on EP0 for length > max packet size Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 177/530] fotg210-udc: Fix EP0 IN requests bigger than two packets Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 178/530] fotg210-udc: Remove a dubious condition leading to fotg210_done Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 179/530] fotg210-udc: Mask GRP2 interrupts we dont handle Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 180/530] fotg210-udc: Dont DMA more than the buffer can take Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 181/530] fotg210-udc: Complete OUT requests on short packets Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 182/530] usb: gadget: s3c: Fix incorrect resources releasing Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 183/530] usb: gadget: s3c: Fix the error handling path in s3c2410_udc_probe() Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 184/530] dt-bindings: serial: stm32: Use type: object instead of false for additionalProperties Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 185/530] mtd: require write permissions for locking and badblock ioctls Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 186/530] arm64: dts: renesas: r8a779a0: Fix PMU interrupt Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 187/530] bus: qcom: Put child node before return Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 188/530] soundwire: bus: Fix device found flag correctly Greg Kroah-Hartman
2021-05-12 14:44 ` [PATCH 5.10 189/530] phy: ti: j721e-wiz: Delete "clk_div_sel" clk provider during cleanup Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 190/530] phy: marvell: ARMADA375_USBCLUSTER_PHY should not default to y, unconditionally Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 191/530] arm64: dts: mediatek: fix reset GPIO level on pumpkin Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 192/530] NFSD: Fix sparse warning in nfs4proc.c Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 193/530] NFSv4.2: fix copy stateid copying for the async copy Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 194/530] crypto: poly1305 - fix poly1305_core_setkey() declaration Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 195/530] crypto: qat - fix error path in adf_isr_resource_alloc() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 196/530] usb: gadget: aspeed: fix dma map failure Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 197/530] USB: gadget: udc: fix wrong pointer passed to IS_ERR() and PTR_ERR() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 198/530] drivers: nvmem: Fix voltage settings for QTI qfprom-efuse Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 199/530] driver core: platform: Declare early_platform_cleanup() prototype Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 200/530] memory: pl353: fix mask of ECC page_size config register Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 201/530] soundwire: stream: fix memory leak in stream config error path Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 202/530] m68k: mvme147,mvme16x: Dont wipe PCC timer config bits Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 203/530] firmware: qcom_scm: Make __qcom_scm_is_call_available() return bool Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 204/530] firmware: qcom_scm: Reduce locking section for __get_convention() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 205/530] firmware: qcom_scm: Workaround lack of "is available" call on SC7180 Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 206/530] iio: adc: Kconfig: make AD9467 depend on ADI_AXI_ADC symbol Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 207/530] mtd: rawnand: gpmi: Fix a double free in gpmi_nand_init Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 208/530] irqchip/gic-v3: Fix OF_BAD_ADDR error handling Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 209/530] staging: comedi: tests: ni_routes_test: Fix compilation error Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 210/530] staging: rtl8192u: Fix potential infinite loop Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 211/530] staging: fwserial: fix TIOCSSERIAL implementation Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 212/530] staging: fwserial: fix TIOCGSERIAL implementation Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 213/530] staging: greybus: uart: fix unprivileged TIOCCSERIAL Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 214/530] soc: qcom: pdr: Fix error return code in pdr_register_listener Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 215/530] PM / devfreq: Use more accurate returned new_freq as resume_freq Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 216/530] clocksource/drivers/timer-ti-dm: Fix posted mode status check order Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 217/530] clocksource/drivers/timer-ti-dm: Add missing set_state_oneshot_stopped Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 218/530] clocksource/drivers/ingenic_ost: Fix return value check in ingenic_ost_probe() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 219/530] spi: Fix use-after-free with devm_spi_alloc_* Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 220/530] spi: fsl: add missing iounmap() on error in of_fsl_spi_probe() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 221/530] soc: qcom: mdt_loader: Validate that p_filesz < p_memsz Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 222/530] soc: qcom: mdt_loader: Detect truncated read of segments Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 223/530] PM: runtime: Replace inline function pm_runtime_callbacks_present() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 224/530] cpuidle: Fix ARM_QCOM_SPM_CPUIDLE configuration Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 225/530] ACPI: CPPC: Replace cppc_attr with kobj_attribute Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 226/530] crypto: allwinner - add missing CRYPTO_ prefix Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 227/530] crypto: sun8i-ss - Fix memory leak of pad Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 228/530] crypto: sa2ul - Fix memory leak of rxd Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 229/530] crypto: qat - Fix a double free in adf_create_ring Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 230/530] cpufreq: armada-37xx: Fix setting TBG parent for load levels Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 231/530] clk: mvebu: armada-37xx-periph: remove .set_parent method for CPU PM clock Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 232/530] cpufreq: armada-37xx: Fix the AVS value for load L1 Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 233/530] clk: mvebu: armada-37xx-periph: Fix switching CPU freq from 250 Mhz to 1 GHz Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 234/530] clk: mvebu: armada-37xx-periph: Fix workaround for switching from L1 to L0 Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 235/530] cpufreq: armada-37xx: Fix driver cleanup when registration failed Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 236/530] cpufreq: armada-37xx: Fix determining base CPU frequency Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 237/530] spi: spi-zynqmp-gqspi: use wait_for_completion_timeout to make zynqmp_qspi_exec_op not interruptible Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 238/530] spi: spi-zynqmp-gqspi: add mutex locking for exec_op Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 239/530] spi: spi-zynqmp-gqspi: transmit dummy circles by using the controllers internal functionality Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 240/530] spi: spi-zynqmp-gqspi: fix incorrect operating mode in zynqmp_qspi_read_op Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 241/530] spi: fsl-lpspi: Fix PM reference leak in lpspi_prepare_xfer_hardware() Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 242/530] usb: gadget: r8a66597: Add missing null check on return from platform_get_resource Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 243/530] USB: cdc-acm: fix unprivileged TIOCCSERIAL Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 244/530] USB: cdc-acm: fix TIOCGSERIAL implementation Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 245/530] tty: actually undefine superseded ASYNC flags Greg Kroah-Hartman
2021-05-12 15:17 ` Johan Hovold
2021-05-14 7:55 ` Greg Kroah-Hartman
2021-05-14 8:10 ` Johan Hovold
2021-05-12 14:45 ` [PATCH 5.10 246/530] tty: fix return value for unsupported ioctls Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 247/530] tty: Remove dead termiox code Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 248/530] tty: fix return value for unsupported termiox ioctls Greg Kroah-Hartman
2021-05-12 14:45 ` [PATCH 5.10 249/530] serial: core: return early on unsupported ioctls Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 250/530] firmware: qcom-scm: Fix QCOM_SCM configuration Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 251/530] node: fix device cleanups in error handling code Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 252/530] crypto: chelsio - Read rxchannel-id from firmware Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 253/530] usbip: vudc: fix missing unlock on error in usbip_sockfd_store() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 254/530] m68k: Add missing mmap_read_lock() to sys_cacheflush() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 255/530] spi: spi-zynqmp-gqspi: Fix missing unlock on error in zynqmp_qspi_exec_op() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 256/530] memory: renesas-rpc-if: fix possible NULL pointer dereference of resource Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 257/530] memory: samsung: exynos5422-dmc: handle clk_set_parent() failure Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 258/530] security: keys: trusted: fix TPM2 authorizations Greg Kroah-Hartman
2021-05-15 8:21 ` Pavel Machek
2021-05-15 8:23 ` Pavel Machek
2021-05-12 14:46 ` [PATCH 5.10 259/530] platform/x86: pmc_atom: Match all Beckhoff Automation baytrail boards with critclk_systems DMI table Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 260/530] ARM: dts: aspeed: Rainier: Fix humidity sensor bus address Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 261/530] Drivers: hv: vmbus: Use after free in __vmbus_open() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 262/530] spi: spi-zynqmp-gqspi: fix clk_enable/disable imbalance issue Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 263/530] spi: spi-zynqmp-gqspi: fix hang issue when suspend/resume Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 264/530] spi: spi-zynqmp-gqspi: fix use-after-free in zynqmp_qspi_exec_op Greg Kroah-Hartman
2021-05-16 20:34 ` Pavel Machek
2021-05-12 14:46 ` [PATCH 5.10 265/530] spi: spi-zynqmp-gqspi: return -ENOMEM if dma_map_single fails Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 266/530] x86/platform/uv: Fix !KEXEC build failure Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 267/530] hwmon: (pmbus/pxe1610) dont bail out when not all pages are active Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 268/530] Drivers: hv: vmbus: Increase wait time for VMbus unload Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 269/530] PM: hibernate: x86: Use crc32 instead of md5 for hibernation e820 integrity check Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 270/530] usb: dwc2: Fix host mode hibernation exit with remote wakeup flow Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 271/530] usb: dwc2: Fix hibernation between host and device modes Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 272/530] ttyprintk: Add TTY hangup callback Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 273/530] serial: omap: dont disable rs485 if rts gpio is missing Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 274/530] serial: omap: fix rs485 half-duplex filtering Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 275/530] xen-blkback: fix compatibility bug with single page rings Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 276/530] soc: aspeed: fix a ternary sign expansion bug Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 277/530] drm/tilcdc: send vblank event when disabling crtc Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 278/530] drm/stm: Fix bus_flags handling Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 279/530] drm/amd/display: Fix off by one in hdmi_14_process_transaction() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 280/530] drm/mcde/panel: Inverse misunderstood flag Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 281/530] sched/fair: Fix shift-out-of-bounds in load_balance() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 282/530] afs: Fix updating of i_mode due to 3rd party change Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 283/530] rcu: Remove spurious instrumentation_end() in rcu_nmi_enter() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 284/530] media: vivid: fix assignment of dev->fbuf_out_flags Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 285/530] media: saa7134: use sg_dma_len when building pgtable Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 286/530] media: saa7146: " Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 287/530] media: omap4iss: return error code when omap4iss_get() failed Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 288/530] media: rkisp1: rsz: crash fix when setting src format Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 289/530] media: aspeed: fix clock handling logic Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 290/530] drm/probe-helper: Check epoch counter in output_poll_execute() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 291/530] media: venus: core: Fix some resource leaks in the error path of venus_probe() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 292/530] media: platform: sunxi: sun6i-csi: fix error return code of sun6i_video_start_streaming() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 293/530] media: m88ds3103: fix return value check in m88ds3103_probe() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 294/530] media: docs: Fix data organization of MEDIA_BUS_FMT_RGB101010_1X30 Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 295/530] media: [next] staging: media: atomisp: fix memory leak of object flash Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 296/530] media: atomisp: Fixed error handling path Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 297/530] media: m88rs6000t: avoid potential out-of-bounds reads on arrays Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 298/530] media: atomisp: Fix use after free in atomisp_alloc_css_stat_bufs() Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 299/530] drm/amdkfd: fix build error with AMD_IOMMU_V2=m Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 300/530] of: overlay: fix for_each_child.cocci warnings Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 301/530] x86/kprobes: Fix to check non boostable prefixes correctly Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 302/530] selftests: fix prepending $(OUTPUT) to $(TEST_PROGS) Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 303/530] pata_arasan_cf: fix IRQ check Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 304/530] pata_ipx4xx_cf: " Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 305/530] sata_mv: add IRQ checks Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 306/530] ata: libahci_platform: fix IRQ check Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 307/530] seccomp: Fix CONFIG tests for Seccomp_filters Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 308/530] nvme-tcp: block BH in sk state_change sk callback Greg Kroah-Hartman
2021-05-12 14:46 ` [PATCH 5.10 309/530] nvmet-tcp: fix incorrect locking in " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 310/530] clk: imx: Fix reparenting of UARTs not associated with stdout Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 311/530] power: supply: bq25980: Move props from battery node Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 312/530] nvme: retrigger ANA log update if group descriptor isnt found Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 313/530] media: i2c: imx219: Move out locking/unlocking of vflip and hflip controls from imx219_set_stream Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 314/530] media: i2c: imx219: Balance runtime PM use-count Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 315/530] media: v4l2-ctrls.c: fix race condition in hdl->requests list Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 316/530] vfio/fsl-mc: Re-order vfio_fsl_mc_probe() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 317/530] vfio/pci: Move VGA and VF initialization to functions Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 318/530] vfio/pci: Re-order vfio_pci_probe() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 319/530] vfio/mdev: Do not allow a mdev_type to have a NULL parent pointer Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 320/530] clk: zynqmp: move zynqmp_pll_set_mode out of round_rate callback Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 321/530] clk: zynqmp: pll: add set_pll_mode to check condition in zynqmp_pll_enable Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 322/530] drm: xlnx: zynqmp: fix a memset in zynqmp_dp_train() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 323/530] clk: qcom: a53-pll: Add missing MODULE_DEVICE_TABLE Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 324/530] clk: qcom: apss-ipq-pll: " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 325/530] drm/amd/display: use GFP_ATOMIC in dcn20_resource_construct Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 326/530] drm/radeon: Fix a missing check bug in radeon_dp_mst_detect() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 327/530] clk: uniphier: Fix potential infinite loop Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 328/530] scsi: pm80xx: Increase timeout for pm80xx mpi_uninit_check() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 329/530] scsi: pm80xx: Fix potential infinite loop Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 330/530] scsi: ufs: ufshcd-pltfrm: Fix deferred probing Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 331/530] scsi: hisi_sas: Fix IRQ checks Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 332/530] scsi: jazz_esp: Add IRQ check Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 333/530] scsi: sun3x_esp: " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 334/530] scsi: sni_53c710: " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 335/530] scsi: ibmvfc: Fix invalid state machine BUG_ON() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 336/530] mailbox: sprd: Introduce refcnt when clients requests/free channels Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 337/530] mfd: stm32-timers: Avoid clearing auto reload register Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 338/530] nvmet-tcp: fix a segmentation fault during io parsing error Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 339/530] nvme-pci: dont simple map sgl when sgls are disabled Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 340/530] media: cedrus: Fix H265 status definitions Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 341/530] HSI: core: fix resource leaks in hsi_add_client_from_dt() Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 342/530] x86/events/amd/iommu: Fix sysfs type mismatch Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 343/530] perf/amd/uncore: " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 344/530] io_uring: fix overflows checks in provide buffers Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 345/530] sched/debug: Fix cgroup_path[] serialization Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 346/530] drivers/block/null_blk/main: Fix a double free in null_init Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 347/530] xsk: Respect devices headroom and tailroom on generic xmit path Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 348/530] HID: plantronics: Workaround for double volume key presses Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 349/530] perf symbols: Fix dso__fprintf_symbols_by_name() to return the number of printed chars Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 350/530] ASoC: Intel: boards: sof-wm8804: add check for PLL setting Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 351/530] ASoC: Intel: Skylake: Compile when any configuration is selected Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 352/530] RDMA/mlx5: Fix mlx5 rates to IB rates map Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 353/530] wilc1000: write value to WILC_INTR2_ENABLE register Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 354/530] KVM: x86/mmu: Retry page faults that hit an invalid memslot Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 355/530] Bluetooth: avoid deadlock between hci_dev->lock and socket lock Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 356/530] net: lapbether: Prevent racing when checking whether the netif is running Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 357/530] libbpf: Add explicit padding to bpf_xdp_set_link_opts Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 358/530] bpftool: Fix maybe-uninitialized warnings Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 359/530] iommu: Check dev->iommu in iommu_dev_xxx functions Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 360/530] iommu/vt-d: Reject unsupported page request modes Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 361/530] selftests/bpf: Re-generate vmlinux.h and BPF skeletons if bpftool changed Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 362/530] libbpf: Add explicit padding to btf_dump_emit_type_decl_opts Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 363/530] powerpc/fadump: Mark fadump_calculate_reserve_size as __init Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 364/530] powerpc/prom: Mark identical_pvr_fixup " Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 365/530] MIPS: fix local_irq_{disable,enable} in asmmacro.h Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 366/530] ima: Fix the error code for restoring the PCR value Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 367/530] inet: use bigger hash table for IP ID generation Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 368/530] pinctrl: pinctrl-single: remove unused parameter Greg Kroah-Hartman
2021-05-12 14:47 ` [PATCH 5.10 369/530] pinctrl: pinctrl-single: fix pcs_pin_dbg_show() when bits_per_mux is not zero Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 370/530] MIPS: loongson64: fix bug when PAGE_SIZE > 16KB Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 371/530] ASoC: wm8960: Remove bitclk relax condition in wm8960_configure_sysclk Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 372/530] iommu/arm-smmu-v3: add bit field SFM into GERROR_ERR_MASK Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 373/530] RDMA/mlx5: Fix drop packet rule in egress table Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 374/530] IB/isert: Fix a use after free in isert_connect_request Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 375/530] powerpc: Fix HAVE_HARDLOCKUP_DETECTOR_ARCH build configuration Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 376/530] MIPS/bpf: Enable bpf_probe_read{, str}() on MIPS again Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 377/530] gpio: guard gpiochip_irqchip_add_domain() with GPIOLIB_IRQCHIP Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 378/530] ALSA: core: remove redundant spin_lock pair in snd_card_disconnect Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 379/530] net: phy: lan87xx: fix access to wrong register of LAN87xx Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 380/530] udp: never accept GSO_FRAGLIST packets Greg Kroah-Hartman
2021-05-15 8:37 ` Pavel Machek
2021-05-17 6:51 ` Paolo Abeni
2021-05-17 6:57 ` Pavel Machek
2021-05-17 7:47 ` Paolo Abeni
2021-05-12 14:48 ` [PATCH 5.10 381/530] powerpc/pseries: Only register vio drivers if vio bus exists Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 382/530] net/tipc: fix missing destroy_workqueue() on error in tipc_crypto_start() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 383/530] bug: Remove redundant condition check in report_bug Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 384/530] RDMA/core: Fix corrupted SL on passive side Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 385/530] nfc: pn533: prevent potential memory corruption Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 386/530] net: hns3: Limiting the scope of vector_ring_chain variable Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 387/530] mips: bmips: fix syscon-reboot nodes Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 388/530] iommu/vt-d: Dont set then clear private data in prq_event_thread() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 389/530] iommu: Fix a boundary issue to avoid performance drop Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 390/530] iommu/vt-d: Report right snoop capability when using FL for IOVA Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 391/530] iommu/vt-d: Report the right page fault address Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 392/530] iommu/vt-d: Preset Access/Dirty bits for IOVA over FL Greg Kroah-Hartman
2021-05-15 13:28 ` Wolfgang Müller
2021-05-17 2:38 ` Lu Baolu
2021-05-17 2:50 ` Sasha Levin
2021-05-12 14:48 ` [PATCH 5.10 393/530] iommu/vt-d: Remove WO permissions on second-level paging entries Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 394/530] iommu/vt-d: Invalidate PASID cache when root/context entry changed Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 395/530] ALSA: usb-audio: Add error checks for usb_driver_claim_interface() calls Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 396/530] HID: lenovo: Use brightness_set_blocking callback for setting LEDs brightness Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 397/530] HID: lenovo: Fix lenovo_led_set_tp10ubkbd() error handling Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 398/530] HID: lenovo: Check hid_get_drvdata() returns non NULL in lenovo_event() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 399/530] HID: lenovo: Map mic-mute button to KEY_F20 instead of KEY_MICMUTE Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 400/530] KVM: arm64: Initialize VCPU mdcr_el2 before loading it Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 401/530] ASoC: simple-card: fix possible uninitialized single_cpu local variable Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 402/530] liquidio: Fix unintented sign extension of a left shift of a u16 Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 403/530] IB/hfi1: Use kzalloc() for mmu_rb_handler allocation Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 404/530] powerpc/64s: Fix pte update for kernel memory on radix Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 405/530] powerpc/perf: Fix PMU constraint check for EBB events Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 406/530] powerpc: iommu: fix build when neither PCI or IBMVIO is set Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 407/530] mac80211: bail out if cipher schemes are invalid Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 408/530] perf vendor events amd: Fix broken L2 Cache Hits from L2 HWPF metric Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 409/530] xfs: fix return of uninitialized value in variable error Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 410/530] rtw88: Fix an error code in rtw_debugfs_set_rsvd_page() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 411/530] mt7601u: fix always true expression Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 412/530] mt76: mt7615: fix tx skb dma unmap Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 413/530] mt76: mt7915: " Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 414/530] mt76: mt7915: fix aggr len debugfs node Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 415/530] mt76: mt7615: fix mib stats counter reporting to mac80211 Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 416/530] mt76: mt7915: " Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 417/530] mt76: mt7663s: make all of packets 4-bytes aligned in sdio tx aggregation Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 418/530] mt76: mt7663s: fix the possible device hang in high traffic Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 419/530] KVM: PPC: Book3S HV P9: Restore host CTRL SPR after guest exit Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 420/530] ovl: invalidate readdir cache on changes to dir with origin Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 421/530] RDMA/qedr: Fix error return code in qedr_iw_connect() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 422/530] IB/hfi1: Fix error return code in parse_platform_config() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 423/530] RDMA/bnxt_re: Fix error return code in bnxt_qplib_cq_process_terminal() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 424/530] cxgb4: Fix unintentional sign extension issues Greg Kroah-Hartman
2021-05-14 9:34 ` Pavel Machek
2021-05-12 14:48 ` [PATCH 5.10 425/530] net: thunderx: Fix unintentional sign extension issue Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 426/530] RDMA/srpt: Fix error return code in srpt_cm_req_recv() Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 427/530] RDMA/rtrs-clt: destroy sysfs after removing session from active list Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 428/530] i2c: cadence: fix reference leak when pm_runtime_get_sync fails Greg Kroah-Hartman
2021-05-12 14:48 ` [PATCH 5.10 429/530] i2c: img-scb: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 430/530] i2c: imx-lpi2c: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 431/530] i2c: imx: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 432/530] i2c: omap: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 433/530] i2c: sprd: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 434/530] i2c: stm32f7: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 435/530] i2c: xiic: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 436/530] i2c: cadence: add IRQ check Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 437/530] i2c: emev2: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 438/530] i2c: jz4780: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 439/530] i2c: mlxbf: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 440/530] i2c: rcar: make sure irq is not threaded on Gen2 and earlier Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 441/530] i2c: rcar: protect against supurious interrupts on V3U Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 442/530] i2c: rcar: add IRQ check Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 443/530] i2c: sh7760: " Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 444/530] powerpc/xive: Drop check on irq_data in xive_core_debug_show() Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 445/530] powerpc/xive: Fix xmon command "dxi" Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 446/530] ASoC: ak5558: correct reset polarity Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 447/530] net/mlx5: Fix bit-wise and with zero Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 448/530] net/packet: make packet_fanout.arr size configurable up to 64K Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 449/530] net/packet: remove data races in fanout operations Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 450/530] drm/i915/gvt: Fix error code in intel_gvt_init_device() Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 451/530] iommu/amd: Put newline after closing bracket in warning Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 452/530] perf beauty: Fix fsconfig generator Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 453/530] drm/amd/pm: fix error code in smu_set_power_limit() Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 454/530] MIPS: pci-legacy: stop using of_pci_range_to_resource Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 455/530] powerpc/pseries: extract host bridge from pci_bus prior to bus removal Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 456/530] powerpc/smp: Reintroduce cpu_core_mask Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 457/530] KVM: x86: dump_vmcs should not assume GUEST_IA32_EFER is valid Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 458/530] rtlwifi: 8821ae: upgrade PHY and RF parameters Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 459/530] wlcore: fix overlapping snprintf arguments in debugfs Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 460/530] i2c: sh7760: fix IRQ error path Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 461/530] i2c: mediatek: Fix wrong dma sync flag Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 462/530] mwl8k: Fix a double Free in mwl8k_probe_hw Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 463/530] netfilter: nft_payload: fix C-VLAN offload support Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 464/530] netfilter: nftables_offload: VLAN id needs host byteorder in flow dissector Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 465/530] netfilter: nftables_offload: special ethertype handling for VLAN Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 466/530] vsock/vmci: log once the failed queue pair allocation Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 467/530] libbpf: Initialize the bpf_seq_printf parameters array field by field Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 468/530] net: ethernet: ixp4xx: Set the DMA masks explicitly Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 469/530] gro: fix napi_gro_frags() Fast GRO breakage due to IP alignment check Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 470/530] RDMA/cxgb4: add missing qpid increment Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 471/530] RDMA/i40iw: Fix error unwinding when i40iw_hmc_sd_one fails Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 472/530] ALSA: usb: midi: dont return -ENOMEM when usb_urb_ep_type_check fails Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 473/530] sfc: ef10: fix TX queue lookup in TX event handling Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 474/530] vsock/virtio: free queued packets when closing socket Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 475/530] net: marvell: prestera: fix port event handling on init Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 476/530] net: davinci_emac: Fix incorrect masking of tx and rx error channel Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 477/530] mt76: mt7615: fix memleak when mt7615_unregister_device() Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 478/530] crypto: ccp: Detect and reject "invalid" addresses destined for PSP Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 479/530] nfp: devlink: initialize the devlink port attribute "lanes" Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 480/530] net: stmmac: fix TSO and TBS feature enabling during driver open Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 481/530] net: renesas: ravb: Fix a stuck issue when a lot of frames are received Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 482/530] net: phy: intel-xway: enable integrated led functions Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 483/530] RDMA/rxe: Fix a bug in rxe_fill_ip_info() Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 484/530] RDMA/core: Add CM to restrack after successful attachment to a device Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 485/530] powerpc/64: Fix the definition of the fixmap area Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 486/530] ath9k: Fix error check in ath9k_hw_read_revisions() for PCI devices Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 487/530] ath10k: Fix a use after free in ath10k_htc_send_bundle Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 488/530] ath10k: Fix ath10k_wmi_tlv_op_pull_peer_stats_info() unlock without lock Greg Kroah-Hartman
2021-05-12 14:49 ` [PATCH 5.10 489/530] wlcore: Fix buffer overrun by snprintf due to incorrect buffer size Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 490/530] powerpc/perf: Fix the threshold event selection for memory events in power10 Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 491/530] powerpc/52xx: Fix an invalid ASM expression (addi used instead of add) Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 492/530] net: phy: marvell: fix m88e1011_set_downshift Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 493/530] net: phy: marvell: fix m88e1111_set_downshift Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 494/530] net: enetc: fix link error again Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 495/530] bnxt_en: fix ternary sign extension bug in bnxt_show_temp() Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 496/530] ARM: dts: uniphier: Change phy-mode to RGMII-ID to enable delay pins for RTL8211E Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 497/530] arm64: " Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 498/530] net: geneve: modify IP header check in geneve6_xmit_skb and geneve_xmit_skb Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 499/530] selftests: net: mirror_gre_vlan_bridge_1q: Make an FDB entry static Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 500/530] selftests: mlxsw: Remove a redundant if statement in tc_flower_scale test Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 501/530] bnxt_en: Fix RX consumer index logic in the error path Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 502/530] KVM: VMX: Intercept FS/GS_BASE MSR accesses for 32-bit KVM Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 503/530] net:emac/emac-mac: Fix a use after free in emac_mac_tx_buf_send Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 504/530] selftests/bpf: Fix BPF_CORE_READ_BITFIELD() macro Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 505/530] selftests/bpf: Fix field existence CO-RE reloc tests Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 506/530] selftests/bpf: Fix core_reloc test runner Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 507/530] bpf: Fix propagation of 32 bit unsigned bounds from 64 bit bounds Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 508/530] RDMA/siw: Fix a use after free in siw_alloc_mr Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 509/530] RDMA/bnxt_re: Fix a double free in bnxt_qplib_alloc_res Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 510/530] net: bridge: mcast: fix broken length + header check for MRDv6 Adv Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 511/530] net:nfc:digital: Fix a double free in digital_tg_recv_dep_req Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 512/530] perf tools: Change fields type in perf_record_time_conv Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 513/530] perf jit: Let convert_timestamp() to be backwards-compatible Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 514/530] perf session: Add swap operation for event TIME_CONV Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 515/530] ia64: fix EFI_DEBUG build Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 516/530] kfifo: fix ternary sign extension bugs Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 517/530] mm/sl?b.c: remove ctor argument from kmem_cache_flags Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 518/530] mm, slub: enable slub_debug static key when creating cache with explicit debug flags Greg Kroah-Hartman
2021-05-12 15:35 ` Vlastimil Babka
2021-05-12 15:37 ` Vlastimil Babka
2021-05-12 15:50 ` Greg Kroah-Hartman
2021-05-12 17:25 ` Vlastimil Babka
2021-05-12 18:49 ` Greg Kroah-Hartman
2021-05-12 19:28 ` Sasha Levin
2021-05-12 14:50 ` [PATCH 5.10 519/530] mm: memcontrol: slab: fix obtain a reference to a freeing memcg Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 520/530] mm/sparse: add the missing sparse_buffer_fini() in error branch Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 521/530] mm/memory-failure: unnecessary amount of unmapping Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 522/530] afs: Fix speculative status fetches Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 523/530] bpf: Fix alu32 const subreg bound tracking on bitwise operations Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 524/530] bpf, ringbuf: Deny reserve of buffers larger than ringbuf Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 525/530] bpf: Prevent writable memory-mapping of read-only ringbuf pages Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 526/530] arm64: Remove arm64_dma32_phys_limit and its uses Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 527/530] net: Only allow init netns to set default tcp cong to a restricted algo Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 528/530] smp: Fix smp_call_function_single_async prototype Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 529/530] Revert "net/sctp: fix race condition in sctp_destroy_sock" Greg Kroah-Hartman
2021-05-12 14:50 ` [PATCH 5.10 530/530] sctp: delay auto_asconf init until binding the first addr Greg Kroah-Hartman
2021-05-12 19:33 ` [PATCH 5.10 000/530] 5.10.37-rc1 review Florian Fainelli
2021-05-12 19:45 ` Jon Hunter
2021-05-12 20:53 ` Pavel Machek
2021-05-17 11:33 ` Greg Kroah-Hartman
2021-05-12 21:30 ` Pavel Machek
2021-05-12 22:13 ` Shuah Khan
2021-05-13 7:37 ` Fox Chen
2021-05-13 10:57 ` Sudip Mukherjee
2021-05-13 12:20 ` Naresh Kamboju
2021-05-13 20:32 ` Guenter Roeck
2021-05-14 1:00 ` Samuel Zou
Reply instructions:
You may reply publicly to this message via plain-text email
using any one of the following methods:
* Save the following mbox file, import it into your mail client,
and reply-to-all from there: mbox
Avoid top-posting and favor interleaved quoting:
https://en.wikipedia.org/wiki/Posting_style#Interleaved_style
* Reply using the --to, --cc, and --in-reply-to
switches of git-send-email(1):
git send-email \
--in-reply-to=20210512144824.055831420@linuxfoundation.org \
--to=gregkh@linuxfoundation.org \
--cc=erwan.leray@foss.st.com \
--cc=linux-kernel@vger.kernel.org \
--cc=sashal@kernel.org \
--cc=stable@vger.kernel.org \
--cc=valentin.caron@foss.st.com \
/path/to/YOUR_REPLY
https://kernel.org/pub/software/scm/git/docs/git-send-email.html
* If your mail client supports setting the In-Reply-To header
via mailto: links, try the mailto: link
Be sure your reply has a Subject: header at the top and a blank line
before the message body.
This is a public inbox, see mirroring instructions
for how to clone and mirror all data and code used for this inbox;
as well as URLs for NNTP newsgroup(s).