Home
last modified time | relevance | path

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

12345678910>>...42

/Zephyr-latest/dts/bindings/memory-controllers/
Drenesas,smartbond-nor-psram.yaml2 # SPDX-License-Identifier: Apache-2.0
8 compatible: "renesas,smartbond-nor-psram"
14 is-ram:
19 dev-size:
20 type: int
25 dev-type:
26 type: int
31 dev-density:
32 type: int
40 dev-id:
[all …]
/Zephyr-latest/drivers/sensor/adi/adxl362/
DKconfig1 # ADXL362 Three-Axis Digital Accelerometers
4 # SPDX-License-Identifier: Apache-2.0
13 Enable driver for ADXL362 Three-Axis Digital Accelerometers.
63 prompt "Trigger mode"
74 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ADI_ADXL362),int1-gpios)
80 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ADI_ADXL362),int1-gpios)
98 int "Thread priority"
105 int "Thread stack size"
112 int "Upper threshold value"
116 compared to in activity trigger mode.
[all …]
/Zephyr-latest/dts/bindings/sensor/
Dvishay,vcnl36825t.yaml2 # SPDX-License-Identifier: Apache-2.0
10 include: [sensor-device.yaml, i2c-device.yaml]
13 operation-mode:
18 Mode of operation.
19 - "auto": the sensor performs sampling continuously,
20 - "force": the sampling is performed on every fetch command.
24 Note: "force"-mode only available if low-power mode inactive.
26 measurement-period:
27 type: int
34 - [10, 80] ms only if low power mode is inactive
[all …]
Despressif,esp32-pcnt.yaml2 # SPDX-License-Identifier: Apache-2.0
6 Espressif's Pulse Counter Mode (PCNT) controller Node
14 Each pulse counter unit has a 16-bit signed counter register.
29 Example: Use PCNT to read a rotary-enconder
38 bias-pull-up;
43 Note: Check espressif,esp32-pinctrl.yaml for complete documentation regarding pinctrl.
48 pinctrl-0 = <&pcnt_default>;
49 pinctrl-names = "default";
51 #address-cells = <1>;
52 #size-cells = <0>;
[all …]
/Zephyr-latest/drivers/regulator/
Dregulator_npm1100.c3 * SPDX-License-Identifier: Apache-2.0
12 #include <zephyr/dt-bindings/regulator/npm1100.h>
21 struct gpio_dt_spec mode; member
28 static int regulator_npm1100_set_mode(const struct device *dev, in regulator_npm1100_set_mode()
29 regulator_mode_t mode) in regulator_npm1100_set_mode() argument
31 const struct regulator_npm1100_config *config = dev->config; in regulator_npm1100_set_mode()
33 if ((config->mode.port == NULL) || (mode > NPM1100_MODE_PWM)) { in regulator_npm1100_set_mode()
34 return -ENOTSUP; in regulator_npm1100_set_mode()
37 return gpio_pin_set_dt(&config->mode, in regulator_npm1100_set_mode()
38 mode == NPM1100_MODE_AUTO ? 0 : 1); in regulator_npm1100_set_mode()
[all …]
Dregulator_nxp_vref.c2 * Copyright 2023-2024 NXP
3 * SPDX-License-Identifier: Apache-2.0
11 #include <zephyr/dt-bindings/regulator/nxp_vref.h>
32 static int regulator_nxp_vref_enable(const struct device *dev) in regulator_nxp_vref_enable()
34 const struct regulator_nxp_vref_config *config = dev->config; in regulator_nxp_vref_enable()
35 VREF_Type *const base = config->base; in regulator_nxp_vref_enable()
37 volatile uint32_t *const csr = &base->CSR; in regulator_nxp_vref_enable()
41 k_busy_wait(config->bg_start_time); in regulator_nxp_vref_enable()
57 static int regulator_nxp_vref_disable(const struct device *dev) in regulator_nxp_vref_disable()
59 const struct regulator_nxp_vref_config *config = dev->config; in regulator_nxp_vref_disable()
[all …]
/Zephyr-latest/dts/bindings/counter/
Dnxp,lptmr.yaml2 # SPDX-License-Identifier: Apache-2.0
14 clock-frequency:
22 clk-source:
23 type: int
28 In time counter mode, this field selects the input clock to the prescaler.
29 In pulse counter mode, this field selects the input clock to the glitch filter.
33 input-pin:
34 type: int
36 When LPTMR is in Pulse mode, this value
37 will be used to determine the "rising-edge
[all …]
/Zephyr-latest/tests/subsys/logging/log_msg/src/
Dmain.c4 * SPDX-License-Identifier: Apache-2.0
47 printk("-----------------------printing message--------------------\n"); in print_msg()
50 msg->hdr.desc.package_len, in print_msg()
51 msg->hdr.desc.data_len); in print_msg()
52 for (int i = 0; i < msg->hdr.desc.package_len; i++) { in print_msg()
53 printk("%02x ", msg->data[i]); in print_msg()
56 printk("source: %p\n", msg->hdr.source); in print_msg()
57 printk("timestamp: %d\n", (int)msg->hdr.timestamp); in print_msg()
58 printk("-------------------end of printing message-----------------\n"); in print_msg()
63 int idx;
[all …]
/Zephyr-latest/dts/bindings/input/
Dcirque,pinnacle-common.yaml2 # SPDX-License-Identifier: Apache-2.0
7 data-ready-gpios:
8 type: phandle-array
20 - "1x"
21 - "2x"
22 - "3x"
23 - "4x"
25 data-mode:
29 Data output mode in which position is reported. In the relative mode
31 absolute mode absolute coordinates are reported.
[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 */
17 int zvfs_close(int fd);
18 FILE *zvfs_fdopen(int fd, const char *mode);
19 int zvfs_fileno(FILE *file);
20 int zvfs_open(const char *name, int flags, int mode);
21 ssize_t zvfs_read(int fd, void *buf, size_t sz, size_t *from_offset);
22 ssize_t zvfs_write(int fd, const void *buf, size_t sz, size_t *from_offset);
24 void FD_CLR(int fd, struct zvfs_fd_set *fdset) in FD_CLR()
29 int FD_ISSET(int fd, struct zvfs_fd_set *fdset) in FD_ISSET()
[all …]
/Zephyr-latest/dts/bindings/stepper/adi/
Dadi,trinamic-ramp-generator.yaml1 # SPDX-FileCopyrightText: Copyright (c) 2024 Carl Zeiss Meditec AG
2 # SPDX-License-Identifier: Apache-2.0
4 description: Ramp Generator Motion Control Register-Set for Trinamic stepper controller.
8 type: int
18 type: int
24 type: int
32 type: int
37 for velocity mode.
40 type: int
44 This is the target velocity in velocity mode. It can be changed any time during a motion.
[all …]
/Zephyr-latest/dts/bindings/pwm/
Dnxp,s32-emios-pwm.yaml2 # SPDX-License-Identifier: Apache-2.0
11 - Channel 0 for mode OPWFMB
12 - Channel 1 for mode OPWMB
13 - Channel 2 for mode OPWMCB with deadtime inserted at leading edge
14 - Channel 3 for mode SAIC, use internal timebase with input filter = 2 eMIOS clock
19 pwm-mode = "OPWFMB";
22 duty-cycle = <32768>;
28 master-bus = <&emios1_bus_a>;
29 pwm-mode = "OPWMB";
30 duty-cycle = <32768>;
[all …]
/Zephyr-latest/dts/bindings/regulator/
Dnxp,pca9420.yaml2 # SPDX-License-Identifier: Apache-2.0
34 nxp,enable-modesel-pins:
37 When enabled, the PMIC will be configured to allow mode selection using
40 nxp,vin-ilim-microamp:
41 type: int
44 - 85000
45 - 255000
46 - 425000
47 - 595000
48 - 765000
[all …]
/Zephyr-latest/include/zephyr/retention/
Dbootmode.h4 * SPDX-License-Identifier: Apache-2.0
9 * @brief Public API for boot mode interface
26 * @brief Boot mode interface
27 * @defgroup boot_mode_interface Boot mode interface
36 /** Bootloader boot mode (e.g. serial recovery for MCUboot) */
41 * @brief Checks if the boot mode of the device is set to a specific value.
43 * @param boot_mode Expected boot mode to check.
45 * @retval 1 If successful and boot mode matches.
46 * @retval 0 If boot mode does not match.
47 * @retval -errno Error code code.
[all …]
/Zephyr-latest/drivers/entropy/
DKconfig.smartbond4 # SPDX-License-Identifier: Apache-2.0
18 int "Thread-mode random number pool size"
23 hardware to make them ready for thread mode consumers.
27 int "Thread-mode random number pool low-water threshold"
30 Low water-mark threshold in bytes to trigger entropy generation for
31 thread mode consumers. As soon as the number of available bytes in the
36 int "ISR-mode random number pool size"
45 int "ISR-mode random number pool low-water threshold"
48 Low water-mark threshold in bytes to trigger entropy generation for
/Zephyr-latest/dts/bindings/ethernet/
Dmicrochip,lan865x.yaml2 # SPDX-License-Identifier: Apache-2.0
5 LAN865x standalone 10BASE-T1L Ethernet controller with SPI interface.
9 include: [spi-device.yaml, ethernet-controller.yaml]
12 tx-cut-through-mode:
14 description: Enable TX cut through mode
15 rx-cut-through-mode:
17 description: Enable RX cut through mode
18 plca-enable:
21 plca-node-id:
22 type: int
[all …]
/Zephyr-latest/drivers/gpio/
Dgpio_gecko.c4 * SPDX-License-Identifier: Apache-2.0
41 #define GET_GECKO_GPIO_INDEX(id) (DT_INST_REG_ADDR(id) - DT_REG_ADDR(DT_NODELABEL(gpioa))) \
46 * Macros to set the GPIO MODE registers
48 * See https://www.silabs.com/documents/public/reference-manuals/EFM32WG-RM.pdf
54 * @param[in] mode The mode that should be set.
57 #define GECKO_GPIO_MODEL(pin, mode) (mode << (pin * 4)) argument
62 * @param[in] mode The mode that should be set.
65 #define GECKO_GPIO_MODEH(pin, mode) (mode << ((pin - 8) * 4)) argument
99 data->ports[data->count++] = dev; in gpio_gecko_add_port()
102 static int gpio_gecko_configure(const struct device *dev, in gpio_gecko_configure()
[all …]
/Zephyr-latest/drivers/pinctrl/
Dpinctrl_xmc4xxx.c4 * SPDX-License-Identifier: Apache-2.0
11 #include <zephyr/dt-bindings/pinctrl/xmc4xxx-pinctrl.h>
17 static int pinctrl_configure_pin(const pinctrl_soc_pin_t pinmux) in pinctrl_configure_pin()
19 int port_id, pin, alt_fun, hwctrl; in pinctrl_configure_pin()
25 return -EINVAL; in pinctrl_configure_pin()
31 pin_cfg.mode = XMC_GPIO_MODE_INPUT_PULL_DOWN; in pinctrl_configure_pin()
35 pin_cfg.mode = XMC_GPIO_MODE_INPUT_PULL_UP; in pinctrl_configure_pin()
39 pin_cfg.mode |= 0x4; in pinctrl_configure_pin()
43 pin_cfg.mode = XMC_GPIO_MODE_OUTPUT_OPEN_DRAIN; in pinctrl_configure_pin()
47 pin_cfg.mode = XMC_GPIO_MODE_OUTPUT_PUSH_PULL; in pinctrl_configure_pin()
[all …]
/Zephyr-latest/dts/bindings/comparator/
Dnxp,kinetis-acmp.yaml3 # SPDX-License-Identifier: Apache-2.0
11 compatible = "nxp,kinetis-acmp";
32 pinctrl-0 = <&acmp0_default>;
33 pinctrl-names = "default";
35 positive-mux-input = "IN0";
36 negative-mux-input = "IN1";
39 compatible: "nxp,kinetis-acmp"
42 - base.yaml
43 - pinctrl-device.yaml
52 nxp,enable-output-pin:
[all …]
/Zephyr-latest/drivers/sensor/ti/tmp108/
Dtmp108.c3 * Copyright (c) 2022 T-Mobile USA, Inc.
5 * SPDX-License-Identifier: Apache-2.0
22 int tmp108_reg_read(const struct device *dev, uint8_t reg, uint16_t *val) in tmp108_reg_read()
24 const struct tmp108_config *cfg = dev->config; in tmp108_reg_read()
25 int result; in tmp108_reg_read()
27 result = i2c_burst_read_dt(&cfg->i2c_spec, reg, (uint8_t *) val, 2); in tmp108_reg_read()
38 int tmp108_reg_write(const struct device *dev, uint8_t reg, uint16_t val) in tmp108_reg_write()
40 const struct tmp108_config *cfg = dev->config; in tmp108_reg_write()
42 int result; in tmp108_reg_write()
47 result = i2c_write_dt(&cfg->i2c_spec, tx_buf, sizeof(tx_buf)); in tmp108_reg_write()
[all …]
/Zephyr-latest/drivers/flash/
DKconfig.cadence_nand2 # SPDX-License-Identifier: Apache-2.0
26 prompt "Set the NAND Operating mode"
29 Specify the Operating mode used by the driver.
32 bool "Cadence Nand CDMA Operating Mode"
35 bool "Cadence Nand PIO Operating Mode"
38 bool "Cadence Nand Generic Operating Mode"
43 int "Set the page count for a single transfer in the CDMA Mode"
46 Configure the page count for a single transfer in the CDMA Mode
49 int "Set the block count for a single transfer in the CDMA Mode"
52 Configure the block count for a single transfer in the CDMA Mode
/Zephyr-latest/dts/bindings/i2s/
Dnxp,mcux-i2s.yaml2 # SPDX-License-Identifier: Apache-2.0
4 description: NXP mcux SAI-I2S controller
6 compatible: "nxp,mcux-i2s"
8 include: [i2s-controller.yaml, pinctrl-device.yaml]
17 dma-names:
20 nxp,tx-dma-channel:
21 type: int
25 nxp,rx-dma-channel:
26 type: int
30 nxp,tx-sync-mode:
[all …]
/Zephyr-latest/drivers/led/
Dlp3943.c4 * SPDX-License-Identifier: Apache-2.0
14 * - Blink period and brightness value are controlled by two sets of PSCx/PWMx
62 static int lp3943_get_led_reg(uint32_t *led, uint8_t *reg) in lp3943_get_led_reg()
78 *led -= 4U; in lp3943_get_led_reg()
86 *led -= 8U; in lp3943_get_led_reg()
94 *led -= 12U; in lp3943_get_led_reg()
98 return -EINVAL; in lp3943_get_led_reg()
104 static int lp3943_set_dim_states(const struct lp3943_config *config, in lp3943_set_dim_states()
105 uint32_t led, uint8_t mode) in lp3943_set_dim_states() argument
107 int ret; in lp3943_set_dim_states()
[all …]
/Zephyr-latest/arch/arm/include/cortex_m/
Dcmse.h4 * SPDX-License-Identifier: Apache-2.0
11 * CMSE API for Cortex-M23/M33 CPUs.
40 * Return the non-negative MPU region that the address maps to,
41 * or -EINVAL to indicate that an invalid MPU region was retrieved.
45 * - the function is called from privileged mode
46 * - the MPU is implemented and enabled
47 * - the given address matches a single, enabled MPU region
51 * @return a valid MPU region number or -EINVAL
53 int arm_cmse_mpu_region_get(uint32_t addr);
59 * permissions of the current state MPU and the specified operation mode.
[all …]
/Zephyr-latest/drivers/sensor/st/iis2dh/
DKconfig1 # ST Microelectronics IIS2DH 3-axis accelerometer driver
4 # SPDX-License-Identifier: Apache-2.0
21 prompt "Trigger mode"
31 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_IIS2DH),drdy-gpios)
37 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_IIS2DH),drdy-gpios)
48 int "Thread priority"
55 int "Thread stack size"
64 int "Accelerometer Full-scale range setting"
67 Specify the default accelerometer full-scale range.
70 2: +/- 2g
[all …]

12345678910>>...42