Home
last modified time | relevance | path

Searched +full:num +full:- +full:txq (Results 1 – 25 of 116) sorted by relevance

12345

/openbmc/linux/drivers/net/ethernet/hisilicon/
H A Dhisi_femac.c1 // SPDX-License-Identifier: GPL-2.0-or-later
38 #define HW_RX_FIFO_DEPTH (MAX_HW_FIFO_DEPTH - HW_TX_FIFO_DEPTH)
84 #define MAX_MULTICAST_ADDRESSES (MAX_MAC_FILTER_NUM - \
91 #define PHY_RESET_DELAYS_PROPERTY "hisilicon,phy-reset-delays-us"
103 int num; member
120 struct hisi_femac_queue txq; member
130 val = readl(priv->glb_base + GLB_IRQ_ENA); in hisi_femac_irq_enable()
131 writel(val | irqs, priv->glb_base + GLB_IRQ_ENA); in hisi_femac_irq_enable()
138 val = readl(priv->glb_base + GLB_IRQ_ENA); in hisi_femac_irq_disable()
139 writel(val & (~irqs), priv->glb_base + GLB_IRQ_ENA); in hisi_femac_irq_disable()
[all …]
/openbmc/linux/drivers/net/ethernet/brocade/bna/
H A Dbna_tx_rx.c1 // SPDX-License-Identifier: GPL-2.0-only
3 * Linux network driver for QLogic BR-series Converged Network Adapter.
6 * Copyright (c) 2005-2014 Brocade Communications Systems, Inc.
7 * Copyright (c) 2014-2015 QLogic Corporation
18 ib->coalescing_timeo = coalescing_timeo; in bna_ib_coalescing_timeo_set()
19 ib->door_bell.doorbell_ack = BNA_DOORBELL_IB_INT_ACK( in bna_ib_coalescing_timeo_set()
20 (u32)ib->coalescing_timeo, 0); in bna_ib_coalescing_timeo_set()
27 (rxf)->vlan_pending_bitmask = (u8)BFI_VLAN_BMASK_ALL; \
28 (rxf)->vlan_strip_pending = true; \
33 if ((rxf)->rss_status == BNA_STATUS_T_ENABLED) \
[all …]
/openbmc/linux/drivers/net/ethernet/fungible/funeth/
H A Dfuneth_trace.h1 /* SPDX-License-Identifier: (GPL-2.0-only OR BSD-3-Clause) */
15 TP_PROTO(const struct funeth_txq *txq,
20 TP_ARGS(txq, len, sqe_idx, ngle),
27 __string(devname, txq->netdev->name)
31 __entry->qidx = txq->qidx;
32 __entry->len = len;
33 __entry->sqe_idx = sqe_idx;
34 __entry->ngle = ngle;
35 __assign_str(devname, txq->netdev->name);
38 TP_printk("%s: Txq %u, SQE idx %u, len %u, num GLEs %u",
[all …]
/openbmc/linux/drivers/net/ethernet/marvell/
H A Dmvneta.c7 * Thomas Petazzoni <thomas.petazzoni@free-electrons.com>
135 #define MVNETA_CPU_TXQ_ACCESS(txq) BIT(txq + 8) argument
149 /* bits 0..7 = TXQ SENT, one bit per queue.
156 #define MVNETA_TX_INTR_MASK(nr_txqs) (((1 << nr_txqs) - 1) << 0)
158 #define MVNETA_RX_INTR_MASK(nr_rxqs) (((1 << nr_rxqs) - 1) << 8)
270 * to cover all rate-limit values from 10Kbps up to 5Gbps
296 (((index) < (q)->last_desc) ? ((index) + 1) : 0)
374 #define MVNETA_MAX_RX_BUF_SIZE (PAGE_SIZE - MVNETA_SKB_PAD)
377 (((rxd)->status & MVNETA_RXD_BM_POOL_MASK) >> MVNETA_RXD_BM_POOL_SHIFT)
486 /* Pointer to the CPU-local NAPI struct */
[all …]
H A Dmv643xx_eth.c1 // SPDX-License-Identifier: GPL-2.0-or-later
10 * Copyright (C) 2003 PMC-Sierra, Inc.,
13 * Copyright (C) 2003 Ralf Baechle <ralf@linux-mips.org>
15 * Copyright (C) 2004-2006 MontaVista Software, Inc.
21 * Copyright (C) 2007-2008 Marvell Semiconductor
30 #include <linux/dma-mapping.h>
71 * Main per-port registers. These live at offset 0x0400 for
142 * Misc per-port registers.
173 #define SKB_DMA_REALIGN ((PAGE_SIZE - NET_SKB_PAD) % SMP_CACHE_BYTES)
179 #define IS_TSO_HEADER(txq, addr) \ argument
[all …]
/openbmc/linux/drivers/net/ethernet/atheros/alx/
H A Dmain.c53 static void alx_free_txbuf(struct alx_tx_queue *txq, int entry) in alx_free_txbuf() argument
55 struct alx_buffer *txb = &txq->bufs[entry]; in alx_free_txbuf()
58 dma_unmap_single(txq->dev, in alx_free_txbuf()
65 if (txb->skb) { in alx_free_txbuf()
66 dev_kfree_skb_any(txb->skb); in alx_free_txbuf()
67 txb->skb = NULL; in alx_free_txbuf()
73 struct alx_rx_queue *rxq = alx->qnapi[0]->rxq; in alx_refill_rx_ring()
79 next = cur = rxq->write_idx; in alx_refill_rx_ring()
80 if (++next == alx->rx_ringsz) in alx_refill_rx_ring()
82 cur_buf = &rxq->bufs[cur]; in alx_refill_rx_ring()
[all …]
/openbmc/linux/drivers/net/ethernet/marvell/mvpp2/
H A Dmvpp2_main.c1 // SPDX-License-Identifier: GPL-2.0
76 writel(data, priv->swth_base[0] + offset); in mvpp2_write()
81 return readl(priv->swth_base[0] + offset); in mvpp2_read()
86 return readl_relaxed(priv->swth_base[0] + offset); in mvpp2_read_relaxed()
91 return cpu % priv->nthreads; in mvpp2_cpu_to_thread()
96 writel(data, priv->cm3_base + offset); in mvpp2_cm3_write()
101 return readl(priv->cm3_base + offset); in mvpp2_cm3_read()
105 mvpp2_create_page_pool(struct device *dev, int num, int len, in mvpp2_create_page_pool() argument
111 .pool_size = num, in mvpp2_create_page_pool()
124 * - per-thread registers, where each thread has its own copy of the
[all …]
/openbmc/u-boot/drivers/net/
H A Dmvneta.c1 // SPDX-License-Identifier: GPL-2.0
5 * U-Boot version:
6 * Copyright (C) 2014-2015 Stefan Roese <sr@denx.de>
12 * Thomas Petazzoni <thomas.petazzoni@free-electrons.com>
30 #include <asm-generic/gpio.h>
141 /* bits 0..7 = TXQ SENT, one bit per queue.
148 #define MVNETA_TX_INTR_MASK(nr_txqs) (((1 << nr_txqs) - 1) << 0)
150 #define MVNETA_RX_INTR_MASK(nr_rxqs) (((1 << nr_rxqs) - 1) << 8)
220 (((index) < (q)->last_desc) ? ((index) + 1) : 0)
318 u32 reserved2; /* hw_cmd - (for future use, PMT) */
[all …]
H A Dmvpp2.c8 * U-Boot version:
9 * Copyright (C) 2016-2017 Stefan Roese <sr@denx.de>
18 #include <dm/device-internal.h>
33 #include <asm-generic/gpio.h>
167 #define MVPP2_TXQ_SENT_REG(txq) (0x3c00 + 4 * (txq)) argument
346 /* Per-port registers */
392 * Per-port XGMAC registers. PPv2.2 only, only for GOP port 0,
393 * relative to port->base.
491 (((index) < (q)->last_desc) ? ((index) + 1) : 0)
493 /* SMI: 0xc0054 -> offset 0x54 to lms_base */
[all …]
/openbmc/linux/Documentation/devicetree/bindings/net/
H A Dbrcm,systemport.yaml1 # SPDX-License-Identifier: GPL-2.0-only OR BSD-2-Clause
3 ---
5 $schema: http://devicetree.org/meta-schemas/core.yaml#
10 - Florian Fainelli <f.fainelli@gmail.com>
15 - brcm,systemport-v1.00
16 - brcm,systemportlite-v1.00
17 - brcm,systemport
25 - description: interrupt line for RX queues
26 - description: interrupt line for TX queues
27 - description: interrupt line for Wake-on-LAN
[all …]
/openbmc/linux/drivers/net/ethernet/chelsio/cxgb4/
H A Dcudbg_lib.h1 /* SPDX-License-Identifier: GPL-2.0-only */
181 u32 *num, u32 *size);
241 static inline void cudbg_fill_qdesc_txq(const struct sge_txq *txq, in cudbg_fill_qdesc_txq() argument
245 entry->qtype = type; in cudbg_fill_qdesc_txq()
246 entry->qid = txq->cntxt_id; in cudbg_fill_qdesc_txq()
247 entry->desc_size = sizeof(struct tx_desc); in cudbg_fill_qdesc_txq()
248 entry->num_desc = txq->size; in cudbg_fill_qdesc_txq()
249 entry->data_size = txq->size * sizeof(struct tx_desc); in cudbg_fill_qdesc_txq()
250 memcpy(entry->data, txq->desc, entry->data_size); in cudbg_fill_qdesc_txq()
257 entry->qtype = type; in cudbg_fill_qdesc_rxq()
[all …]
/openbmc/linux/drivers/bluetooth/
H A Dhci_ag6xx.c1 // SPDX-License-Identifier: GPL-2.0-or-later
24 struct sk_buff_head txq; member
41 return -ENOMEM; in ag6xx_open()
43 skb_queue_head_init(&ag6xx->txq); in ag6xx_open()
45 hu->priv = ag6xx; in ag6xx_open()
51 struct ag6xx_data *ag6xx = hu->priv; in ag6xx_close()
55 skb_queue_purge(&ag6xx->txq); in ag6xx_close()
56 kfree_skb(ag6xx->rx_skb); in ag6xx_close()
59 hu->priv = NULL; in ag6xx_close()
65 struct ag6xx_data *ag6xx = hu->priv; in ag6xx_flush()
[all …]
/openbmc/linux/drivers/net/wireless/ath/ath6kl/
H A Dhtc_pipe.c2 * Copyright (c) 2007-2011 Atheros Communications Inc.
19 #include "hif-ops.h"
31 if (packet->info.tx.flags & HTC_FLAGS_TX_FIXUP_NETBUF) { in restore_tx_packet()
32 skb_pull(packet->skb, sizeof(struct htc_frame_hdr)); in restore_tx_packet()
33 packet->info.tx.flags &= ~HTC_FLAGS_TX_FIXUP_NETBUF; in restore_tx_packet()
47 if (ep->ep_cb.tx_comp_multi != NULL) { in do_send_completion()
50 __func__, ep->eid, in do_send_completion()
56 ep->ep_cb.tx_comp_multi(ep->target, queue_to_indicate); in do_send_completion()
68 list_del(&packet->list); in do_send_completion()
71 __func__, ep->eid, packet); in do_send_completion()
[all …]
H A Dhtc_mbox.c2 * Copyright (c) 2007-2011 Atheros Communications Inc.
3 * Copyright (c) 2011-2012 Qualcomm Atheros, Inc.
21 #include "hif-ops.h"
26 #define CALC_TXRX_PADDED_LEN(dev, len) (__ALIGN_MASK((len), (dev)->block_mask))
36 /* threshold to re-enable Tx bundling for an AC*/
45 ep_dist->endpoint, credits); in ath6kl_credit_deposit()
47 ep_dist->credits += credits; in ath6kl_credit_deposit()
48 ep_dist->cred_assngd += credits; in ath6kl_credit_deposit()
49 cred_info->cur_free_credits -= credits; in ath6kl_credit_deposit()
61 cred_info->cur_free_credits = tot_credits; in ath6kl_credit_init()
[all …]
/openbmc/linux/drivers/net/ethernet/emulex/benet/
H A Dbe_main.c1 // SPDX-License-Identifier: GPL-2.0-only
3 * Copyright (C) 2005 - 2016 Broadcom
7 * linux-drivers@emulex.com
38 /* Per-module error detection/recovery workq shared across all functions.
146 struct be_dma_mem *mem = &q->dma_mem; in be_queue_free()
148 if (mem->va) { in be_queue_free()
149 dma_free_coherent(&adapter->pdev->dev, mem->size, mem->va, in be_queue_free()
150 mem->dma); in be_queue_free()
151 mem->va = NULL; in be_queue_free()
158 struct be_dma_mem *mem = &q->dma_mem; in be_queue_alloc()
[all …]
/openbmc/linux/drivers/net/wireless/realtek/rtw88/
H A Dtx.c1 // SPDX-License-Identifier: GPL-2.0 OR BSD-3-Clause
2 /* Copyright(c) 2018-2019 Realtek Corporation
18 hdr = (struct ieee80211_hdr *)skb->data; in rtw_tx_stats()
20 if (!ieee80211_is_data(hdr->frame_control)) in rtw_tx_stats()
23 if (!is_broadcast_ether_addr(hdr->addr1) && in rtw_tx_stats()
24 !is_multicast_ether_addr(hdr->addr1)) { in rtw_tx_stats()
25 rtwdev->stats.tx_unicast += skb->len; in rtw_tx_stats()
26 rtwdev->stats.tx_cnt++; in rtw_tx_stats()
28 rtwvif = (struct rtw_vif *)vif->drv_priv; in rtw_tx_stats()
29 rtwvif->stats.tx_unicast += skb->len; in rtw_tx_stats()
[all …]
/openbmc/linux/drivers/net/ethernet/mellanox/mlx5/core/en/
H A Dqos.c1 // SPDX-License-Identifier: GPL-2.0 OR Linux-OpenIB
21 return -EINVAL; in mlx5e_qos_bytes_rate_check()
41 * 1. This function is called only after checking selq->htb_maj_id != 0, in mlx5e_qid_from_qos()
43 * 2. When selq->htb_maj_id becomes 0, synchronize_rcu waits for in mlx5e_qid_from_qos()
44 * mlx5e_select_queue to finish while holding priv->state_lock, in mlx5e_qid_from_qos()
47 bool is_ptp = MLX5E_GET_PFLAG(&chs->params, MLX5E_PFLAG_TX_PORT_TS); in mlx5e_qid_from_qos()
49 return (chs->params.num_channels + is_ptp) * mlx5e_get_dcb_num_tc(&chs->params) + qid; in mlx5e_qid_from_qos()
56 struct mlx5e_params *params = &priv->channels.params; in mlx5e_get_qos_sq()
61 ix = qid % params->num_channels; in mlx5e_get_qos_sq()
62 qid /= params->num_channels; in mlx5e_get_qos_sq()
[all …]
H A Dreporter_tx.c1 /* SPDX-License-Identifier: GPL-2.0 */
24 struct mlx5_core_dev *dev = sq->mdev; in mlx5e_wait_for_sq_flush()
30 if (sq->cc == sq->pc) in mlx5e_wait_for_sq_flush()
36 netdev_err(sq->netdev, in mlx5e_wait_for_sq_flush()
38 sq->sqn, sq->cc, sq->pc); in mlx5e_wait_for_sq_flush()
40 return -ETIMEDOUT; in mlx5e_wait_for_sq_flush()
45 WARN_ONCE(sq->cc != sq->pc, in mlx5e_reset_txqsq_cc_pc()
47 sq->sqn, sq->cc, sq->pc); in mlx5e_reset_txqsq_cc_pc()
48 sq->cc = 0; in mlx5e_reset_txqsq_cc_pc()
49 sq->dma_fifo_cc = 0; in mlx5e_reset_txqsq_cc_pc()
[all …]
/openbmc/linux/drivers/net/xen-netback/
H A Drx.c3 * Copyright (c) 2002-2005, K A Fraser
48 needed = DIV_ROUND_UP(skb->len, XEN_PAGE_SIZE); in xenvif_update_needed_slots()
51 if (skb->sw_hash) in xenvif_update_needed_slots()
55 WRITE_ONCE(queue->rx_slots_needed, needed); in xenvif_update_needed_slots()
63 needed = READ_ONCE(queue->rx_slots_needed); in xenvif_rx_ring_slots_available()
68 prod = queue->rx.sring->req_prod; in xenvif_rx_ring_slots_available()
69 cons = queue->rx.req_cons; in xenvif_rx_ring_slots_available()
71 if (prod - cons >= needed) in xenvif_rx_ring_slots_available()
74 queue->rx.sring->req_event = prod + 1; in xenvif_rx_ring_slots_available()
80 } while (queue->rx.sring->req_prod != prod); in xenvif_rx_ring_slots_available()
[all …]
/openbmc/linux/drivers/net/wireless/intel/iwlwifi/queue/
H A Dtx.c1 // SPDX-License-Identifier: GPL-2.0 OR BSD-3-Clause
3 * Copyright (C) 2020-2023 Intel Corporation
8 #include "iwl-debug.h"
9 #include "iwl-io.h"
15 #include "iwl-fh.h"
16 #include "iwl-scd.h"
20 * iwl_txq_update_byte_tbl - Set up entry in Tx byte-count array
23 struct iwl_txq *txq, u16 byte_cnt, in iwl_pcie_gen2_update_byte_tbl() argument
26 int idx = iwl_txq_get_cmd_index(txq, txq->write_ptr); in iwl_pcie_gen2_update_byte_tbl()
31 if (WARN(idx >= txq->n_window, "%d >= %d\n", idx, txq->n_window)) in iwl_pcie_gen2_update_byte_tbl()
[all …]
/openbmc/linux/drivers/net/ethernet/qlogic/qede/
H A Dqede_fp.c1 // SPDX-License-Identifier: (GPL-2.0-only OR BSD-3-Clause)
3 * Copyright (c) 2015-2017 QLogic Corporation
4 * Copyright (c) 2019-2020 Marvell International Ltd.
34 /* In case lazy-allocation is allowed, postpone allocation until the in qede_alloc_rx_buffer()
38 if (allow_lazy && likely(rxq->filled_buffers > 12)) { in qede_alloc_rx_buffer()
39 rxq->filled_buffers--; in qede_alloc_rx_buffer()
45 return -ENOMEM; in qede_alloc_rx_buffer()
50 mapping = dma_map_page(rxq->dev, data, 0, in qede_alloc_rx_buffer()
51 PAGE_SIZE, rxq->data_direction); in qede_alloc_rx_buffer()
52 if (unlikely(dma_mapping_error(rxq->dev, mapping))) { in qede_alloc_rx_buffer()
[all …]
/openbmc/linux/drivers/net/ethernet/freescale/
H A Dfec_main.c1 // SPDX-License-Identifier: GPL-2.0+
17 * Copyright (c) 2001-2005 Greg Ungerer (gerg@snapgear.com)
20 * Copyright (c) 2004-2006 Macq Electronique SA.
22 * Copyright (C) 2010-2011 Freescale Semiconductor, Inc.
190 .name = "imx25-fec",
193 .name = "imx27-fec",
196 .name = "imx28-fec",
199 .name = "imx6q-fe
352 IS_TSO_HEADER(txq,addr) global() argument
378 fec_enet_get_free_txdesc_num(struct fec_enet_priv_tx_q * txq) fec_enet_get_free_txdesc_num() argument
401 struct fec_enet_priv_tx_q *txq; fec_dump() local
490 fec_enet_txq_submit_frag_skb(struct fec_enet_priv_tx_q * txq,struct sk_buff * skb,struct net_device * ndev) fec_enet_txq_submit_frag_skb() argument
578 fec_enet_txq_submit_skb(struct fec_enet_priv_tx_q * txq,struct sk_buff * skb,struct net_device * ndev) fec_enet_txq_submit_skb() argument
704 fec_enet_txq_put_data_tso(struct fec_enet_priv_tx_q * txq,struct sk_buff * skb,struct net_device * ndev,struct bufdesc * bdp,int index,char * data,int size,bool last_tcp,bool is_last) fec_enet_txq_put_data_tso() argument
764 fec_enet_txq_put_hdr_tso(struct fec_enet_priv_tx_q * txq,struct sk_buff * skb,struct net_device * ndev,struct bufdesc * bdp,int index) fec_enet_txq_put_hdr_tso() argument
817 fec_enet_txq_submit_tso(struct fec_enet_priv_tx_q * txq,struct sk_buff * skb,struct net_device * ndev) fec_enet_txq_submit_tso() argument
907 struct fec_enet_priv_tx_q *txq; fec_enet_start_xmit() local
934 struct fec_enet_priv_tx_q *txq; fec_enet_bd_init() local
1022 struct fec_enet_priv_tx_q *txq; fec_enet_enable_ring() local
1417 struct fec_enet_priv_tx_q *txq; fec_enet_tx_queue() local
3277 struct fec_enet_priv_tx_q *txq; fec_enet_free_buffers() local
3326 struct fec_enet_priv_tx_q *txq; fec_enet_free_queue() local
3348 struct fec_enet_priv_tx_q *txq; fec_enet_alloc_queue() local
3447 struct fec_enet_priv_tx_q *txq; fec_enet_alloc_txq_buffers() local
3811 fec_enet_txq_xmit_frame(struct fec_enet_private * fep,struct fec_enet_priv_tx_q * txq,void * frame,u32 dma_sync_len,bool ndo_xmit) fec_enet_txq_xmit_frame() argument
3905 struct fec_enet_priv_tx_q *txq; fec_enet_xdp_tx_xmit() local
3930 struct fec_enet_priv_tx_q *txq; fec_enet_xdp_xmit() local
4085 struct fec_enet_priv_tx_q *txq = fep->tx_queue[i]; fec_enet_init() local
[all...]
/openbmc/linux/drivers/net/ethernet/atheros/atl1c/
H A Datl1c_main.c1 // SPDX-License-Identifier: GPL-2.0-or-later
3 * Copyright(c) 2008 - 2009 Atheros Corporation. All rights reserved.
6 * Copyright(c) 1999 - 2005 Intel Corporation. All rights reserved.
14 * atl1c_pci_tbl - PCI Device ID Table
98 if (hw->nic_type == athr_l1c || hw->nic_type == athr_l2c) { in atl1c_pcie_patch()
108 if (hw->nic_type == athr_l2c_b && hw->revision_id == L2CB_V10) { in atl1c_pcie_patch()
121 if (hw->nic_type == athr_l2c_b || hw->nic_type == athr_l1d) { in atl1c_pcie_patch()
133 * atl1c_init_pcie - init PCIE module
139 struct pci_dev *pdev = hw->adapter->pdev; in atl1c_reset_pcie()
153 /* wol sts read-clear */ in atl1c_reset_pcie()
[all …]
/openbmc/linux/drivers/net/wireless/intel/iwlegacy/
H A D4965-mac.c1 // SPDX-License-Identifier: GPL-2.0-only
4 * Copyright(c) 2003 - 2011 Intel Corporation. All rights reserved.
11 * Intel Corporation, 5200 N.E. Elam Young Parkway, Hillsboro, OR 97124-6497
22 #include <linux/dma-mapping.h>
71 if (!test_bit(S_EXIT_PENDING, &il->status)) in il4965_check_abort_status()
72 queue_work(il->workqueue, &il->tx_flush); in il4965_check_abort_status()
89 spin_lock_irqsave(&rxq->lock, flags); in il4965_rx_queue_reset()
90 INIT_LIST_HEAD(&rxq->rx_free); in il4965_rx_queue_reset()
91 INIT_LIST_HEAD(&rxq->rx_used); in il4965_rx_queue_reset()
96 if (rxq->pool[i].page != NULL) { in il4965_rx_queue_reset()
[all …]
/openbmc/linux/drivers/net/ethernet/broadcom/genet/
H A Dbcmgenet.c1 // SPDX-License-Identifier: GPL-2.0-only
5 * Copyright (c) 2014-2024 Broadcom
23 #include <linux/dma-mapping.h>
51 (TOTAL_DESC - priv->hw_params->rx_queues * priv->hw_params->rx_bds_per_q)
53 (TOTAL_DESC - priv->hw_params->tx_queues * priv->hw_params->tx_bds_per_q)
59 #define WORDS_PER_BD(p) (p->hw_params->words_per_bd)
62 #define GENET_TDMA_REG_OFF (priv->hw_params->tdma_offset + \
65 #define GENET_RDMA_REG_OFF (priv->hw_params->rdma_offset + \
74 * peripheral registers for CPU-native byte order. in bcmgenet_writel()
104 * the platform is explicitly configured for 64-bits/LPAE. in dmadesc_set_addr()
[all …]

12345