Home
last modified time | relevance | path

Searched +full:port +full:- (Results 1 – 25 of 1096) sorted by relevance

12345678910>>...44

/openbmc/linux/drivers/usb/typec/tcpm/
H A Dtcpm.c1 // SPDX-License-Identifier: GPL-2.0+
3 * Copyright 2015-2017 Google, Inc
206 VDM_STATE_ERR_BUSY = -3,
207 VDM_STATE_ERR_SEND = -2,
208 VDM_STATE_ERR_TMOUT = -1,
236 * Based on "Table 6-14 Fixed Supply PDO - Sink" of "USB Power Delivery Specification Revision 3.0,
275 * @min_volt: Actual min voltage at the local port
276 * @req_min_volt: Requested min voltage to the port partner
277 * @max_volt: Actual max voltage at the local port
278 * @req_max_volt: Requested max voltage to the port partner
[all …]
/openbmc/linux/drivers/tty/
H A Dtty_port.c1 // SPDX-License-Identifier: GPL-2.0
3 * Tty port functions
23 static size_t tty_port_default_receive_buf(struct tty_port *port, const u8 *p, in tty_port_default_receive_buf() argument
29 tty = READ_ONCE(port->itty); in tty_port_default_receive_buf()
44 static void tty_port_default_lookahead_buf(struct tty_port *port, const u8 *p, in tty_port_default_lookahead_buf() argument
50 tty = READ_ONCE(port->itty); in tty_port_default_lookahead_buf()
58 if (ld->ops->lookahead_buf) in tty_port_default_lookahead_buf()
59 ld->ops->lookahead_buf(ld->tty, p, f, count); in tty_port_default_lookahead_buf()
64 static void tty_port_default_wakeup(struct tty_port *port) in tty_port_default_wakeup() argument
66 struct tty_struct *tty = tty_port_tty_get(port); in tty_port_default_wakeup()
[all …]
H A Dvcc.c1 // SPDX-License-Identifier: GPL-2.0
46 /* Microseconds that thread will delay waiting for a vcc port ref */
53 #define VCC_CTL_BREAK -1
54 #define VCC_CTL_HUP -2
108 * vcc_table_add() - Add VCC port to the VCC table
109 * @port: pointer to the VCC port
111 * Return: index of the port in the VCC table on success,
112 * -1 on failure
114 static int vcc_table_add(struct vcc_port *port) in vcc_table_add() argument
122 vcc_table[i] = port; in vcc_table_add()
[all …]
/openbmc/linux/drivers/mmc/core/
H A Dsdio_uart.c1 // SPDX-License-Identifier: GPL-2.0-or-later
14 * Note: Although this driver assumes a 16550A-like UART implementation,
22 * concurrent access to the same port.
65 struct tty_port port; member
87 static int sdio_uart_add_port(struct sdio_uart_port *port) in sdio_uart_add_port() argument
89 int index, ret = -EBUSY; in sdio_uart_add_port()
91 mutex_init(&port->func_lock); in sdio_uart_add_port()
92 spin_lock_init(&port->write_lock); in sdio_uart_add_port()
93 if (kfifo_alloc(&port->xmit_fifo, FIFO_SIZE, GFP_KERNEL)) in sdio_uart_add_port()
94 return -ENOMEM; in sdio_uart_add_port()
[all …]
/openbmc/linux/drivers/usb/host/
H A Dxhci-dbgtty.c1 // SPDX-License-Identifier: GPL-2.0
3 * xhci-dbgtty.c - tty glue for xHCI debug capability
16 #include "xhci-dbgcap.h"
24 return dbc->priv; in dbc_to_port()
28 dbc_kfifo_to_req(struct dbc_port *port, char *packet) in dbc_kfifo_to_req() argument
32 len = kfifo_len(&port->port.xmit_fifo); in dbc_kfifo_to_req()
39 if (port->tx_boundary) in dbc_kfifo_to_req()
40 len = min(port->tx_boundary, len); in dbc_kfifo_to_req()
42 len = kfifo_out(&port->port.xmit_fifo, packet, len); in dbc_kfifo_to_req()
44 if (port->tx_boundary) in dbc_kfifo_to_req()
[all …]
/openbmc/linux/drivers/scsi/libsas/
H A Dsas_port.c1 // SPDX-License-Identifier: GPL-2.0
3 * Serial Attached SCSI (SAS) Port class
15 static bool phy_is_wideport_member(struct asd_sas_port *port, struct asd_sas_phy *phy) in phy_is_wideport_member() argument
17 struct sas_ha_struct *sas_ha = phy->ha; in phy_is_wideport_member()
19 if (memcmp(port->attached_sas_addr, phy->attached_sas_addr, in phy_is_wideport_member()
20 SAS_ADDR_SIZE) != 0 || (sas_ha->strict_wide_ports && in phy_is_wideport_member()
21 memcmp(port->sas_addr, phy->sas_addr, SAS_ADDR_SIZE) != 0)) in phy_is_wideport_member()
29 struct asd_sas_port *port = phy->port; in sas_resume_port() local
30 struct sas_ha_struct *sas_ha = phy->ha; in sas_resume_port()
31 struct sas_internal *si = to_sas_internal(sas_ha->shost->transportt); in sas_resume_port()
[all …]
/openbmc/qemu/hw/net/rocker/
H A Drocker_fp.c2 * QEMU rocker switch emulation - front-panel ports
18 #include "qapi/qapi-types-rocker.h"
44 char *fp_port_get_name(FpPort *port) in fp_port_get_name() argument
46 return port->name; in fp_port_get_name()
49 bool fp_port_get_link_up(FpPort *port) in fp_port_get_link_up() argument
51 return !qemu_get_queue(port->nic)->link_down; in fp_port_get_link_up()
54 RockerPort *fp_port_get_info(FpPort *port) in fp_port_get_info() argument
58 value->name = g_strdup(port->name); in fp_port_get_info()
59 value->enabled = port->enabled; in fp_port_get_info()
60 value->link_up = fp_port_get_link_up(port); in fp_port_get_info()
[all …]
/openbmc/linux/drivers/net/bonding/
H A Dbond_3ad.c1 // SPDX-License-Identifier: GPL-2.0-or-later
3 * Copyright(c) 1999 - 2004 Intel Corporation. All rights reserved.
34 /* Port Variables definitions used by the State Machines (43.4.7 in the
49 /* Port Key definitions
52 * --------------------------------------------------------------
53 * Port key | User key (10 bits) | Speed (5 bits) | Duplex|
54 * --------------------------------------------------------------
97 static int ad_lacpdu_send(struct port *port);
98 static int ad_marker_send(struct port *port, struct bond_marker *marker);
99 static void ad_mux_machine(struct port *port, bool *update_slave_arr);
[all …]
/openbmc/linux/drivers/tty/serial/
H A Dmpc52xx_uart.c1 // SPDX-License-Identifier: GPL-2.0
8 * and reading, they may not be updated in-time and a race condition may
25 * Copyright (C) 2004-2006 Sylvain Munaut <tnt@246tNt.com>
52 /* We've been assigned a range on the "Low-density serial ports" major */
61 /* Rem: - We use the read_status_mask as a shadow of
62 * psc->mpc52xx_psc_imr
63 * - It's important that is array is all zero on start as we
75 #define PSC(port) ((struct mpc52xx_psc __iomem *)((port)->membase)) argument
80 static irqreturn_t mpc5xxx_uart_process_int(struct uart_port *port);
87 void (*fifo_init)(struct uart_port *port);
[all …]
H A Dtimbuart.c1 // SPDX-License-Identifier: GPL-2.0
25 struct uart_port port; member
35 static void timbuart_mctrl_check(struct uart_port *port, u32 isr, u32 *ier);
39 static void timbuart_stop_rx(struct uart_port *port) in timbuart_stop_rx() argument
42 u32 ier = ioread32(port->membase + TIMBUART_IER) & ~RXFLAGS; in timbuart_stop_rx()
43 iowrite32(ier, port->membase + TIMBUART_IER); in timbuart_stop_rx()
46 static void timbuart_stop_tx(struct uart_port *port) in timbuart_stop_tx() argument
49 u32 ier = ioread32(port->membase + TIMBUART_IER) & ~TXBAE; in timbuart_stop_tx()
50 iowrite32(ier, port->membase + TIMBUART_IER); in timbuart_stop_tx()
53 static void timbuart_start_tx(struct uart_port *port) in timbuart_start_tx() argument
[all …]
H A Dmilbeaut_usio.c1 // SPDX-License-Identifier: GPL-2.0
15 #define USIO_NAME "mlb-usio-uart"
65 static void mlb_usio_stop_tx(struct uart_port *port) in mlb_usio_stop_tx() argument
67 writew(readw(port->membase + MLB_USIO_REG_FCR) & ~MLB_USIO_FCR_FTIE, in mlb_usio_stop_tx()
68 port->membase + MLB_USIO_REG_FCR); in mlb_usio_stop_tx()
69 writeb(readb(port->membase + MLB_USIO_REG_SCR) & ~MLB_USIO_SCR_TBIE, in mlb_usio_stop_tx()
70 port->membase + MLB_USIO_REG_SCR); in mlb_usio_stop_tx()
73 static void mlb_usio_tx_chars(struct uart_port *port) in mlb_usio_tx_chars() argument
75 struct circ_buf *xmit = &port->state->xmit; in mlb_usio_tx_chars()
78 writew(readw(port->membase + MLB_USIO_REG_FCR) & ~MLB_USIO_FCR_FTIE, in mlb_usio_tx_chars()
[all …]
H A Dmeson_uart.c1 // SPDX-License-Identifier: GPL-2.0
89 static void meson_uart_set_mctrl(struct uart_port *port, unsigned int mctrl) in meson_uart_set_mctrl() argument
93 static unsigned int meson_uart_get_mctrl(struct uart_port *port) in meson_uart_get_mctrl() argument
98 static unsigned int meson_uart_tx_empty(struct uart_port *port) in meson_uart_tx_empty() argument
102 val = readl(port->membase + AML_UART_STATUS); in meson_uart_tx_empty()
107 static void meson_uart_stop_tx(struct uart_port *port) in meson_uart_stop_tx() argument
111 val = readl(port->membase + AML_UART_CONTROL); in meson_uart_stop_tx()
113 writel(val, port->membase + AML_UART_CONTROL); in meson_uart_stop_tx()
116 static void meson_uart_stop_rx(struct uart_port *port) in meson_uart_stop_rx() argument
120 val = readl(port->membase + AML_UART_CONTROL); in meson_uart_stop_rx()
[all …]
H A Dbcm63xx_uart.c1 // SPDX-License-Identifier: GPL-2.0
37 * - rx fifo full
38 * - rx fifo above threshold
39 * - rx fifo not empty for too long
53 * - tx fifo empty
54 * - tx fifo below threshold
73 static inline unsigned int bcm_uart_readl(struct uart_port *port, in bcm_uart_readl() argument
76 return __raw_readl(port->membase + offset); in bcm_uart_readl()
79 static inline void bcm_uart_writel(struct uart_port *port, in bcm_uart_writel() argument
82 __raw_writel(value, port->membase + offset); in bcm_uart_writel()
[all …]
H A Drda-uart.c1 // SPDX-License-Identifier: GPL-2.0+
117 struct uart_port port; member
121 #define to_rda_uart_port(port) container_of(port, struct rda_uart_port, port) argument
125 static inline void rda_uart_write(struct uart_port *port, u32 val, in rda_uart_write() argument
128 writel(val, port->membase + off); in rda_uart_write()
131 static inline u32 rda_uart_read(struct uart_port *port, unsigned int off) in rda_uart_read() argument
133 return readl(port->membase + off); in rda_uart_read()
136 static unsigned int rda_uart_tx_empty(struct uart_port *port) in rda_uart_tx_empty() argument
142 spin_lock_irqsave(&port->lock, flags); in rda_uart_tx_empty()
144 val = rda_uart_read(port, RDA_UART_STATUS); in rda_uart_tx_empty()
[all …]
H A Damba-pl010.c1 // SPDX-License-Identifier: GPL-2.0+
10 * This is a generic driver for ARM AMBA-type serial ports. They
11 * have a lot of 16550-like features, but are not register compatible.
49 * We wrap our port structure around the generic uart_port.
52 struct uart_port port; member
59 static void pl010_stop_tx(struct uart_port *port) in pl010_stop_tx() argument
62 container_of(port, struct uart_amba_port, port); in pl010_stop_tx()
65 cr = readb(uap->port.membase + UART010_CR); in pl010_stop_tx()
67 writel(cr, uap->port.membase + UART010_CR); in pl010_stop_tx()
70 static void pl010_start_tx(struct uart_port *port) in pl010_start_tx() argument
[all …]
H A Dsprd_serial.c1 // SPDX-License-Identifier: GPL-2.0
3 * Copyright (C) 2012-2015 Spreadtrum Communications Inc.
10 #include <linux/dma-mapping.h>
11 #include <linux/dma/sprd-dma.h>
122 struct uart_port port; member
134 static int sprd_start_dma_rx(struct uart_port *port);
135 static int sprd_tx_dma_config(struct uart_port *port);
137 static inline unsigned int serial_in(struct uart_port *port, in serial_in() argument
140 return readl_relaxed(port->membase + offset); in serial_in()
143 static inline void serial_out(struct uart_port *port, unsigned int offset, in serial_out() argument
[all …]
H A Dliteuart.c1 // SPDX-License-Identifier: GPL-2.0
5 * Copyright (C) 2019-2020 Antmicro <www.antmicro.com>
25 * The definitions below are true for LiteX SoC configured for 8-bit CSR Bus,
26 * 32-bit aligned.
46 struct uart_port port; member
51 #define to_liteuart_port(port) container_of(port, struct liteuart_port, port) argument
71 static void liteuart_update_irq_reg(struct uart_port *port, bool set, u8 mask) in liteuart_update_irq_reg() argument
73 struct liteuart_port *uart = to_liteuart_port(port); in liteuart_update_irq_reg()
76 uart->irq_reg |= mask; in liteuart_update_irq_reg()
78 uart->irq_reg &= ~mask; in liteuart_update_irq_reg()
[all …]
/openbmc/linux/drivers/scsi/bfa/
H A Dbfa_port.c1 // SPDX-License-Identifier: GPL-2.0-only
3 * Copyright (c) 2005-2014 Brocade Communications Systems, Inc.
4 * Copyright (c) 2014- QLogic Corporation.
8 * Linux driver for QLogic BR-series Fibre Channel Host Bus Adapter.
18 BFA_TRC_FILE(CNA, PORT);
21 bfa_port_stats_swap(struct bfa_port_s *port, union bfa_port_stats_u *stats) in bfa_port_stats_swap() argument
45 * @param[in] port - Pointer to the port module
46 * status - Return status from the f/w
51 bfa_port_enable_isr(struct bfa_port_s *port, bfa_status_t status) in bfa_port_enable_isr() argument
53 bfa_trc(port, status); in bfa_port_enable_isr()
[all …]
/openbmc/linux/drivers/tty/serial/8250/
H A D8250_core.c1 // SPDX-License-Identifier: GPL-2.0+
3 * Universal/legacy driver for 8250/16550-type serial ports
9 * Supports: ISA-compatible 8250/16550 ports
12 * userspace-configurable "phantom" ports
48 * share_irqs - whether we pass IRQF_SHARED to request_irq(). This option
49 * is unsafe when used on edge-triggered interrupts.
63 * SERIAL_PORT_DFNS tells us about built-in ports that have no
104 * line has been de-asserte
122 struct uart_port *port; serial8250_interrupt() local
304 struct uart_port *port = &up->port; univ8250_setup_timer() local
329 struct uart_port *port = &up->port; univ8250_setup_irq() local
339 struct uart_port *port = &up->port; univ8250_release_irq() local
352 struct uart_port *port = &up->port; serial8250_request_rsa_resource() local
373 struct uart_port *port = &up->port; serial8250_release_rsa_resource() local
417 serial8250_set_isa_configurator(void (* v)(int port,struct uart_port * up,u32 * capabilities)) serial8250_set_isa_configurator() argument
425 univ8250_config_port(struct uart_port * port,int flags) univ8250_config_port() argument
451 univ8250_request_port(struct uart_port * port) univ8250_request_port() argument
466 univ8250_release_port(struct uart_port * port) univ8250_release_port() argument
551 struct uart_port *port = &up->port; serial8250_isa_init_ports() local
606 struct uart_port *port; univ8250_console_setup() local
640 struct uart_port *port; univ8250_console_exit() local
680 struct uart_port *port = &serial8250_ports[i].port; univ8250_console_match() local
742 early_serial_setup(struct uart_port * port) early_serial_setup() argument
787 struct uart_port *port = &up->port; serial8250_suspend_port() local
811 struct uart_port *port = &up->port; serial8250_resume_port() local
950 serial8250_find_match_or_unused(const struct uart_port * port) serial8250_find_match_or_unused() argument
992 struct uart_port *port = &up->port; serial_8250_overrun_backoff_work() local
[all...]
/openbmc/linux/drivers/gpio/
H A Dgpio-mxc.c1 // SPDX-License-Identifier: GPL-2.0+
8 // Copyright (C) 2004-2010 Freescale Semiconductor, Inc. All Rights Reserved.
86 .edge_sel_reg = -EINVAL,
101 .edge_sel_reg = -EINVAL,
123 #define GPIO_DR (port->hwdata->dr_reg)
124 #define GPIO_GDIR (port->hwdata->gdir_reg)
125 #define GPIO_PSR (port->hwdata->psr_reg)
126 #define GPIO_ICR1 (port->hwdata->icr1_reg)
127 #define GPIO_ICR2 (port->hwdata->icr2_reg)
128 #define GPIO_IMR (port->hwdata->imr_reg)
[all …]
/openbmc/linux/drivers/net/wan/
H A Dhd64572.c1 // SPDX-License-Identifier: GPL-2.0-only
3 * Hitachi (now Renesas) SCA-II HD64572 driver for Linux
5 * Copyright (C) 1998-2008 Krzysztof Halasa <khc@pm.waw.pl>
7 * Source of information: HD64572 SCA-II User's Manual
11 * Packet buffer descriptor rings - starting from card->rambase:
17 * Packet data buffers - starting from card->rambase + buff_offset:
44 #define get_msci(port) ((port)->chan ? MSCI1_OFFSET : MSCI0_OFFSET) argument
45 #define get_dmac_rx(port) ((port)->chan ? DMAC1RX_OFFSET : DMAC0RX_OFFSET) argument
46 #define get_dmac_tx(port) ((port)->chan ? DMAC1TX_OFFSET : DMAC0TX_OFFSET) argument
48 #define sca_in(reg, card) readb((card)->scabase + (reg))
[all …]
/openbmc/linux/drivers/usb/gadget/function/
H A Du_serial.c1 // SPDX-License-Identifier: GPL-2.0+
3 * u_serial.c - utilities for USB gadget "serial port"/TTY support
10 * Copyright (C) 1999 - 2002 Greg Kroah-Hartman (greg@kroah.com)
37 * "serial port" functionality through the USB gadget stack. Each such
38 * port is exposed through a /dev/ttyGS* node.
40 * After this module has been loaded, the individual TTY port ca
103 struct tty_port port; global() member
136 struct gs_port *port; global() member
207 gs_send_packet(struct gs_port * port,char * packet,unsigned size) gs_send_packet() argument
230 gs_start_tx(struct gs_port * port) gs_start_tx() argument
302 gs_start_rx(struct gs_port * port) gs_start_rx() argument
363 struct gs_port *port = container_of(w, struct gs_port, push); gs_rx_push() local
455 struct gs_port *port = ep->driver_data; gs_read_complete() local
466 struct gs_port *port = ep->driver_data; gs_write_complete() local
539 gs_start_io(struct gs_port * port) gs_start_io() argument
602 struct gs_port *port; gs_open() local
683 struct gs_port *port = tty->driver_data; gs_close() local
742 struct gs_port *port = tty->driver_data; gs_write() local
761 struct gs_port *port = tty->driver_data; gs_put_char() local
777 struct gs_port *port = tty->driver_data; gs_flush_chars() local
790 struct gs_port *port = tty->driver_data; gs_write_room() local
807 struct gs_port *port = tty->driver_data; gs_chars_in_buffer() local
824 struct gs_port *port = tty->driver_data; gs_unthrottle() local
841 struct gs_port *port = tty->driver_data; gs_break_ctl() local
969 gs_console_connect(struct gs_port * port) gs_console_connect() argument
998 gs_console_disconnect(struct gs_port * port) gs_console_disconnect() argument
1022 gs_console_init(struct gs_port * port) gs_console_init() argument
1061 gs_console_exit(struct gs_port * port) gs_console_exit() argument
1083 struct gs_port *port; gserial_set_console() local
1112 struct gs_port *port; gserial_get_console() local
1131 gs_console_connect(struct gs_port * port) gs_console_connect() argument
1136 gs_console_disconnect(struct gs_port * port) gs_console_disconnect() argument
1140 gs_console_init(struct gs_port * port) gs_console_init() argument
1145 gs_console_exit(struct gs_port * port) gs_console_exit() argument
1154 struct gs_port *port; gs_port_alloc() local
1189 gs_closed(struct gs_port * port) gs_closed() argument
1200 gserial_free_port(struct gs_port * port) gserial_free_port() argument
1212 struct gs_port *port; gserial_free_line() local
1232 struct gs_port *port; gserial_alloc_line_no_console() local
1309 struct gs_port *port; gserial_connect() local
1385 struct gs_port *port = gser->ioport; gserial_disconnect() local
1433 struct gs_port *port; gserial_suspend() local
1454 struct gs_port *port; gserial_resume() local
[all...]
/openbmc/linux/drivers/usb/serial/
H A Dgeneric.c1 // SPDX-License-Identifier: GPL-2.0
5 * Copyright (C) 2010 - 2013 Johan Hovold (jhovold@gmail.com)
6 * Copyright (C) 1999 - 2002 Greg Kroah-Hartman (greg@kroah.com)
40 struct device *dev = &serial->interface->dev; in usb_serial_generic_probe()
42 dev_info(dev, "The \"generic\" usb-serial driver is only for testing and one-off prototypes.\n"); in usb_serial_generic_probe()
43 dev_info(dev, "Tell linux-usb@vger.kernel.org to add your device to a proper driver.\n"); in usb_serial_generic_probe()
51 struct device *dev = &serial->interface->dev; in usb_serial_generic_calc_num_ports()
54 num_ports = max(epds->num_bulk_in, epds->num_bulk_out); in usb_serial_generic_calc_num_ports()
58 return -ENODEV; in usb_serial_generic_calc_num_ports()
106 int usb_serial_generic_open(struct tty_struct *tty, struct usb_serial_port *port) in usb_serial_generic_open() argument
[all …]
/openbmc/linux/drivers/char/
H A Dvirtio_console.c1 // SPDX-License-Identifier: GPL-2.0-or-later
28 #include <linux/dma-mapping.h>
43 /* Used for exporting per-port information to debugfs */
56 .name = "virtio-ports",
67 /* The hvc device associated with this console port */
113 * This is a per-device struct that stores data common to all the
114 * ports for that device (vdev->priv).
144 * guest->host transfers, one for host->guest transfers
149 * A control packet buffer for guest->host requests, protected
154 /* Array of per-port IO virtqueues */
[all …]
/openbmc/linux/drivers/net/ethernet/marvell/mvpp2/
H A Dmvpp2_main.c1 // SPDX-License-Identifier: GPL-2.0
61 static void mvpp2_acpi_start(struct mvpp2_port *port);
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()
124 * - per-thread registers, where each thread has its own copy of the
140 * - global registers that must be accessed through a specific thread
[all …]

12345678910>>...44