Home
last modified time | relevance | path

Searched +full:offset +full:- +full:mode (Results 1 – 25 of 492) sorted by relevance

12345678910>>...20

/Zephyr-latest/drivers/rtc/
DKconfig.pcf85233 # Copyright (c) 2019-2023 Henrik Brix Andersen <henrik@brixandersen.dk>
4 # SPDX-License-Identifier: Apache-2.0
17 prompt "Offset mode"
21 Offset register mode selection.
26 Offset correction is made once per two hours and then correction pulses are applied once
27 per minute until the programmed correction values have been implemented (MODE = 0).
32 Offset correction is made once per minute and then correction pulses are applied once per
34 used, additional correction pulses are made in the 59th second (MODE = 1).
/Zephyr-latest/subsys/bluetooth/mesh/
Dblob_io_flash.c4 * SPDX-License-Identifier: Apache-2.0
34 return -EINVAL; in test_flash_area()
42 enum bt_mesh_blob_io_mode mode) in io_open() argument
46 flash->mode = mode; in io_open()
48 return flash_area_open(flash->area_id, &flash->area); in io_open()
56 flash_area_close(flash->area); in io_close()
66 if (flash->mode == BT_MESH_BLOB_READ) { in block_start()
75 flash_dev = flash_area_get_device(flash->area); in block_start()
77 return -ENODEV; in block_start()
81 flash->offset + block->offset, &page); in block_start()
[all …]
/Zephyr-latest/lib/posix/options/
Ddevice_io.c4 * SPDX-License-Identifier: Apache-2.0
16 /* prototypes for external, not-yet-public, functions in fdtable.c or fs.c */
18 FILE *zvfs_fdopen(int fd, const char *mode);
20 int zvfs_open(const char *name, int flags, int mode);
52 FILE *fdopen(int fd, const char *mode) in fdopen() argument
54 return zvfs_fdopen(fd, mode); in fdopen()
64 int mode = 0; in open() local
69 mode = va_arg(args, int); in open()
73 return zvfs_open(name, flags, mode); in open()
84 ssize_t pread(int fd, void *buf, size_t count, off_t offset) in pread() argument
[all …]
/Zephyr-latest/dts/bindings/sensor/
Dst,lis2mdl-common.yaml2 # SPDX-License-Identifier: Apache-2.0
4 include: sensor-device.yaml
7 irq-gpios:
8 type: phandle-array
15 single-mode:
18 Set to config the sensor in single measurement mode. Leave
19 unset to configure the sensor in continuous measurement mode.
21 cancel-offset:
24 Set to enable the offset cancellation. Otherwise it would be
/Zephyr-latest/include/zephyr/bluetooth/mesh/
Dblob_io_flash.h4 * SPDX-License-Identifier: Apache-2.0
26 /** Active stream mode. */
27 enum bt_mesh_blob_io_mode mode; member
28 /** Offset into the flash area to place the BLOB at (in bytes). */
29 off_t offset; member
42 * @param offset Offset into the flash area, in bytes.
47 uint8_t area_id, off_t offset);
Dblob.h4 * SPDX-License-Identifier: Apache-2.0
28 /** BLOB transfer mode. */
30 /** No valid transfer mode. */
32 /** Push mode (Push BLOB Transfer Mode). */
34 /** Pull mode (Pull BLOB Transfer Mode). */
85 /** The transfer mode is not supported by the BLOB Transfer Server
101 /** Offset in bytes from the start of the BLOB. */
102 off_t offset; member
114 /** Offset of the chunk data from the start of the block. */
115 off_t offset; member
[all …]
/Zephyr-latest/dts/bindings/pinctrl/
Dti,k3-pinctrl.yaml2 # SPDX-License-Identifier: Apache-2.0
7 Pins can be configured using the following macro "K3_PINMUX(offset, value, mux_mode)".
8 offset - the pin attribute register offset from the base address.
9 value - one of the following:
16 mux_mode - The mux mode for the pin, MUX_MODE_0 -> MUX_MODE_9.
18 The default UART0_RX pin is located at 0x000f41c8 (mux mode 0).
21 compatible: "ti,k3-pinctrl"
29 child-binding:
/Zephyr-latest/tests/net/lib/lwm2m/content_link_format/src/
Dmain.c4 * SPDX-License-Identifier: Apache-2.0
73 attr->type = LWM2M_ATTR_PMIN; in test_attr_init()
74 attr->int_val = TEST_PMIN; in test_attr_init()
75 attr->ref = &test_inst; in test_attr_init()
78 attr->type = LWM2M_ATTR_PMAX; in test_attr_init()
79 attr->int_val = TEST_PMAX; in test_attr_init()
80 attr->ref = &test_res; in test_attr_init()
121 test_packet.offset = sizeof(test_payload); in test_prepare_nomem()
129 test_formatter_data.mode = LINK_FORMAT_MODE_DISCOVERY; in ZTEST()
134 zassert_mem_equal(test_out.out_cpkt->data, expected_payload, in ZTEST()
[all …]
/Zephyr-latest/subsys/bluetooth/services/ots/
Dots_oacp_internal.h4 * SPDX-License-Identifier: Apache-2.0
65 #define BT_GATT_OTS_OACP_PROC_WRITE_MODE_GET_TRUNC(mode) \ argument
66 ((mode) & BIT(BT_GATT_OTS_OACP_PROC_WRITE_MODE_TRUNC))
68 #define BT_GATT_OTS_OACP_PROC_WRITE_MODE_GET_RFU(mode) \ argument
69 ((mode) & ~BIT(BT_GATT_OTS_OACP_PROC_WRITE_MODE_TRUNC))
80 uint32_t offset; member
84 uint32_t offset; member
88 uint32_t offset; member
90 uint8_t mode; member
110 uint16_t offset, uint8_t flags);
/Zephyr-latest/arch/common/
Dsemihost.c5 * SPDX-License-Identifier: Apache-2.0
18 long mode; member
32 long offset; member
62 long semihost_open(const char *path, long mode) in semihost_open() argument
66 .mode = mode, in semihost_open()
91 long semihost_seek(long fd, long offset) in semihost_seek() argument
95 .offset = offset in semihost_seek()
113 ret = -EIO; in semihost_read()
/Zephyr-latest/subsys/bluetooth/controller/
DKconfig.df4 # SPDX-License-Identifier: Apache-2.0
61 This sampling mode is optional for Direction Finding according to
70 mode is optional for Direction Finding according to Bluetooth v5.1.
81 Also known as Angle of Departure mode.
89 Also known as Angle of Arrival mode.
136 direction finding connected mode.
144 finding connected mode.
164 is able to store. For nRF5x-based controllers, the hardware imposes
182 int "Maximum number of transmitted PDUs with Constant Tone Extension in connectionless mode"
192 int "Maximum number of received PDUs with Constant Tone Extension in connectionless mode"
[all …]
/Zephyr-latest/drivers/ethernet/phy/
Dphy_dm8806_priv.h4 * SPDX-License-Identifier: Apache-2.0
17 /* Duplex mode ability offset. */
19 /* Power down mode offset. */
21 /* Auto negotiation mode offset. */
23 /* Link speed selection offset. */
36 /* Speed and duplex mode status offset. */
38 /* Speed and duplex mode staus mask. */
49 /* Address Table Access bussy flag offset */
51 /* Address Table Command Result flag offset */
124 /* Port 5 Force Link control bit. Only available in force mode. */
[all …]
/Zephyr-latest/drivers/ethernet/
Deth_smsc91x_priv.h3 * SPDX-License-Identifier: Apache-2.0
11 /* All Banks, Offset 0xe: Bank Select Register */
17 /* Bank 0, Offset 0x0: Transmit Control Register */
22 /* Bank 0, Offset 0x02: EPH status register */
26 /* Bank 0, Offset 0x4: Receive Control Register */
28 #define RCR_PRMS 0x0002 /* Promiscuous mode */
33 /* Bank0, Offset 0x6: Counter Register */
40 /* Bank 0, Offset 0x8: Memory information register */
45 /* bank 0, offset 0xa: receive/phy control register */
47 #define RPCR_ANEG 0x0800 /* Put PHY in autonegotiation mode */
[all …]
Deth_w5500.c1 /* W5500 Stand-alone Ethernet Controller with SPI
6 * SPDX-License-Identifier: Apache-2.0
40 const struct w5500_config *cfg = dev->config; in w5500_spi_read()
72 ret = spi_transceive_dt(&cfg->spi, &tx, &rx); in w5500_spi_read()
80 const struct w5500_config *cfg = dev->config; in w5500_spi_write()
102 ret = spi_write_dt(&cfg->spi, &tx); in w5500_spi_write()
107 static int w5500_readbuf(const struct device *dev, uint16_t offset, uint8_t *buf, in w5500_readbuf() argument
116 offset %= mem_size; in w5500_readbuf()
117 addr = mem_start + offset; in w5500_readbuf()
119 if (offset + len > mem_size) { in w5500_readbuf()
[all …]
/Zephyr-latest/dts/bindings/display/
Dsitronix,st7735r.yaml1 # Copyright (c) 2020, Kim Bøndergaard <kim@fam-boendergaard.dk>
2 # SPDX-License-Identifier: Apache-2.0
8 include: [mipi-dbi-spi-device.yaml, display-controller.yaml]
11 x-offset:
14 description: The column offset in pixels of the LCD to the controller memory
16 y-offset:
19 description: The row offset in pixels of the LCD to the controller memory
32 type: uint8-array
37 type: uint8-array
42 type: uint8-array
[all …]
Dsolomon,ssd1306fb-common.yaml2 # SPDX-License-Identifier: Apache-2.0
4 include: display-controller.yaml
7 segment-offset:
10 description: 8-bit column start address for Page Addressing Mode
12 page-offset:
15 description: Start address for Page Addressing Mode
17 display-offset:
22 multiplex-ratio:
27 segment-remap:
31 com-invdir:
[all …]
Distech,ist3931.yaml2 # SPDX-License-Identifier: Apache-2.0
8 include: [i2c-device.yaml, display-controller.yaml]
11 reset-gpios:
12 type: phandle-array
21 x-offset:
24 description: The column offset in pixels of the LCD to the controller memory
26 y-offset:
29 description: The row offset in pixels of the LCD to the controller memory
31 voltage-converter:
35 voltage-follower:
[all …]
/Zephyr-latest/tests/bluetooth/mesh/blob_io_flash/src/
Dmain.c4 * SPDX-License-Identifier: Apache-2.0
26 if ((chunk_idx == block->chunk_count - 1) && in chunk_size()
27 (block->size % CHUNK_SIZE)) { in chunk_size()
28 return block->size % CHUNK_SIZE; in chunk_size()
105 /* BLOB Client should do nothing to flash area as it's in read mode */ in ZTEST()
109 /* `block_start` in write mode will erase flash pages that can fit block. in ZTEST()
110 * Assert that at least block size of data was not erased in read mode in ZTEST()
112 flash_area_read(blob_flash_stream.area, block.offset, ctrl_data, block.size); in ZTEST()
113 zassert_mem_equal(ctrl_data, &test_data[block.offset], block.size, in ZTEST()
114 "Flash data was altered by `block_start` in read mode"); in ZTEST()
[all …]
/Zephyr-latest/drivers/flash/
Dflash_ite_it8xxx2.c4 * SPDX-License-Identifier: Apache-2.0
19 #include <zephyr/linker/linker-defs.h>
50 * ILM(ILM -> CPU)instead of flash(flash -> I-Cache -> CPU) if enabled.
98 /* I-Cache tag sram reset */ in ramcode_reset_i_cache()
99 gctrl_regs->GCTRL_MCCR |= IT8XXX2_GCTRL_ICACHE_RESET; in ramcode_reset_i_cache()
100 /* Make sure the I-Cache is reset */ in ramcode_reset_i_cache()
103 gctrl_regs->GCTRL_MCCR &= ~IT8XXX2_GCTRL_ICACHE_RESET; in ramcode_reset_i_cache()
111 * ECINDAR3-0 are EC-indirect memory address registers. in ramcode_flash_follow_mode()
113 * Enter follow mode by writing 0xf to low nibble of ECINDAR3 register, in ramcode_flash_follow_mode()
116 flash_regs->SMFI_ECINDAR3 = (EC_INDIRECT_READ_INTERNAL_FLASH | in ramcode_flash_follow_mode()
[all …]
Dflash_ifx_cat1_qspi.c5 * SPDX-License-Identifier: Apache-2.0
67 /* The 8-bit command. 1 x I/O read command. */
73 /* The 8-bit mode byte. This value is 0xFFFFFFFF when there is no mode present. */
74 .mode = 0xFFFFFFFFU,
75 /* The width of the mode command transfer. */
92 * https://iot-webserver.aus.cypress.com/projects/iot_release/
93 * ASSETS/repo/mtb-pdl-cat1/develop/Latest/deploy/docs/
127 /* Specifies the command to read the QE-containing status register. */
129 /* Specifies the command to read the WIP-containing status register. */
133 /* Specifies the command to write into the QE-containing status register. */
[all …]
/Zephyr-latest/drivers/sensor/st/lis2dh/
DKconfig4 # SPDX-License-Identifier: Apache-2.0
13 Enable SPI/I2C-based driver for LIS2DH, LIS3DH, LSM303DLHC,
19 prompt "Trigger mode"
29 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_LIS2DH),irq-gpios)
35 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_LIS2DH),irq-gpios)
67 bool "+/-2g"
70 bool "+/-4g"
73 bool "+/-8g"
76 bool "+/-16g"
81 prompt "Operation mode"
[all …]
/Zephyr-latest/arch/arm/core/cortex_a_r/
Dexc.S4 * SPDX-License-Identifier: Apache-2.0
9 * @brief Exception handlers for ARM Cortex-A and Cortex-R
12 * abort and data abort) for ARM Cortex-A and Cortex-R processors.
15 * mode stack rather than the system mode stack, in order to ensure predictable
47 .macro exception_entry mode
49 * Store r0-r3, r12, lr, lr_und and spsr_und into the stack to
52 srsdb sp!, #\mode
53 stmfd sp, {r0-r3, r12, lr}^
65 vstmia r2!, {s0-s15}
67 vstmia r2!, {d16-d31}
[all …]
Dvector_table.S5 * SPDX-License-Identifier: Apache-2.0
22 ldr pc, =z_arm_reset /* offset 0 */
23 ldr pc, =z_arm_undef_instruction /* undef instruction offset 4 */
24 ldr pc, =z_arm_svc /* svc offset 8 */
25 ldr pc, =z_arm_prefetch_abort /* prefetch abort offset 0xc */
26 ldr pc, =z_arm_data_abort /* data abort offset 0x10 */
27 nop /* offset 0x14 */
29 ldr pc, =_isr_wrapper /* IRQ offset 0x18 */
34 ldr pc, =z_arm_nmi /* FIQ offset 0x1c */
46 * processor mode set to MODE_SYS.
[all …]
/Zephyr-latest/drivers/lora/
Dsx126x.c5 * SPDX-License-Identifier: Apache-2.0
59 #define MODE(m) [MODE_##m] = #m macro
61 MODE(SLEEP),
62 MODE(STDBY_RC),
63 MODE(STDBY_XOSC),
64 MODE(FS),
65 MODE(TX),
66 MODE(RX),
67 MODE(RX_DC),
68 MODE(CAD),
[all …]
/Zephyr-latest/drivers/eeprom/
Deeprom_mchp_xec.c4 * SPDX-License-Identifier: Apache-2.0
22 /* EEPROM Mode Register */
28 /* EEPROM Execute Register - Transfer size bit position */
31 /* EEPROM Execute Register - Commands */
37 /* EEPROM Execute Register - Address mask */
54 uint32_t mode; member
84 regs->execute = temp; in eeprom_xec_execute_reg_set()
96 *destination_ptr = regs->buffer[count]; in eeprom_xec_data_buffer_read()
112 regs->buffer[count] = *source_ptr; in eeprom_xec_data_buffer_write()
133 sts = XEC_EEPROM_STS_TRANSFER_COMPL & regs->status; in eeprom_xec_wait_transfer_compl()
[all …]

12345678910>>...20