Peter van der Perk
4 years ago
committed by
Daniel Agar
11 changed files with 531 additions and 369 deletions
@ -0,0 +1,59 @@
@@ -0,0 +1,59 @@
|
||||
menuconfig DRIVERS_MAGNETOMETER_AKM |
||||
bool "akm" |
||||
default n |
||||
---help--- |
||||
Enable support for akm |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_BOSCH |
||||
bool "bosch" |
||||
default n |
||||
---help--- |
||||
Enable support for bosch |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_HMC5883 |
||||
bool "hmc5883" |
||||
default n |
||||
---help--- |
||||
Enable support for hmc5883 |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_ISENTEK |
||||
bool "isentek" |
||||
default n |
||||
---help--- |
||||
Enable support for isentek |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_LIS2MDL |
||||
bool "lis2mdl" |
||||
default n |
||||
---help--- |
||||
Enable support for lis2mdl |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_LIS3MDL |
||||
bool "lis3mdl" |
||||
default n |
||||
---help--- |
||||
Enable support for lis3mdl |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_LSM303AGR |
||||
bool "lsm303agr" |
||||
default n |
||||
---help--- |
||||
Enable support for lsm303agr |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_LSM9DS1_MAG |
||||
bool "lsm9ds1 mag" |
||||
default n |
||||
---help--- |
||||
Enable support for lsm9ds1 mag |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_QMC5883L |
||||
bool "qmc5883l" |
||||
default n |
||||
---help--- |
||||
Enable support for qmc5883l |
||||
|
||||
menuconfig DRIVERS_MAGNETOMETER_RM3100 |
||||
bool "rm3100" |
||||
default n |
||||
---help--- |
||||
Enable support for rm3100 |
@ -0,0 +1,23 @@
@@ -0,0 +1,23 @@
|
||||
menuconfig DRIVERS_OPTICAL_FLOW_PAW3902 |
||||
bool "paw3902" |
||||
default n |
||||
---help--- |
||||
Enable support for paw3902 |
||||
|
||||
menuconfig DRIVERS_OPTICAL_FLOW_PMW3901 |
||||
bool "pmw3901" |
||||
default n |
||||
---help--- |
||||
Enable support for pmw3901 |
||||
|
||||
menuconfig DRIVERS_OPTICAL_FLOW_PX4FLOW |
||||
bool "px4flow" |
||||
default n |
||||
---help--- |
||||
Enable support for px4flow |
||||
|
||||
menuconfig DRIVERS_OPTICAL_FLOW_THONEFLOW |
||||
bool "thoneflow" |
||||
default n |
||||
---help--- |
||||
Enable support for thoneflow |
@ -0,0 +1,11 @@
@@ -0,0 +1,11 @@
|
||||
menuconfig DRIVERS_POWER_MONITOR_INA226 |
||||
bool "ina226" |
||||
default n |
||||
---help--- |
||||
Enable support for ina226 |
||||
|
||||
menuconfig DRIVERS_POWER_MONITOR_VOXLPM |
||||
bool "voxlpm" |
||||
default n |
||||
---help--- |
||||
Enable support for voxlpm |
@ -0,0 +1,77 @@
@@ -0,0 +1,77 @@
|
||||
menuconfig EXAMPLES_DYN_HELLO |
||||
bool "dyn hello" |
||||
default n |
||||
---help--- |
||||
Enable support for dyn hello |
||||
|
||||
menuconfig EXAMPLES_FAKE_GPS |
||||
bool "fake gps" |
||||
default n |
||||
---help--- |
||||
Enable support for fake gps |
||||
|
||||
menuconfig EXAMPLES_FAKE_GYRO |
||||
bool "fake gyro" |
||||
default n |
||||
---help--- |
||||
Enable support for fake gyro |
||||
|
||||
menuconfig EXAMPLES_FAKE_MAGNETOMETER |
||||
bool "fake magnetometer" |
||||
default n |
||||
---help--- |
||||
Enable support for fake magnetometer |
||||
|
||||
menuconfig EXAMPLES_FIXEDWING_CONTROL |
||||
bool "fixedwing control" |
||||
default n |
||||
---help--- |
||||
Enable support for fixedwing control |
||||
|
||||
menuconfig EXAMPLES_HELLO |
||||
bool "hello" |
||||
default n |
||||
---help--- |
||||
Enable support for hello |
||||
|
||||
menuconfig EXAMPLES_HWTEST |
||||
bool "hwtest" |
||||
default n |
||||
---help--- |
||||
Enable support for hwtest |
||||
|
||||
menuconfig EXAMPLES_MATLAB_CSV_SERIAL |
||||
bool "matlab csv serial" |
||||
default n |
||||
---help--- |
||||
Enable support for matlab csv serial |
||||
|
||||
menuconfig EXAMPLES_PX4_MAVLINK_DEBUG |
||||
bool "px4 mavlink debug" |
||||
default n |
||||
---help--- |
||||
Enable support for px4 mavlink debug |
||||
|
||||
menuconfig EXAMPLES_PX4_SIMPLE_APP |
||||
bool "px4 simple app" |
||||
default n |
||||
---help--- |
||||
Enable support for px4 simple app |
||||
|
||||
menuconfig EXAMPLES_ROVER_STEERING_CONTROL |
||||
bool "rover steering control" |
||||
default n |
||||
---help--- |
||||
Enable support for rover steering control |
||||
|
||||
menuconfig EXAMPLES_UUV_EXAMPLE_APP |
||||
bool "uuv example app" |
||||
default n |
||||
---help--- |
||||
Enable support for uuv example app |
||||
|
||||
menuconfig EXAMPLES_WORK_ITEM |
||||
bool "work item" |
||||
default n |
||||
---help--- |
||||
Enable support for work item |
@ -1,245 +1,245 @@
@@ -1,245 +1,245 @@
|
||||
menuconfig AIRSHIP_ATT_CONTROL |
||||
bool "airship att control Support" |
||||
menuconfig MODULES_AIRSHIP_ATT_CONTROL |
||||
bool "airship att control" |
||||
default n |
||||
---help--- |
||||
Enable support for airship att control |
||||
|
||||
menuconfig AIRSPEED_SELECTOR |
||||
bool "airspeed selector Support" |
||||
menuconfig MODULES_AIRSPEED_SELECTOR |
||||
bool "airspeed selector" |
||||
default n |
||||
---help--- |
||||
Enable support for airspeed selector |
||||
|
||||
menuconfig ANGULAR_VELOCITY_CONTROLLER |
||||
bool "angular velocity controller Support" |
||||
menuconfig MODULES_ANGULAR_VELOCITY_CONTROLLER |
||||
bool "angular velocity controller" |
||||
default n |
||||
---help--- |
||||
Enable support for angular velocity controller |
||||
|
||||
menuconfig ATTITUDE_ESTIMATOR_Q |
||||
bool "attitude estimator q Support" |
||||
menuconfig MODULES_ATTITUDE_ESTIMATOR_Q |
||||
bool "attitude estimator q" |
||||
default n |
||||
---help--- |
||||
Enable support for attitude estimator q |
||||
|
||||
menuconfig BATTERY_STATUS |
||||
bool "battery status Support" |
||||
menuconfig MODULES_BATTERY_STATUS |
||||
bool "battery status" |
||||
default n |
||||
---help--- |
||||
Enable support for battery status |
||||
|
||||
menuconfig CAMERA_FEEDBACK |
||||
bool "camera feedback Support" |
||||
menuconfig MODULES_CAMERA_FEEDBACK |
||||
bool "camera feedback" |
||||
default n |
||||
---help--- |
||||
Enable support for camera feedback |
||||
|
||||
menuconfig COMMANDER |
||||
bool "commander Support" |
||||
menuconfig MODULES_COMMANDER |
||||
bool "commander" |
||||
default n |
||||
---help--- |
||||
Enable support for commander |
||||
|
||||
menuconfig CONTROL_ALLOCATOR |
||||
bool "control allocator Support" |
||||
menuconfig MODULES_CONTROL_ALLOCATOR |
||||
bool "control allocator" |
||||
default n |
||||
---help--- |
||||
Enable support for control allocator |
||||
|
||||
menuconfig DATAMAN |
||||
bool "dataman Support" |
||||
menuconfig MODULES_DATAMAN |
||||
bool "dataman" |
||||
default n |
||||
---help--- |
||||
Enable support for dataman |
||||
|
||||
menuconfig EKF2 |
||||
bool "ekf2 Support" |
||||
menuconfig MODULES_EKF2 |
||||
bool "ekf2" |
||||
default n |
||||
---help--- |
||||
Enable support for ekf2 |
||||
|
||||
menuconfig ESC_BATTERY |
||||
bool "esc battery Support" |
||||
menuconfig MODULES_ESC_BATTERY |
||||
bool "esc battery" |
||||
default n |
||||
---help--- |
||||
Enable support for esc battery |
||||
|
||||
menuconfig EVENTS |
||||
bool "events Support" |
||||
menuconfig MODULES_EVENTS |
||||
bool "events" |
||||
default n |
||||
---help--- |
||||
Enable support for events |
||||
|
||||
menuconfig FLIGHT_MODE_MANAGER |
||||
bool "flight mode manager Support" |
||||
menuconfig MODULES_FLIGHT_MODE_MANAGER |
||||
bool "flight mode manager" |
||||
default n |
||||
---help--- |
||||
Enable support for flight mode manager |
||||
|
||||
menuconfig FW_ATT_CONTROL |
||||
bool "fw att control Support" |
||||
menuconfig MODULES_FW_ATT_CONTROL |
||||
bool "fw att control" |
||||
default n |
||||
---help--- |
||||
Enable support for fw att control |
||||
|
||||
menuconfig FW_POS_CONTROL_L1 |
||||
bool "fw pos control l1 Support" |
||||
menuconfig MODULES_FW_POS_CONTROL_L1 |
||||
bool "fw pos control l1" |
||||
default n |
||||
---help--- |
||||
Enable support for fw pos control l1 |
||||
|
||||
menuconfig GYRO_FFT |
||||
bool "gyro fft Support" |
||||
menuconfig MODULES_GYRO_FFT |
||||
bool "gyro fft" |
||||
default n |
||||
---help--- |
||||
Enable support for gyro fft |
||||
|
||||
menuconfig LAND_DETECTOR |
||||
bool "land detector Support" |
||||
menuconfig MODULES_LAND_DETECTOR |
||||
bool "land detector" |
||||
default n |
||||
---help--- |
||||
Enable support for land detector |
||||
|
||||
menuconfig LANDING_TARGET_ESTIMATOR |
||||
bool "landing target estimator Support" |
||||
menuconfig MODULES_LANDING_TARGET_ESTIMATOR |
||||
bool "landing target estimator" |
||||
default n |
||||
---help--- |
||||
Enable support for landing target estimator |
||||
|
||||
menuconfig LOAD_MON |
||||
bool "load mon Support" |
||||
menuconfig MODULES_LOAD_MON |
||||
bool "load mon" |
||||
default n |
||||
---help--- |
||||
Enable support for load mon |
||||
|
||||
menuconfig LOCAL_POSITION_ESTIMATOR |
||||
bool "local position estimator Support" |
||||
menuconfig MODULES_LOCAL_POSITION_ESTIMATOR |
||||
bool "local position estimator" |
||||
default n |
||||
---help--- |
||||
Enable support for local position estimator |
||||
|
||||
menuconfig LOGGER |
||||
bool "logger Support" |
||||
menuconfig MODULES_LOGGER |
||||
bool "logger" |
||||
default n |
||||
---help--- |
||||
Enable support for logger |
||||
|
||||
menuconfig MAVLINK |
||||
bool "mavlink Support" |
||||
menuconfig MODULES_MAVLINK |
||||
bool "mavlink" |
||||
default n |
||||
---help--- |
||||
Enable support for mavlink |
||||
|
||||
menuconfig MC_ATT_CONTROL |
||||
bool "mc att control Support" |
||||
menuconfig MODULES_MC_ATT_CONTROL |
||||
bool "mc att control" |
||||
default n |
||||
---help--- |
||||
Enable support for mc att control |
||||
|
||||
menuconfig MC_HOVER_THRUST_ESTIMATOR |
||||
bool "mc hover thrust estimator Support" |
||||
menuconfig MODULES_MC_HOVER_THRUST_ESTIMATOR |
||||
bool "mc hover thrust estimator" |
||||
default n |
||||
---help--- |
||||
Enable support for mc hover thrust estimator |
||||
|
||||
menuconfig MC_POS_CONTROL |
||||
bool "mc pos control Support" |
||||
menuconfig MODULES_MC_POS_CONTROL |
||||
bool "mc pos control" |
||||
default n |
||||
---help--- |
||||
Enable support for mc pos control |
||||
|
||||
menuconfig MC_RATE_CONTROL |
||||
bool "mc rate control Support" |
||||
menuconfig MODULES_MC_RATE_CONTROL |
||||
bool "mc rate control" |
||||
default n |
||||
---help--- |
||||
Enable support for mc rate control |
||||
|
||||
menuconfig MICRORTPS_BRIDGE |
||||
bool "micrortps bridge Support" |
||||
menuconfig MODULES_MICRORTPS_BRIDGE |
||||
bool "micrortps bridge" |
||||
default n |
||||
---help--- |
||||
Enable support for micrortps bridge |
||||
|
||||
menuconfig MUORB |
||||
bool "muorb Support" |
||||
menuconfig MODULES_MUORB |
||||
bool "muorb" |
||||
default n |
||||
---help--- |
||||
Enable support for muorb |
||||
|
||||
menuconfig NAVIGATOR |
||||
bool "navigator Support" |
||||
menuconfig MODULES_NAVIGATOR |
||||
bool "navigator" |
||||
default n |
||||
---help--- |
||||
Enable support for navigator |
||||
|
||||
menuconfig PX4IOFIRMWARE |
||||
bool "px4iofirmware Support" |
||||
menuconfig MODULES_PX4IOFIRMWARE |
||||
bool "px4iofirmware" |
||||
default n |
||||
---help--- |
||||
Enable support for px4iofirmware |
||||
|
||||
menuconfig RC_UPDATE |
||||
bool "rc update Support" |
||||
menuconfig MODULES_RC_UPDATE |
||||
bool "rc update" |
||||
default n |
||||
---help--- |
||||
Enable support for rc update |
||||
|
||||
menuconfig REPLAY |
||||
bool "replay Support" |
||||
menuconfig MODULES_REPLAY |
||||
bool "replay" |
||||
default n |
||||
---help--- |
||||
Enable support for replay |
||||
|
||||
menuconfig ROVER_POS_CONTROL |
||||
bool "rover pos control Support" |
||||
menuconfig MODULES_ROVER_POS_CONTROL |
||||
bool "rover pos control" |
||||
default n |
||||
---help--- |
||||
Enable support for rover pos control |
||||
|
||||
menuconfig SENSORS |
||||
bool "sensors Support" |
||||
menuconfig MODULES_SENSORS |
||||
bool "sensors" |
||||
default n |
||||
---help--- |
||||
Enable support for sensors |
||||
|
||||
menuconfig SIH |
||||
bool "sih Support" |
||||
menuconfig MODULES_SIH |
||||
bool "sih" |
||||
default n |
||||
---help--- |
||||
Enable support for sih |
||||
|
||||
menuconfig SIMULATOR |
||||
bool "simulator Support" |
||||
menuconfig MODULES_SIMULATOR |
||||
bool "simulator" |
||||
default n |
||||
---help--- |
||||
Enable support for simulator |
||||
|
||||
menuconfig TEMPERATURE_COMPENSATION |
||||
bool "temperature compensation Support" |
||||
menuconfig MODULES_TEMPERATURE_COMPENSATION |
||||
bool "temperature compensation" |
||||
default n |
||||
---help--- |
||||
Enable support for temperature compensation |
||||
|
||||
menuconfig UUV_ATT_CONTROL |
||||
bool "uuv att control Support" |
||||
menuconfig MODULES_UUV_ATT_CONTROL |
||||
bool "uuv att control" |
||||
default n |
||||
---help--- |
||||
Enable support for uuv att control |
||||
|
||||
menuconfig UUV_POS_CONTROL |
||||
bool "uuv pos control Support" |
||||
menuconfig MODULES_UUV_POS_CONTROL |
||||
bool "uuv pos control" |
||||
default n |
||||
---help--- |
||||
Enable support for uuv pos control |
||||
|
||||
menuconfig VMOUNT |
||||
bool "vmount Support" |
||||
menuconfig MODULES_VMOUNT |
||||
bool "vmount" |
||||
default n |
||||
---help--- |
||||
Enable support for vmount |
||||
|
||||
menuconfig VTOL_ATT_CONTROL |
||||
bool "vtol att control Support" |
||||
menuconfig MODULES_VTOL_ATT_CONTROL |
||||
bool "vtol att control" |
||||
default n |
||||
---help--- |
||||
Enable support for vtol att control |
||||
|
@ -1,203 +1,203 @@
@@ -1,203 +1,203 @@
|
||||
menuconfig BL_UPDATE |
||||
bool "bl update Support" |
||||
menuconfig SYSTEMCMDS_BL_UPDATE |
||||
bool "bl update" |
||||
default n |
||||
---help--- |
||||
Enable support for bl update |
||||
|
||||
menuconfig DMESG |
||||
bool "dmesg Support" |
||||
menuconfig SYSTEMCMDS_DMESG |
||||
bool "dmesg" |
||||
default n |
||||
---help--- |
||||
Enable support for dmesg |
||||
|
||||
menuconfig DUMPFILE |
||||
bool "dumpfile Support" |
||||
menuconfig SYSTEMCMDS_DUMPFILE |
||||
bool "dumpfile" |
||||
default n |
||||
---help--- |
||||
Enable support for dumpfile |
||||
|
||||
menuconfig DYN |
||||
bool "dyn Support" |
||||
menuconfig SYSTEMCMDS_DYN |
||||
bool "dyn" |
||||
default n |
||||
---help--- |
||||
Enable support for dyn |
||||
|
||||
menuconfig ESC_CALIB |
||||
bool "esc calib Support" |
||||
menuconfig SYSTEMCMDS_ESC_CALIB |
||||
bool "esc calib" |
||||
default n |
||||
---help--- |
||||
Enable support for esc calib |
||||
|
||||
menuconfig FAILURE |
||||
bool "failure Support" |
||||
menuconfig SYSTEMCMDS_FAILURE |
||||
bool "failure" |
||||
default n |
||||
---help--- |
||||
Enable support for failure |
||||
|
||||
menuconfig GPIO |
||||
bool "gpio Support" |
||||
menuconfig SYSTEMCMDS_GPIO |
||||
bool "gpio" |
||||
default n |
||||
---help--- |
||||
Enable support for gpio |
||||
|
||||
menuconfig HARDFAULT_LOG |
||||
bool "hardfault log Support" |
||||
menuconfig SYSTEMCMDS_HARDFAULT_LOG |
||||
bool "hardfault log" |
||||
default n |
||||
---help--- |
||||
Enable support for hardfault log |
||||
|
||||
menuconfig I2CDETECT |
||||
bool "i2cdetect Support" |
||||
menuconfig SYSTEMCMDS_I2CDETECT |
||||
bool "i2cdetect" |
||||
default n |
||||
---help--- |
||||
Enable support for i2cdetect |
||||
|
||||
menuconfig LED_CONTROL |
||||
bool "led control Support" |
||||
menuconfig SYSTEMCMDS_LED_CONTROL |
||||
bool "led control" |
||||
default n |
||||
---help--- |
||||
Enable support for led control |
||||
|
||||
menuconfig MFT |
||||
bool "mft Support" |
||||
menuconfig SYSTEMCMDS_MFT |
||||
bool "mft" |
||||
default n |
||||
---help--- |
||||
Enable support for mft |
||||
|
||||
menuconfig MIXER |
||||
bool "mixer Support" |
||||
menuconfig SYSTEMCMDS_MIXER |
||||
bool "mixer" |
||||
default n |
||||
---help--- |
||||
Enable support for mixer |
||||
|
||||
menuconfig MOTOR_RAMP |
||||
bool "motor ramp Support" |
||||
menuconfig SYSTEMCMDS_MOTOR_RAMP |
||||
bool "motor ramp" |
||||
default n |
||||
---help--- |
||||
Enable support for motor ramp |
||||
|
||||
menuconfig MOTOR_TEST |
||||
bool "motor test Support" |
||||
menuconfig SYSTEMCMDS_MOTOR_TEST |
||||
bool "motor test" |
||||
default n |
||||
---help--- |
||||
Enable support for motor test |
||||
|
||||
menuconfig MTD |
||||
bool "mtd Support" |
||||
menuconfig SYSTEMCMDS_MTD |
||||
bool "mtd" |
||||
default n |
||||
---help--- |
||||
Enable support for mtd |
||||
|
||||
menuconfig NETMAN |
||||
bool "netman Support" |
||||
menuconfig SYSTEMCMDS_NETMAN |
||||
bool "netman" |
||||
default n |
||||
---help--- |
||||
Enable support for netman |
||||
|
||||
menuconfig NSHTERM |
||||
bool "nshterm Support" |
||||
menuconfig SYSTEMCMDS_NSHTERM |
||||
bool "nshterm" |
||||
default n |
||||
---help--- |
||||
Enable support for nshterm |
||||
|
||||
menuconfig PARAM |
||||
bool "param Support" |
||||
menuconfig SYSTEMCMDS_PARAM |
||||
bool "param" |
||||
default n |
||||
---help--- |
||||
Enable support for param |
||||
|
||||
menuconfig PERF |
||||
bool "perf Support" |
||||
menuconfig SYSTEMCMDS_PERF |
||||
bool "perf" |
||||
default n |
||||
---help--- |
||||
Enable support for perf |
||||
|
||||
menuconfig PWM |
||||
bool "pwm Support" |
||||
menuconfig SYSTEMCMDS_PWM |
||||
bool "pwm" |
||||
default n |
||||
---help--- |
||||
Enable support for pwm |
||||
|
||||
menuconfig REBOOT |
||||
bool "reboot Support" |
||||
menuconfig SYSTEMCMDS_REBOOT |
||||
bool "reboot" |
||||
default n |
||||
---help--- |
||||
Enable support for reboot |
||||
|
||||
menuconfig REFLECT |
||||
bool "reflect Support" |
||||
menuconfig SYSTEMCMDS_REFLECT |
||||
bool "reflect" |
||||
default n |
||||
---help--- |
||||
Enable support for reflect |
||||
|
||||
menuconfig SD_BENCH |
||||
bool "sd bench Support" |
||||
menuconfig SYSTEMCMDS_SD_BENCH |
||||
bool "sd bench" |
||||
default n |
||||
---help--- |
||||
Enable support for sd bench |
||||
|
||||
menuconfig SERIAL_TEST |
||||
bool "serial test Support" |
||||
menuconfig SYSTEMCMDS_SERIAL_TEST |
||||
bool "serial test" |
||||
default n |
||||
---help--- |
||||
Enable support for serial test |
||||
|
||||
menuconfig SHUTDOWN |
||||
bool "shutdown Support" |
||||
menuconfig SYSTEMCMDS_SHUTDOWN |
||||
bool "shutdown" |
||||
default n |
||||
---help--- |
||||
Enable support for shutdown |
||||
|
||||
menuconfig SYSTEM_TIME |
||||
bool "system time Support" |
||||
menuconfig SYSTEMCMDS_SYSTEM_TIME |
||||
bool "system time" |
||||
default n |
||||
---help--- |
||||
Enable support for system time |
||||
|
||||
menuconfig TESTS |
||||
bool "tests Support" |
||||
menuconfig SYSTEMCMDS_TESTS |
||||
bool "tests" |
||||
default n |
||||
---help--- |
||||
Enable support for tests |
||||
|
||||
menuconfig TOP |
||||
bool "top Support" |
||||
menuconfig SYSTEMCMDS_TOP |
||||
bool "top" |
||||
default n |
||||
---help--- |
||||
Enable support for top |
||||
|
||||
menuconfig TOPIC_LISTENER |
||||
bool "topic listener Support" |
||||
menuconfig SYSTEMCMDS_TOPIC_LISTENER |
||||
bool "topic listener" |
||||
default n |
||||
---help--- |
||||
Enable support for topic listener |
||||
|
||||
menuconfig TUNE_CONTROL |
||||
bool "tune control Support" |
||||
menuconfig SYSTEMCMDS_TUNE_CONTROL |
||||
bool "tune control" |
||||
default n |
||||
---help--- |
||||
Enable support for tune control |
||||
|
||||
menuconfig UORB |
||||
bool "uorb Support" |
||||
menuconfig SYSTEMCMDS_UORB |
||||
bool "uorb" |
||||
default n |
||||
---help--- |
||||
Enable support for uorb |
||||
|
||||
menuconfig USB_CONNECTED |
||||
bool "usb connected Support" |
||||
menuconfig SYSTEMCMDS_USB_CONNECTED |
||||
bool "usb connected" |
||||
default n |
||||
---help--- |
||||
Enable support for usb connected |
||||
|
||||
menuconfig VER |
||||
bool "ver Support" |
||||
menuconfig SYSTEMCMDS_VER |
||||
bool "ver" |
||||
default n |
||||
---help--- |
||||
Enable support for ver |
||||
|
||||
menuconfig WORK_QUEUE |
||||
bool "work queue Support" |
||||
menuconfig SYSTEMCMDS_WORK_QUEUE |
||||
bool "work queue" |
||||
default n |
||||
---help--- |
||||
Enable support for work queue |
||||
|
Loading…
Reference in new issue