/Linux-v6.1/Documentation/devicetree/bindings/crypto/ |
D | st,stm32-hash.yaml | 1 # SPDX-License-Identifier: (GPL-2.0-only OR BSD-2-Clause) 3 --- 4 $id: http://devicetree.org/schemas/crypto/st,stm32-hash.yaml# 5 $schema: http://devicetree.org/meta-schemas/core.yaml# 10 - Lionel Debieve <lionel.debieve@foss.st.com> 15 - st,stm32f456-hash 16 - st,stm32f756-hash 33 dma-names: 35 - const: in 37 dma-maxburst: [all …]
|
/Linux-v6.1/drivers/dma/ |
D | uniphier-xdmac.c | 1 // SPDX-License-Identifier: GPL-2.0 3 * External DMA controller driver for UniPhier SoCs 18 #include "virt-dma.h" 115 /* xc->vc.lock must be held by caller */ 121 vd = vchan_next_desc(&xc->vc); in uniphier_xdmac_next_desc() 125 list_del(&vd->node); in uniphier_xdmac_next_desc() 130 /* xc->vc.lock must be held by caller */ 140 src_addr = xd->nodes[xd->cur_node].src; in uniphier_xdmac_chan_start() 141 dst_addr = xd->nodes[xd->cur_node].dst; in uniphier_xdmac_chan_start() 142 its = xd->nodes[xd->cur_node].burst_size; in uniphier_xdmac_chan_start() [all …]
|
D | idma64.c | 1 // SPDX-License-Identifier: GPL-2.0-only 3 * Core driver for the Intel integrated DMA 64-bit 12 #include <linux/dma-mapping.h> 19 #include <linux/dma/idma64.h> 26 /* ---------------------------------------------------------------------- */ 30 return &chan->dev->device; in chan2dev() 33 /* ---------------------------------------------------------------------- */ 41 channel_clear_bit(idma64, MASK(XFER), idma64->all_chan_mask); in idma64_off() 42 channel_clear_bit(idma64, MASK(BLOCK), idma64->all_chan_mask); in idma64_off() 43 channel_clear_bit(idma64, MASK(SRC_TRAN), idma64->all_chan_mask); in idma64_off() [all …]
|
D | at_hdmac_regs.h | 1 /* SPDX-License-Identifier: GPL-2.0-or-later */ 3 * Header file for the Atmel AHB DMA Controller driver 14 #define AT_DMA_IF_BIGEND(i) (0x1 << (i)) /* AHB-Lite Interface i in Big-endian mode */ 79 #define ATC_DSCR_IF(i) (0x3 & (i)) /* Dsc feched via AHB-Lite Interface i */ 118 #define ATC_SIF(i) (0x3 & (i)) /* Src tx done via AHB-Lite Interface i */ 119 #define ATC_DIF(i) ((0x3 & (i)) << 4) /* Dst tx done via AHB-Lite Interface i */ 124 #define ATC_SRC_PIP (0x1 << 8) /* Source Picture-in-Picture enabled */ 125 #define ATC_DST_PIP (0x1 << 12) /* Destination Picture-in-Picture enabled */ 129 #define ATC_FC_MEM2MEM (0x0 << 21) /* Mem-to-Mem (DMA) */ 130 #define ATC_FC_MEM2PER (0x1 << 21) /* Mem-to-Periph (DMA) */ [all …]
|
D | pxa_dma.c | 1 // SPDX-License-Identifier: GPL-2.0-only 11 #include <linux/dma-mapping.h> 22 #include <linux/dma/pxa-dma.h> 25 #include "virt-dma.h" 36 #define PXA_DCSR_NODESC BIT(30) /* No-Descriptor Fetch (read / write) */ 38 #define PXA_DCSR_REQPEND BIT(8) /* Request Pending (read-only) */ 39 #define PXA_DCSR_STOPSTATE BIT(3) /* Stop State (read-only) */ 64 #define PXA_DCMD_ENDIAN BIT(18) /* Device Endian-ness. */ 71 #define PXA_DCMD_LENGTH 0x01fff /* length mask (max = 8K - 1) */ 74 #define PDMA_MAX_DESC_BYTES (PXA_DCMD_LENGTH & ~((1 << PDMA_ALIGNMENT) - 1)) [all …]
|
D | k3dma.c | 1 // SPDX-License-Identifier: GPL-2.0-only 3 * Copyright (c) 2013 - 2015 Linaro Ltd. 8 #include <linux/dma-mapping.h> 23 #include "virt-dma.h" 25 #define DRIVER_NAME "k3-dma" 139 val = readl_relaxed(phy->base + CX_CFG); in k3_dma_pause_dma() 141 writel_relaxed(val, phy->base + CX_CFG); in k3_dma_pause_dma() 143 val = readl_relaxed(phy->base + CX_CFG); in k3_dma_pause_dma() 145 writel_relaxed(val, phy->base + CX_CFG); in k3_dma_pause_dma() 155 val = 0x1 << phy->idx; in k3_dma_terminate_chan() [all …]
|
D | mmp_pdma.c | 1 // SPDX-License-Identifier: GPL-2.0-only 11 #include <linux/dma-mapping.h> 33 #define DCSR_NODESC BIT(30) /* No-Descriptor Fetch (read / write) */ 35 #define DCSR_REQPEND BIT(8) /* Request Pending (read-only) */ 36 #define DCSR_STOPSTATE BIT(3) /* Stop State (read-only) */ 62 #define DCMD_ENDIAN BIT(18) /* Device Endian-ness. */ 69 #define DCMD_LENGTH 0x01fff /* length mask (max = 8K - 1) */ 146 u32 reg = (phy->idx << 4) + DDADR; in set_desc() 148 writel(addr, phy->base + reg); in set_desc() 155 if (!phy->vchan) in enable_chan() [all …]
|
D | sa11x0-dma.c | 1 // SPDX-License-Identifier: GPL-2.0-only 6 * Derived in part from arch/arm/mach-sa1100/dma.c, 20 #include "virt-dma.h" 89 /* protected by c->vc.lock */ 93 /* protected by d->lock */ 107 /* Protected by c->vc.lock */ 138 struct virt_dma_desc *vd = vchan_next_desc(&c->vc); in sa11x0_dma_next_desc() 150 list_del(&txd->vd.node); in sa11x0_dma_start_desc() 151 p->txd_load = txd; in sa11x0_dma_start_desc() 152 p->sg_load = 0; in sa11x0_dma_start_desc() [all …]
|
D | dma-jz4780.c | 1 // SPDX-License-Identifier: GPL-2.0-or-later 3 * Ingenic JZ4780 DMA controller 6 * Author: Alex Smith <alex@alex-smith.me.uk> 11 #include <linux/dma-mapping.h> 22 #include "virt-dma.h" 38 /* Per-channel registers. */ 99 * struct jz4780_dma_hwdesc - descriptor structure read by the DMA controller. 180 return container_of(jzchan->vchan.chan.device, struct jz4780_dma_dev, in jz4780_dma_chan_parent() 187 return readl(jzdma->chn_base + reg + JZ_DMA_REG_CHAN(chn)); in jz4780_dma_chn_readl() 193 writel(val, jzdma->chn_base + reg + JZ_DMA_REG_CHAN(chn)); in jz4780_dma_chn_writel() [all …]
|
D | st_fdma.c | 1 // SPDX-License-Identifier: GPL-2.0-or-later 3 * DMA driver for STMicroelectronics STi FDMA controller 34 struct st_fdma_dev *fdev = fchan->fdev; in st_fdma_dreq_get() 35 u32 req_line_cfg = fchan->cfg.req_line; in st_fdma_dreq_get() 45 if (fdev->dreq_mask == ~0L) { in st_fdma_dreq_get() 46 dev_err(fdev->dev, "No req lines available\n"); in st_fdma_dreq_get() 47 return -EINVAL; in st_fdma_dreq_get() 51 dev_err(fdev->dev, "Invalid or used req line\n"); in st_fdma_dreq_get() 52 return -EINVAL; in st_fdma_dreq_get() 58 } while (test_and_set_bit(dreq_line, &fdev->dreq_mask)); in st_fdma_dreq_get() [all …]
|
D | amba-pl08x.c | 1 // SPDX-License-Identifier: GPL-2.0-or-later 4 * Copyright (c) 2010 ST-Ericsson SA 14 * PL080 & PL081 both have 16 sets of DMA signals that can be routed to any 18 * has only two channels. So on these DMA controllers the number of channels 19 * and the number of incoming DMA signals are two totally different things. 27 * - CH_CONFIG register at different offset, 28 * - separate CH_CONTROL2 register for transfer size, 29 * - bigger maximum transfer size, 30 * - 8-word aligned LLI, instead of 4-word, due to extra CCTL2 word, 31 * - no support for peripheral flow control. [all …]
|
/Linux-v6.1/sound/soc/pxa/ |
D | pxa2xx-ac97.c | 1 // SPDX-License-Identifier: GPL-2.0-only 3 * linux/sound/pxa2xx-ac97.c -- AC97 support for the Intel PXA2xx chip. 15 #include <linux/dma/pxa-dma.h> 21 #include <sound/pxa2xx-lib.h> 24 #include <linux/platform_data/asoc-pxa.h> 28 #define MCDR 0x0060 /* Mic-in FIFO Data Register */ 66 .maxburst = 32, 72 .maxburst = 32, 78 .maxburst = 16, 84 .maxburst = 16, [all …]
|
/Linux-v6.1/sound/soc/fsl/ |
D | fsl_asrc_dma.c | 1 // SPDX-License-Identifier: GPL-2.0 3 // Freescale ASRC ALSA SoC Platform (DMA) driver 9 #include <linux/dma-mapping.h> 11 #include <linux/dma/imx-dma.h> 37 chan->private = param; in filter() 45 struct snd_pcm_runtime *runtime = substream->runtime; in fsl_asrc_dma_complete() 46 struct fsl_asrc_pair *pair = runtime->private_data; in fsl_asrc_dma_complete() 48 pair->pos += snd_pcm_lib_period_bytes(substream); in fsl_asrc_dma_complete() 49 if (pair->pos >= snd_pcm_lib_buffer_bytes(substream)) in fsl_asrc_dma_complete() 50 pair->pos = 0; in fsl_asrc_dma_complete() [all …]
|
D | imx-pcm-fiq.c | 1 // SPDX-License-Identifier: GPL-2.0+ 2 // imx-pcm-fiq.c -- ALSA Soc Audio Layer 12 #include <linux/dma-mapping.h> 28 #include <linux/platform_data/asoc-imx-ssi.h> 30 #include "imx-ssi.h" 31 #include "imx-pcm.h" 48 struct snd_pcm_substream *substream = iprtd->substream; in snd_hrtimer_callback() 51 if (!atomic_read(&iprtd->playing) && !atomic_read(&iprtd->capturing)) in snd_hrtimer_callback() 56 if (substream->stream == SNDRV_PCM_STREAM_PLAYBACK) in snd_hrtimer_callback() 57 iprtd->offset = regs.ARM_r8 & 0xffff; in snd_hrtimer_callback() [all …]
|
/Linux-v6.1/drivers/usb/gadget/udc/ |
D | mv_u3d_core.c | 1 // SPDX-License-Identifier: GPL-2.0 7 #include <linux/dma-mapping.h> 56 ep = &u3d->eps[i]; in mv_u3d_ep0_reset() 57 ep->u3d = u3d; in mv_u3d_ep0_reset() 60 ep->ep_context = &u3d->ep_context[1]; in mv_u3d_ep0_reset() 65 epxcr = ioread32(&u3d->vuc_regs->epcr[0].epxoutcr0); in mv_u3d_ep0_reset() 67 iowrite32(epxcr, &u3d->vuc_regs->epcr[0].epxoutcr0); in mv_u3d_ep0_reset() 70 iowrite32(epxcr, &u3d->vuc_regs->epcr[0].epxoutcr0); in mv_u3d_ep0_reset() 77 iowrite32(epxcr, &u3d->vuc_regs->epcr[0].epxoutcr1); in mv_u3d_ep0_reset() 80 epxcr = ioread32(&u3d->vuc_regs->epcr[0].epxincr0); in mv_u3d_ep0_reset() [all …]
|
D | trace.h | 1 // SPDX-License-Identifier: GPL-2.0 3 * udc.c - Core UDC Framework 45 __entry->speed = g->speed; 46 __entry->max_speed = g->max_speed; 47 __entry->state = g->state; 48 __entry->mA = g->mA; 49 __entry->sg_supported = g->sg_supported; 50 __entry->is_otg = g->is_otg; 51 __entry->is_a_peripheral = g->is_a_peripheral; 52 __entry->b_hnp_enable = g->b_hnp_enable; [all …]
|
/Linux-v6.1/include/sound/ |
D | dmaengine_pcm.h | 1 /* SPDX-License-Identifier: GPL-2.0+ 4 * Author: Lars-Peter Clausen <lars@metafoo.de> 15 * snd_pcm_substream_to_dma_direction - Get dma_transfer_direction for a PCM 19 * Return: DMA transfer direction 24 if (substream->stream == SNDRV_PCM_STREAM_PLAYBACK) in snd_pcm_substream_to_dma_direction() 49 * The DAI supports packed transfers, eg 2 16-bit samples in a 32-bit word. 51 * the supported sample formats and set the DMA transfer size to undefined. 59 * struct snd_dmaengine_dai_dma_data - DAI DMA configuration data 62 * @maxburst: Maximum number of words(note: words, as in units of the 65 * @filter_data: Custom DMA channel filter data, this will usually be used when [all …]
|
/Linux-v6.1/drivers/dma/dw/ |
D | idma32.c | 1 // SPDX-License-Identifier: GPL-2.0 2 // Copyright (C) 2013,2018,2020-2021 Intel Corporation 38 struct device *slave = dwc->chan.slave; in idma32_get_slave_devfn() 43 return to_pci_dev(slave)->devfn; in idma32_get_slave_devfn() 48 struct dw_dma *dw = to_dw_dma(dwc->chan.device); in idma32_initialize_chan_xbar() 54 /* DMA Channel ID Configuration register must be programmed first */ in idma32_initialize_chan_xbar() 58 value |= dwc->chan.chan_id; in idma32_initialize_chan_xbar() 63 value = readl(misc + DMA_CTL_CH(dwc->chan.chan_id)); in idma32_initialize_chan_xbar() 69 switch (dwc->direction) { in idma32_initialize_chan_xbar() 80 * Memory-to-Memory and Device-to-Device are ignored for now. in idma32_initialize_chan_xbar() [all …]
|
/Linux-v6.1/drivers/usb/cdns3/ |
D | cdns3-trace.h | 1 /* SPDX-License-Identifier: GPL-2.0 */ 6 * Copyright (C) 2018-2019 Cadence. 22 #include "cdns3-gadget.h" 23 #include "cdns3-debug.h" 31 __string(name, ep_priv->name) 36 __assign_str(name, ep_priv->name); 37 __entry->halt = halt; 38 __entry->flush = flush; 40 TP_printk("Halt %s for %s: %s", __entry->flush ? " and flush" : "", 41 __get_str(name), __entry->halt ? "set" : "cleared") [all …]
|
/Linux-v6.1/drivers/spi/ |
D | spi-stm32.c | 1 // SPDX-License-Identifier: GPL-2.0 5 // Copyright (C) 2017, STMicroelectronics - All Rights Reserved 168 * use PIO for small transfers, avoiding DMA setup/teardown overhead for drivers 174 * struct stm32_spi_reg - stm32 SPI register & bitfield desc 186 * struct stm32_spi_regspec - stm32 registers definition, compatible dependent data 188 * @dma_rx_en: SPI DMA RX enable register end SPI DMA RX enable bit 189 * @dma_tx_en: SPI DMA TX enable register end SPI DMA TX enable bit 212 * struct stm32_spi_cfg - stm32 compatible configuration data 225 * using DMA 226 * @dma_rx_cb: routine to call after DMA RX channel operation is complete [all …]
|
/Linux-v6.1/drivers/usb/mtu3/ |
D | mtu3_trace.h | 1 /* SPDX-License-Identifier: GPL-2.0 */ 3 * mtu3_trace.h - trace support 26 __vstring(msg, vaf->fmt, vaf->va) 30 __assign_vstr(msg, vaf->fmt, vaf->va); 42 __entry->intr = intr; 44 TP_printk("(%08x) %s %s %s %s %s %s", __entry->intr, 45 __entry->intr & HOT_RST_INTR ? "HOT_RST" : "", 46 __entry->intr & WARM_RST_INTR ? "WARM_RST" : "", 47 __entry->intr & ENTER_U3_INTR ? "ENT_U3" : "", 48 __entry->intr & EXIT_U3_INTR ? "EXIT_U3" : "", [all …]
|
/Linux-v6.1/sound/core/ |
D | pcm_dmaengine.c | 1 // SPDX-License-Identifier: GPL-2.0-or-later 4 * Author: Lars-Peter Clausen <lars@metafoo.de> 7 * imx-pcm-dma-mx2.c, Copyright 2009 Sascha Hauer <s.hauer@pengutronix.de> 8 * mxs-pcm.c, Copyright (C) 2011 Freescale Semiconductor, Inc. 9 * ep93xx-pcm.c, Copyright (C) 2006 Lennert Buytenhek <buytenh@wantstofly.org> 32 return substream->runtime->private_data; in substream_to_prtd() 39 return prtd->dma_chan; in snd_dmaengine_pcm_get_chan() 44 * snd_hwparams_to_dma_slave_config - Convert hw_params to dma_slave_config 47 * @slave_config: DMA slave config 63 return -EINVAL; in snd_hwparams_to_dma_slave_config() [all …]
|
/Linux-v6.1/drivers/crypto/ |
D | atmel-aes.c | 1 // SPDX-License-Identifier: GPL-2.0 7 * Copyright (c) 2012 Eukréa Electromatique - ATMEL 10 * Some ideas are from omap-aes.c driver. 30 #include <linux/dma-mapping.h> 41 #include "atmel-aes-regs.h" 42 #include "atmel-authenc.h" 265 snprintf(tmp, sz, "KEYWR[%u]", (offset - AES_KEYWR(0)) >> 2); in atmel_aes_reg_name() 272 snprintf(tmp, sz, "IDATAR[%u]", (offset - AES_IDATAR(0)) >> 2); in atmel_aes_reg_name() 279 snprintf(tmp, sz, "ODATAR[%u]", (offset - AES_ODATAR(0)) >> 2); in atmel_aes_reg_name() 286 snprintf(tmp, sz, "IVR[%u]", (offset - AES_IVR(0)) >> 2); in atmel_aes_reg_name() [all …]
|
/Linux-v6.1/arch/powerpc/platforms/512x/ |
D | mpc512x_lpbfifo.c | 1 // SPDX-License-Identifier: GPL-2.0-only 6 * Copyright (C) 2013-2015 Alexander Popov <alex.popov@linux.com>. 21 #include <linux/dma-direction.h> 22 #include <linux/dma-mapping.h> 55 * automatically disables LPBFIFO reading request to the DMA controller 61 * mpc512x_lpbfifo_irq - IRQ handler for LPB FIFO 76 if (!req || req->dir == MPC512X_LPBFIFO_REQ_DIR_READ) { in mpc512x_lpbfifo_irq() 81 status = in_be32(&lpbfifo.regs->status); in mpc512x_lpbfifo_irq() 83 dev_err(dev, "DMA transfer from RAM to peripheral failed\n"); in mpc512x_lpbfifo_irq() 84 out_be32(&lpbfifo.regs->enable, in mpc512x_lpbfifo_irq() [all …]
|
/Linux-v6.1/sound/soc/adi/ |
D | axi-i2s.c | 1 // SPDX-License-Identifier: GPL-2.0-only 3 * Copyright (C) 2012-2013, Analog Devices Inc. 4 * Author: Lars-Peter Clausen <lars@metafoo.de> 63 if (substream->stream == SNDRV_PCM_STREAM_CAPTURE) in axi_i2s_trigger() 80 return -EINVAL; in axi_i2s_trigger() 83 regmap_update_bits(i2s->regmap, AXI_I2S_REG_CTRL, mask, val); in axi_i2s_trigger() 97 word_size = AXI_I2S_BITS_PER_FRAME / 2 - 1; in axi_i2s_hw_params() 98 bclk_div = DIV_ROUND_UP(clk_get_rate(i2s->clk_ref), bclk_rate) / 2 - 1; in axi_i2s_hw_params() 100 regmap_write(i2s->regmap, AXI_I2S_REG_CLK_CTRL, (word_size << 16) | in axi_i2s_hw_params() 113 if (substream->stream == SNDRV_PCM_STREAM_CAPTURE) in axi_i2s_startup() [all …]
|