Home
last modified time | relevance | path

Searched full:lp (Results 1 – 25 of 565) sorted by relevance

12345678910>>...23

/Linux-v5.15/arch/sparc/kernel/
Dldc.c177 do { if (lp->cfg.debug & LDC_DEBUG_##TYPE) \
178 printk(KERN_INFO PFX "ID[%lu] " f, lp->id, ## a); \
181 #define LDC_ABORT(lp) ldc_abort((lp), __func__) argument
210 static unsigned long rx_advance(struct ldc_channel *lp, unsigned long off) in rx_advance() argument
212 return __advance(off, lp->rx_num_entries); in rx_advance()
215 static unsigned long tx_advance(struct ldc_channel *lp, unsigned long off) in tx_advance() argument
217 return __advance(off, lp->tx_num_entries); in tx_advance()
220 static struct ldc_packet *handshake_get_tx_packet(struct ldc_channel *lp, in handshake_get_tx_packet() argument
226 t = tx_advance(lp, lp->tx_tail); in handshake_get_tx_packet()
227 if (t == lp->tx_head) in handshake_get_tx_packet()
[all …]
/Linux-v5.15/drivers/net/ethernet/xilinx/
Dll_temac_main.c71 static u32 _temac_ior_be(struct temac_local *lp, int offset) in _temac_ior_be() argument
73 return ioread32be(lp->regs + offset); in _temac_ior_be()
76 static void _temac_iow_be(struct temac_local *lp, int offset, u32 value) in _temac_iow_be() argument
78 return iowrite32be(value, lp->regs + offset); in _temac_iow_be()
81 static u32 _temac_ior_le(struct temac_local *lp, int offset) in _temac_ior_le() argument
83 return ioread32(lp->regs + offset); in _temac_ior_le()
86 static void _temac_iow_le(struct temac_local *lp, int offset, u32 value) in _temac_iow_le() argument
88 return iowrite32(value, lp->regs + offset); in _temac_iow_le()
91 static bool hard_acs_rdy(struct temac_local *lp) in hard_acs_rdy() argument
93 return temac_ior(lp, XTE_RDY0_OFFSET) & XTE_RDY0_HARD_ACS_RDY_MASK; in hard_acs_rdy()
[all …]
Dxilinx_axienet_main.c123 * @lp: Pointer to axienet local structure
130 static inline u32 axienet_dma_in32(struct axienet_local *lp, off_t reg) in axienet_dma_in32() argument
132 return ioread32(lp->dma_regs + reg); in axienet_dma_in32()
137 * @lp: Pointer to axienet local structure
144 static inline void axienet_dma_out32(struct axienet_local *lp, in axienet_dma_out32() argument
147 iowrite32(value, lp->dma_regs + reg); in axienet_dma_out32()
150 static void axienet_dma_out_addr(struct axienet_local *lp, off_t reg, in axienet_dma_out_addr() argument
153 axienet_dma_out32(lp, reg, lower_32_bits(addr)); in axienet_dma_out_addr()
155 if (lp->features & XAE_FEATURE_DMA_64BIT) in axienet_dma_out_addr()
156 axienet_dma_out32(lp, reg + 4, upper_32_bits(addr)); in axienet_dma_out_addr()
[all …]
Dxilinx_axienet_mdio.c24 static int axienet_mdio_wait_until_ready(struct axienet_local *lp) in axienet_mdio_wait_until_ready() argument
28 return readx_poll_timeout(axinet_ior_read_mcr, lp, in axienet_mdio_wait_until_ready()
34 static void axienet_mdio_mdc_enable(struct axienet_local *lp) in axienet_mdio_mdc_enable() argument
36 axienet_iow(lp, XAE_MDIO_MC_OFFSET, in axienet_mdio_mdc_enable()
37 ((u32)lp->mii_clk_div | XAE_MDIO_MC_MDIOEN_MASK)); in axienet_mdio_mdc_enable()
41 static void axienet_mdio_mdc_disable(struct axienet_local *lp) in axienet_mdio_mdc_disable() argument
45 mc_reg = axienet_ior(lp, XAE_MDIO_MC_OFFSET); in axienet_mdio_mdc_disable()
46 axienet_iow(lp, XAE_MDIO_MC_OFFSET, in axienet_mdio_mdc_disable()
66 struct axienet_local *lp = bus->priv; in axienet_mdio_read() local
68 axienet_mdio_mdc_enable(lp); in axienet_mdio_read()
[all …]
/Linux-v5.15/drivers/net/ethernet/
Dkorina.c378 static dma_addr_t korina_tx_dma(struct korina_private *lp, int idx) in korina_tx_dma() argument
380 return lp->td_dma + (idx * sizeof(struct dma_desc)); in korina_tx_dma()
383 static dma_addr_t korina_rx_dma(struct korina_private *lp, int idx) in korina_rx_dma() argument
385 return lp->rd_dma + (idx * sizeof(struct dma_desc)); in korina_rx_dma()
406 struct korina_private *lp = netdev_priv(dev); in korina_abort_tx() local
408 korina_abort_dma(dev, lp->tx_dma_regs); in korina_abort_tx()
413 struct korina_private *lp = netdev_priv(dev); in korina_abort_rx() local
415 korina_abort_dma(dev, lp->rx_dma_regs); in korina_abort_rx()
421 struct korina_private *lp = netdev_priv(dev); in korina_send_packet() local
429 spin_lock_irqsave(&lp->lock, flags); in korina_send_packet()
[all …]
/Linux-v5.15/drivers/net/ieee802154/
Dmcr20a.c447 struct mcr20a_local *lp = context; in mcr20a_write_tx_buf_complete() local
450 dev_dbg(printdev(lp), "%s\n", __func__); in mcr20a_write_tx_buf_complete()
452 lp->reg_msg.complete = NULL; in mcr20a_write_tx_buf_complete()
453 lp->reg_cmd[0] = MCR20A_WRITE_REG(DAR_PHY_CTRL1); in mcr20a_write_tx_buf_complete()
454 lp->reg_data[0] = MCR20A_XCVSEQ_TX; in mcr20a_write_tx_buf_complete()
455 lp->reg_xfer_data.len = 1; in mcr20a_write_tx_buf_complete()
457 ret = spi_async(lp->spi, &lp->reg_msg); in mcr20a_write_tx_buf_complete()
459 dev_err(printdev(lp), "failed to set SEQ TX\n"); in mcr20a_write_tx_buf_complete()
465 struct mcr20a_local *lp = hw->priv; in mcr20a_xmit() local
467 dev_dbg(printdev(lp), "%s\n", __func__); in mcr20a_xmit()
[all …]
Dat86rf230.c64 struct at86rf230_local *lp; member
113 at86rf230_async_state_change(struct at86rf230_local *lp,
118 at86rf230_sleep(struct at86rf230_local *lp) in at86rf230_sleep() argument
120 if (gpio_is_valid(lp->slp_tr)) { in at86rf230_sleep()
121 gpio_set_value(lp->slp_tr, 1); in at86rf230_sleep()
122 usleep_range(lp->data->t_off_to_sleep, in at86rf230_sleep()
123 lp->data->t_off_to_sleep + 10); in at86rf230_sleep()
124 lp->sleep = true; in at86rf230_sleep()
129 at86rf230_awake(struct at86rf230_local *lp) in at86rf230_awake() argument
131 if (gpio_is_valid(lp->slp_tr)) { in at86rf230_awake()
[all …]
Dadf7242.c301 static int adf7242_soft_reset(struct adf7242_local *lp, int line);
303 static int adf7242_status(struct adf7242_local *lp, u8 *stat) in adf7242_status() argument
307 mutex_lock(&lp->bmux); in adf7242_status()
308 status = spi_sync(lp->spi, &lp->stat_msg); in adf7242_status()
309 *stat = lp->buf_stat_rx; in adf7242_status()
310 mutex_unlock(&lp->bmux); in adf7242_status()
315 static int adf7242_wait_status(struct adf7242_local *lp, unsigned int status, in adf7242_wait_status() argument
322 adf7242_status(lp, &stat); in adf7242_wait_status()
330 adf7242_soft_reset(lp, line); in adf7242_wait_status()
331 adf7242_status(lp, &stat); in adf7242_wait_status()
[all …]
/Linux-v5.15/drivers/net/ethernet/amd/
Dpcnet32.c448 struct pcnet32_private *lp = netdev_priv(dev); in pcnet32_netif_stop() local
451 napi_disable(&lp->napi); in pcnet32_netif_stop()
457 struct pcnet32_private *lp = netdev_priv(dev); in pcnet32_netif_start() local
462 val = lp->a->read_csr(ioaddr, CSR3); in pcnet32_netif_start()
464 lp->a->write_csr(ioaddr, CSR3, val); in pcnet32_netif_start()
465 napi_enable(&lp->napi); in pcnet32_netif_start()
473 * Must be called with lp->lock held.
476 struct pcnet32_private *lp, in pcnet32_realloc_tx_ring() argument
488 dma_alloc_coherent(&lp->pci_dev->dev, in pcnet32_realloc_tx_ring()
502 kfree(lp->tx_skbuff); in pcnet32_realloc_tx_ring()
[all …]
Damd8111e.c98 static int amd8111e_read_phy(struct amd8111e_priv *lp, in amd8111e_read_phy() argument
101 void __iomem *mmio = lp->mmio; in amd8111e_read_phy()
127 static int amd8111e_write_phy(struct amd8111e_priv *lp, in amd8111e_write_phy() argument
131 void __iomem *mmio = lp->mmio; in amd8111e_write_phy()
159 struct amd8111e_priv *lp = netdev_priv(dev); in amd8111e_mdio_read() local
162 amd8111e_read_phy(lp, phy_id, reg_num, &reg_val); in amd8111e_mdio_read()
171 struct amd8111e_priv *lp = netdev_priv(dev); in amd8111e_mdio_write() local
173 amd8111e_write_phy(lp, phy_id, reg_num, val); in amd8111e_mdio_write()
181 struct amd8111e_priv *lp = netdev_priv(dev); in amd8111e_set_ext_phy() local
185 advert = amd8111e_mdio_read(dev, lp->ext_phy_addr, MII_ADVERTISE); in amd8111e_set_ext_phy()
[all …]
D7990.c45 #define WRITERAP(lp, x) out_be16(lp->base + LANCE_RAP, (x)) argument
46 #define WRITERDP(lp, x) out_be16(lp->base + LANCE_RDP, (x)) argument
47 #define READRDP(lp) in_be16(lp->base + LANCE_RDP) argument
59 #define WRITERAP(lp, x) (lp->writerap(lp, x)) argument
60 #define WRITERDP(lp, x) (lp->writerdp(lp, x)) argument
61 #define READRDP(lp) (lp->readrdp(lp)) argument
66 static inline void WRITERAP(struct lance_private *lp, __u16 value) in WRITERAP() argument
69 out_be16(lp->base + HPLANCE_REGOFF + LANCE_RAP, value); in WRITERAP()
70 } while ((in_8(lp->base + HPLANCE_STATUS) & LE_ACK) == 0); in WRITERAP()
73 static inline void WRITERDP(struct lance_private *lp, __u16 value) in WRITERDP() argument
[all …]
Dsunlance.c267 #define TX_BUFFS_AVAIL ((lp->tx_old<=lp->tx_new)?\
268 lp->tx_old+TX_RING_MOD_MASK-lp->tx_new:\
269 lp->tx_old - lp->tx_new-1)
295 static void load_csrs(struct lance_private *lp) in load_csrs() argument
299 if (lp->pio_buffer) in load_csrs()
302 leptr = LANCE_ADDR(lp->init_block_dvma); in load_csrs()
304 sbus_writew(LE_CSR1, lp->lregs + RAP); in load_csrs()
305 sbus_writew(leptr & 0xffff, lp->lregs + RDP); in load_csrs()
306 sbus_writew(LE_CSR2, lp->lregs + RAP); in load_csrs()
307 sbus_writew(leptr >> 16, lp->lregs + RDP); in load_csrs()
[all …]
/Linux-v5.15/net/ipv4/
Dtcp_lp.c3 * TCP Low Priority (TCP-LP)
11 * the original TCP-LP implementation:
26 * http://www.ece.rice.edu/~akuzma/Doc/akuzma/TCP-LP.pdf
28 * http://www-ece.rice.edu/networks/TCP-LP/
34 * http://tcp-lp-mod.sourceforge.net/
50 * TCP-LP's state flags.
61 * struct lp
62 * @flag: TCP-LP state flag
73 * TCP-LP's private struct.
74 * We get the idea from original TCP-LP implementation where only left those we
[all …]
/Linux-v5.15/drivers/net/ethernet/smsc/
Dsmc91x.h65 #define SMC_IO_SHIFT (lp->io_shift)
71 SMC_16BIT(lp) ? readw((a) + __smc_r) : \
72 SMC_8BIT(lp) ? SMC_inw_b(a, __smc_r) : \
78 #define SMC_outw(lp, v, a, r) \ argument
81 if (SMC_16BIT(lp)) \
82 __SMC_outw(lp, __v, a, __smc_r); \
83 else if (SMC_8BIT(lp)) \
111 #define __SMC_outw(lp, v, a, r) \ argument
114 (lp)->cfg.pxa_u16_align4)
127 #define SMC_outw(lp, v, a, r) outw(v, (a) + (r) - 0xa0000000) argument
[all …]
Dsmc911x.h112 static inline unsigned int SMC_inl(struct smc911x_local *lp, int reg) in SMC_inl() argument
114 void __iomem *ioaddr = lp->base + reg; in SMC_inl()
116 if (lp->cfg.flags & SMC911X_USE_32BIT) in SMC_inl()
119 if (lp->cfg.flags & SMC911X_USE_16BIT) in SMC_inl()
125 static inline void SMC_outl(unsigned int value, struct smc911x_local *lp, in SMC_outl() argument
128 void __iomem *ioaddr = lp->base + reg; in SMC_outl()
130 if (lp->cfg.flags & SMC911X_USE_32BIT) { in SMC_outl()
135 if (lp->cfg.flags & SMC911X_USE_16BIT) { in SMC_outl()
144 static inline void SMC_insl(struct smc911x_local *lp, int reg, in SMC_insl() argument
147 void __iomem *ioaddr = lp->base + reg; in SMC_insl()
[all …]
Dsmc911x.c148 #define SMC_ENABLE_INT(lp, x) do { \ argument
150 __mask = SMC_GET_INT_EN((lp)); \
152 SMC_SET_INT_EN((lp), __mask); \
156 #define SMC_DISABLE_INT(lp, x) do { \ argument
158 __mask = SMC_GET_INT_EN((lp)); \
160 SMC_SET_INT_EN((lp), __mask); \
168 struct smc911x_local *lp = netdev_priv(dev); in smc911x_reset() local
175 if ((SMC_GET_PMT_CTRL(lp) & PMT_CTRL_READY_) == 0) { in smc911x_reset()
177 SMC_SET_BYTE_TEST(lp, 0); in smc911x_reset()
181 reg = SMC_GET_PMT_CTRL(lp) & PMT_CTRL_READY_; in smc911x_reset()
[all …]
Dsmc91x.c194 #define SMC_ENABLE_INT(lp, x) do { \ argument
197 spin_lock_irqsave(&lp->lock, smc_enable_flags); \
198 mask = SMC_GET_INT_MASK(lp); \
200 SMC_SET_INT_MASK(lp, mask); \
201 spin_unlock_irqrestore(&lp->lock, smc_enable_flags); \
205 #define SMC_DISABLE_INT(lp, x) do { \ argument
208 spin_lock_irqsave(&lp->lock, smc_disable_flags); \
209 mask = SMC_GET_INT_MASK(lp); \
211 SMC_SET_INT_MASK(lp, mask); \
212 spin_unlock_irqrestore(&lp->lock, smc_disable_flags); \
[all …]
/Linux-v5.15/drivers/net/ethernet/dec/tulip/
Dde4x5.c192 SROM, the feature is ignored unless lp->params.fdx is set at compile
343 Fix initialisation problem with lp->timeout in
404 lp->rst not run because lp->ibn not initialised -
420 Change dev->interrupt to lp->interrupt to ensure
683 imr |= lp->irq_en;\
689 imr &= ~lp->irq_en;\
694 imr |= lp->irq_mask;\
700 imr &= ~lp->irq_mask;\
889 #define TX_BUFFS_AVAIL ((lp->tx_old<=lp->tx_new)?\
890 lp->tx_old+lp->txRingSize-lp->tx_new-1:\
[all …]
/Linux-v5.15/drivers/video/backlight/
Dlp855x_bl.c77 static int lp855x_write_byte(struct lp855x *lp, u8 reg, u8 data) in lp855x_write_byte() argument
79 return i2c_smbus_write_byte_data(lp->client, reg, data); in lp855x_write_byte()
82 static int lp855x_update_bit(struct lp855x *lp, u8 reg, u8 mask, u8 data) in lp855x_update_bit() argument
87 ret = i2c_smbus_read_byte_data(lp->client, reg); in lp855x_update_bit()
89 dev_err(lp->dev, "failed to read 0x%.2x\n", reg); in lp855x_update_bit()
97 return lp855x_write_byte(lp, reg, tmp); in lp855x_update_bit()
100 static bool lp855x_is_valid_rom_area(struct lp855x *lp, u8 addr) in lp855x_is_valid_rom_area() argument
104 switch (lp->chip_id) { in lp855x_is_valid_rom_area()
131 static int lp8557_bl_off(struct lp855x *lp) in lp8557_bl_off() argument
134 return lp855x_update_bit(lp, LP8557_BL_CMD, LP8557_BL_MASK, in lp8557_bl_off()
[all …]
Darcxcnn_bl.c94 static int arcxcnn_update_field(struct arcxcnn *lp, u8 reg, u8 mask, u8 data) in arcxcnn_update_field() argument
99 ret = i2c_smbus_read_byte_data(lp->client, reg); in arcxcnn_update_field()
101 dev_err(lp->dev, "failed to read 0x%.2x\n", reg); in arcxcnn_update_field()
109 return i2c_smbus_write_byte_data(lp->client, reg, tmp); in arcxcnn_update_field()
112 static int arcxcnn_set_brightness(struct arcxcnn *lp, u32 brightness) in arcxcnn_set_brightness() argument
119 ret = i2c_smbus_write_byte_data(lp->client, in arcxcnn_set_brightness()
126 return i2c_smbus_write_byte_data(lp->client, in arcxcnn_set_brightness()
132 struct arcxcnn *lp = bl_get_data(bl); in arcxcnn_bl_update_status() local
139 ret = arcxcnn_set_brightness(lp, brightness); in arcxcnn_bl_update_status()
144 return arcxcnn_update_field(lp, ARCXCNN_CMD, ARCXCNN_CMD_STDBY, in arcxcnn_bl_update_status()
[all …]
/Linux-v5.15/drivers/net/arcnet/
Darcnet.c164 struct arcnet_local *lp = netdev_priv(dev); in arcnet_dump_packet() local
174 spin_lock_irqsave(&lp->lock, flags); in arcnet_dump_packet()
176 lp->hw.copy_from_card(dev, bufnum, 0, buf, 512); in arcnet_dump_packet()
178 spin_unlock_irqrestore(&lp->lock, flags); in arcnet_dump_packet()
198 struct arcnet_local *lp = netdev_priv(dev); in arcnet_led_event() local
204 led_trigger_blink_oneshot(lp->recon_led_trig, in arcnet_led_event()
208 led_trigger_event(lp->tx_led_trig, LED_OFF); in arcnet_led_event()
209 led_trigger_event(lp->recon_led_trig, LED_OFF); in arcnet_led_event()
212 led_trigger_event(lp->tx_led_trig, LED_OFF); in arcnet_led_event()
213 led_trigger_event(lp->recon_led_trig, LED_OFF); in arcnet_led_event()
[all …]
/Linux-v5.15/drivers/net/ethernet/natsemi/
Dsonic.c45 struct sonic_local *lp = netdev_priv(dev); in sonic_msg_init() local
47 lp->msg_enable = netif_msg_init(sonic_debug, 0); in sonic_msg_init()
50 netif_dbg(lp, drv, dev, "%s", version); in sonic_msg_init()
55 struct sonic_local *lp = netdev_priv(dev); in sonic_alloc_descriptors() local
61 lp->descriptors = in sonic_alloc_descriptors()
62 dma_alloc_coherent(lp->device, in sonic_alloc_descriptors()
64 SONIC_BUS_SCALE(lp->dma_bitmode), in sonic_alloc_descriptors()
65 &lp->descriptors_laddr, GFP_KERNEL); in sonic_alloc_descriptors()
67 if (!lp->descriptors) in sonic_alloc_descriptors()
70 lp->cda = lp->descriptors; in sonic_alloc_descriptors()
[all …]
/Linux-v5.15/arch/xtensa/platforms/iss/
Dnetwork.c85 int (*open)(struct iss_net_private *lp);
86 void (*close)(struct iss_net_private *lp);
87 int (*read)(struct iss_net_private *lp, struct sk_buff **skb);
88 int (*write)(struct iss_net_private *lp, struct sk_buff **skb);
90 int (*poll)(struct iss_net_private *lp);
160 static int tuntap_open(struct iss_net_private *lp) in tuntap_open() argument
163 char *dev_name = lp->tp.info.tuntap.dev_name; in tuntap_open()
170 lp->dev->name, fd, errno); in tuntap_open()
181 lp->dev->name, dev_name, err, errno); in tuntap_open()
186 lp->tp.info.tuntap.fd = fd; in tuntap_open()
[all …]
/Linux-v5.15/drivers/net/ethernet/toshiba/
Dtc35815.c335 #define HAVE_DMA_RXALIGN(lp) likely((lp)->chiptype != TC35815CF) argument
439 static inline dma_addr_t fd_virt_to_bus(struct tc35815_local *lp, void *virt) in fd_virt_to_bus() argument
441 return lp->fd_buf_dma + ((u8 *)virt - (u8 *)lp->fd_buf); in fd_virt_to_bus()
444 static inline void *fd_bus_to_virt(struct tc35815_local *lp, dma_addr_t bus) in fd_bus_to_virt() argument
446 return (void *)((u8 *)lp->fd_buf + (bus - lp->fd_buf_dma)); in fd_bus_to_virt()
540 struct tc35815_local *lp = netdev_priv(dev); in tc_handle_link_change() local
545 spin_lock_irqsave(&lp->lock, flags); in tc_handle_link_change()
547 (lp->speed != phydev->speed || lp->duplex != phydev->duplex)) { in tc_handle_link_change()
573 lp->chiptype != TC35815_TX4939) in tc_handle_link_change()
577 lp->speed = phydev->speed; in tc_handle_link_change()
[all …]
/Linux-v5.15/drivers/input/misc/
Dpcf8574_keypad.c46 static short read_state(struct kp_data *lp) in read_state() argument
50 i2c_smbus_write_byte(lp->client, 240); in read_state()
51 x = 0xF & (~(i2c_smbus_read_byte(lp->client) >> 4)); in read_state()
53 i2c_smbus_write_byte(lp->client, 15); in read_state()
54 y = 0xF & (~i2c_smbus_read_byte(lp->client)); in read_state()
66 struct kp_data *lp = dev_id; in pcf8574_kp_irq_handler() local
67 unsigned char nextstate = read_state(lp); in pcf8574_kp_irq_handler()
69 if (lp->laststate != nextstate) { in pcf8574_kp_irq_handler()
70 int key_down = nextstate < ARRAY_SIZE(lp->btncode); in pcf8574_kp_irq_handler()
72 lp->btncode[nextstate] : lp->btncode[lp->laststate]; in pcf8574_kp_irq_handler()
[all …]

12345678910>>...23