ardupilot/libraries
Peter Barker 42c4329d4c RC_Channel: require RC switch position transition for arming
currently if you turn your transmitter on at runtime we may try to arm the vehicle if your arming switches are asserted.

This patch changes things to we don't trust the first position seen from an RC receiver - we must see a transission for the arming options
2024-04-10 21:53:23 +10:00
..
AC_AttitudeControl AC_PosControl: always update yaw targets 2024-03-25 11:03:25 +09:00
AC_AutoTune
AC_Autorotation
AC_Avoidance AC_Avoidance: move AC_Avoidance defines into libraries 2024-03-11 18:07:18 +11:00
AC_CustomControl AC_CustomControl: move include of logging header to cpp file 2024-02-29 20:01:39 +11:00
AC_Fence AC_Fence: allow for fence storage on microSD 2024-03-12 11:43:36 +11:00
AC_InputManager
AC_PID AC_PID: avoid use of uninitialised stack data in example 2024-02-24 08:19:50 +09:00
AC_PrecLand AC_PrecLand: reduce code duplication, move common functionally to the base class 2024-03-20 19:33:14 +11:00
AC_Sprayer
AC_WPNav AC_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
APM_Control APM_Control: move AC_Avoidance defines into libraries 2024-03-11 18:07:18 +11:00
AP_ADC
AP_ADSB AP_ADSB: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_AHRS AP_AHRS: set_origin calls Log_Write_Home_And_Origin on success 2024-04-02 11:00:22 +11:00
AP_AIS
AP_AccelCal
AP_AdvancedFailsafe
AP_Airspeed AP_Airspeed: change a word(NFC) 2024-04-10 14:20:04 +09:00
AP_Arming AP_Arming: do not wait 10 seconds with single gyro/accel 2024-04-02 11:23:01 +11:00
AP_Avoidance
AP_BLHeli AP_BLHeli: fixed define for BLHeli support 2024-03-18 14:12:25 +11:00
AP_Baro Updated identification code per the datasheet 2024-01-23 11:08:33 +11:00
AP_BattMonitor AP_BattMonitor: added MAX_AMPS and SHUNT parameters for INA239 2024-03-12 11:15:10 +11:00
AP_Beacon AP_Beacon: rename GPS_ to GPS1_ 2024-03-19 19:50:12 +11:00
AP_BoardConfig AP_BoardConfig: added BRD_SD_FENCE 2024-03-12 11:43:36 +11:00
AP_Button
AP_CANManager AP_CANManager: correct includes 2024-03-20 18:45:52 +11:00
AP_CSVReader
AP_Camera AP_Camera: support set-camera-source mavlink command 2024-03-25 09:19:18 +09:00
AP_CheckFirmware AP_CheckFirmware: add separate AP_CheckFirmwareDefine for correctly setting firmware versions 2024-02-21 18:54:17 +11:00
AP_Common AP_Common: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_Compass AP_Compass: log Hires magnetic field on DroneCAN 2024-03-16 20:10:35 +11:00
AP_CustomRotations AP_CustomRotations: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_DAL AP_DAL: Standalone: add int8 parameter set_and_default method to avoid include 2024-03-26 11:35:36 +11:00
AP_DDS AP_DDS: Fix incorrect port param name 2024-03-24 11:27:22 +11:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN DroneCAN_sniffer: Use new default for reboot 2024-03-12 21:13:41 +11:00
AP_EFI
AP_ESC_Telem AP_ESC_Telem: move defaulting of HAL_WITH_ESC_TELEM for periph 2024-03-05 12:37:40 +11:00
AP_ExternalAHRS AP_ExternalAHRS: Only use GPS data when populating GPS fields 2024-03-26 11:23:06 +11:00
AP_ExternalControl
AP_FETtecOneWire
AP_Filesystem AP_Filesystem: avoid decompressing in directory listing 2024-03-19 19:49:47 +11:00
AP_FlashIface
AP_FlashStorage
AP_Follow
AP_Frsky_Telem
AP_GPS AP_GPS: copy GPS metadata in for pre-per-instance-parameters 2024-04-10 16:37:35 +09:00
AP_Generator AP_Gernerator: IE 2400: MAV_SEVERITY level depends on error code 2024-03-12 11:05:21 +11:00
AP_Gripper AP_Gripper: move gripper up to AP_Vehicle 2024-02-21 21:05:12 +11:00
AP_GyroFFT AP_GyroFFT: correct compilation when AP_Arming is not compiled in 2024-03-19 07:29:17 +11:00
AP_HAL AP_HAL: Util: add virtual `uart_log` method 2024-04-09 10:00:50 +10:00
AP_HAL_ChibiOS hwdef: the RM3100 should run at max 1MHz on SPI bus 2024-04-10 21:40:51 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: Added missing letter to printf statement 2024-04-03 16:18:02 +09:00
AP_HAL_Empty AP_HAL_Empty: update uart_info function for new signature 2024-04-03 13:10:06 +01:00
AP_HAL_Linux AP_HAL_Linux: delay signal handlers setup 2024-04-05 11:36:29 +11:00
AP_HAL_SITL AP_HAL_SITL: and `uart_log` method and stats struct 2024-04-09 10:00:50 +10:00
AP_Hott_Telem AP_Hott_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_ICEngine AP_ICEngine: correct compilation when ICEngine disabled 2024-02-20 09:16:23 +11:00
AP_IOMCU AP_IOMCU: allow building without BLHeli support 2024-03-18 14:12:25 +11:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Fix parameter name when saving persistent accel cals for Aux IMUs 2024-04-05 11:02:04 +11:00
AP_InternalError
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: made test pass/fail 2024-02-28 19:22:14 +11:00
AP_KDECAN
AP_L1_Control
AP_LTM_Telem AP_LTM_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_Landing AP_Landing: `restart_landing_sequence` get current location and pass it to `get_landing_sequence_start` 2024-04-02 11:11:59 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: add log structures from AP_HAL 2024-04-09 10:00:50 +10:00
AP_MSP AP_MSP: Use scaled RC inputs instead of direct RC in. Also flip pitch to be correct. 2024-03-08 06:54:17 +11:00
AP_Math AP_Math: Add RDS02UF RangeFinder CRC 2024-04-01 16:12:53 +11:00
AP_Menu
AP_Mission AP_Mission: take location in `get_landing_sequence_start`, `jump_to_landing_sequence`, `jump_to_abort_landing_sequence`, and `is_best_land_sequence`, add helpers for scripting 2024-04-02 11:11:59 +11:00
AP_Module AP_Module: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Motors AP_Motors: add new PWM_TYPE_ANGLE 2024-03-18 21:48:55 -03:00
AP_Mount AP_Mount: fix gimbal-device-attitude-status yaw frame flag 2024-03-26 10:49:30 +11:00
AP_NMEA_Output AP_NMEA_Output: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: use set_and_defualt when changing imu mask 2024-03-26 11:35:36 +11:00
AP_NavEKF3 AP_NavEKF3: use set_and_defualt when changing imu mask 2024-03-26 11:35:36 +11:00
AP_Navigation
AP_Networking AP_Networking: change NET_ENABLED to NET_ENABLE 2024-03-20 19:08:31 +11:00
AP_Notify AP_Notify: remove VRBrain board sub-types 2024-03-26 11:06:13 +11:00
AP_OLC
AP_ONVIF
AP_OSD AP_OSD: add extended RC link stats OSD fields 2024-04-02 10:30:24 +11:00
AP_OpenDroneID
AP_OpticalFlow AP_OpticalFlow: correct comments on AP_OpticalFlow methods 2024-01-22 19:14:42 +11:00
AP_Parachute AP_Parachute: do relay conversion if ever enabled 2024-02-07 19:07:29 +11:00
AP_Param AP_Param: move serial_manager parameters up to base class 2024-02-29 12:12:19 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: add RPLidarC1 support 2024-03-20 18:58:57 +11:00
AP_RAMTRON
AP_RCMapper AP_RCMapper: add rcmapper config 2024-02-10 11:47:10 +11:00
AP_RCProtocol AP_RCProtocol: fixed underflow wrap in GHST 2024-04-07 15:23:47 +10:00
AP_RCTelemetry AP_RCTelemetry: add extended RC link stats OSD fields 2024-04-02 10:30:24 +11:00
AP_ROMFS AP_ROMFS: added find_size() 2024-03-19 19:49:47 +11:00
AP_RPM AP_RPM: allow HarmonicNotches to be compiled out of the code 2024-03-19 07:04:13 +11:00
AP_RSSI
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_Radio AP_Radio: correct guards around code in AP_Radio_cc2500 2024-03-26 11:07:42 +11:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RangeFinder AP_RangeFinder: Refactor RDS02UF rangefinder 2024-04-01 16:12:53 +11:00
AP_Relay AP_Relay: added relay output invert function 2024-04-06 10:58:43 +11:00
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: fixed example test to pass/fail 2024-02-28 19:22:14 +11:00
AP_Scripting AP_SCripting: update VTOL QuickTune to allow YAW FLTE = 0 2024-04-09 09:31:42 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: move serial_manager parameters up to base class 2024-02-29 12:12:19 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: convert remaining uses of TRIM_ARSPD_CM to AIRSPEED_CRUISE 2024-01-23 15:00:30 +11:00
AP_Stats AP_Stats: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_TECS AP_TECS: fixed adjusting speed without airspeed sensor 2024-03-03 20:28:38 +11:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: correct compilation when GCS not available 2024-02-16 12:52:04 -08:00
AP_Terrain
AP_Torqeedo AP_Torqeedo: correct compilation with HAL_GCS_ENABLED is false 2024-03-08 11:14:37 +11:00
AP_Tuning
AP_Vehicle AP_Vehicle: call `uart_log` in `one_Hz_update` 2024-04-09 10:00:50 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands(Band X) 2024-03-19 07:30:49 +11:00
AP_VisualOdom AP_VisualOdom: correct unused variable in visualodom 2024-04-10 21:52:28 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: correct compilation when HAL_GCS_ENABLED is false 2024-03-08 10:04:53 +11:00
AP_Winch
AP_WindVane
AR_Motors AP_MotorsUGV: Fix Riscv64 compiler error issue #25974 2024-01-23 08:34:33 +09:00
AR_WPNav AR_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
Filter Filter:correct vehicles which can use throttle based notches 2024-04-08 23:11:03 +01:00
GCS_MAVLink GCS_MAVLink: move handling of DO_SET_HOME up to GCS_MAVLink base class 2024-04-09 09:35:16 +10:00
PID
RC_Channel RC_Channel: require RC switch position transition for arming 2024-04-10 21:53:23 +10:00
SITL tools: change a word(NFC) 2024-04-10 14:20:04 +09:00
SRV_Channel SRV_Channel: add define for SRV_Channels being compiled in or not 2024-03-12 09:10:22 +11:00
StorageManager
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
COLCON_IGNORE