ardupilot/libraries
Andrew Tridgell 4c977eb7a0 HAL_ChibiOS: prevent long timeouts in DShot
this prevents bad calculated timeouts in DShot. The timeout would
sometimes come out as 0xFFFFFFFF, which led to an assert and could
block the thread

This fix is meant to be minimilistic to allow it to be merged easily
into 4.2. A better fix would fix all the uint32_t wrap handling in
DShot
2022-04-05 17:46:52 +10:00
..
AC_AttitudeControl AC_AttitudeControl: added set_lean_angle_max_cd() 2022-03-18 13:36:16 +11:00
AC_AutoTune AC_Autotune: clean up variable init for dwell 2022-03-29 08:05:41 +09:00
AC_Autorotation AC_Autorotation: use accel_to_angle() 2022-03-18 13:36:16 +11:00
AC_Avoidance AC_Avoid: enable slide behaviour for rover 2022-03-30 15:34:14 +09:00
AC_Fence AC_Fence: include cleanups 2022-03-01 11:21:33 +11:00
AC_InputManager AC_InputManager: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AC_PID AC_PID: tradheli-change param name from _VFF to _FF 2022-02-04 08:03:38 +09:00
AC_PrecLand AC_PrecLand: include cleanups 2022-03-01 11:21:33 +11:00
AC_Sprayer
AC_WPNav AC_WPNav: use angle/accel functions 2022-03-18 13:36:16 +11:00
APM_Control AR_PosControl: fixup logging to record desired and target velocity and acceleration 2022-03-30 15:34:14 +09:00
AP_ADC
AP_ADSB AP_ADSB: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AHRS AP_AHRS: subtract accel bias from correct ins accel instance 2022-04-03 11:41:09 +10:00
AP_AIS AP_AIS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AccelCal AP_AccelCal: remove unused calc_mean_squared_residuals 2022-01-26 12:03:17 +09:00
AP_AdvancedFailsafe
AP_Airspeed AP_Airspeed: correct metadata for params for non-Plane vehicles 2022-04-05 09:58:10 +10:00
AP_Arming AP_Arming: setup for terrain adjustment on arming 2022-03-28 16:01:21 +11:00
AP_Avoidance AP_Avoidance: tidy construction of vector on stack 2022-02-01 19:40:22 +11:00
AP_BLHeli AP_BLHeli: add reboot required to some parameters 2022-03-24 11:20:09 +09:00
AP_Baro AP_Baro: create and use HAL_SIM_BARO_ENABLED 2022-03-17 14:39:55 +11:00
AP_BattMonitor AP_BattMonitor: fixed battery remaining of sum battery 2022-03-23 20:21:38 +11:00
AP_Beacon AP_Beacon: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_BoardConfig AP_BoardConfig: add WHOAMI for INV42688 2022-03-20 07:23:10 -07:00
AP_Button AP_Button: include cleanups 2022-03-01 11:21:33 +11:00
AP_CANManager AP_CANManager: correct parameter metadata error 2022-03-14 08:18:13 +11:00
AP_Camera AP_Camera: include cleanups 2022-03-01 11:21:33 +11:00
AP_Common AP_Common: improved accuracy of get_bearing() 2022-03-10 07:34:20 +11:00
AP_Compass AP_Compass: split AP_HAL_SITL and AP_SIM_ENABLED 2022-03-17 14:39:55 +11:00
AP_CustomRotations add AP_CustomRotations 2022-03-02 18:16:42 +11:00
AP_DAL AP_DAL: prevent logical loop between AHRS and EKF 2022-02-07 14:13:49 +11:00
AP_Declination AP_Declination: ensure indexing into declination tables is always correct 2022-03-15 10:15:22 +11:00
AP_Devo_Telem AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_EFI AP_EFI: include cleanups 2022-03-01 11:21:33 +11:00
AP_ESC_Telem AP_ESC_Telem: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_ExternalAHRS AP_ExternalAHRS: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_FETtecOneWire AP_FETtecOneWire: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_Filesystem AP_Filesystem: AP_Filesystem_ESP32 allow_absolute_paths in ::open() 2022-04-05 08:40:26 +10:00
AP_FlashIface AP_FlashIface: Fixed could be used unintialized 2022-03-15 11:44:20 +11:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow AP_Follow: added APIs for plane ship landing 2022-03-10 07:34:20 +11:00
AP_Frsky_Telem AP_Frsky_Telem: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_GPS AP_GPS: rearrange send-text for consistency 2022-03-27 06:21:20 -07:00
AP_Generator AP_Generator: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Gripper AP_Gripper: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_GyroFFT AP_GyroFFT: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_HAL AP_HAL: update prescaler tests 2022-03-30 17:11:09 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: prevent long timeouts in DShot 2022-04-05 17:46:52 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: partitions.csv - increase app partition to 3M 2022-04-05 08:41:11 +10:00
AP_HAL_Empty AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
AP_HAL_Linux AP_HAL:RPI read cpu by revision 2022-03-24 00:51:27 -07:00
AP_HAL_SITL AP_HAL_SITL: correct disable channel maths 2022-03-29 10:29:31 +11:00
AP_Hott_Telem AP_Hott_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_ICEngine AP_ICEngine: include cleanups 2022-03-01 11:21:33 +11:00
AP_IOMCU AP_IOMCU: fixed handling of RC_OPTIONS bit to ignore RC failsafe bit 2022-03-22 10:30:35 +11:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_InertialNav AP_InertialNav: nfc, fix to say relative to EKF origin 2022-02-03 12:05:12 +09:00
AP_InertialSensor AP_InertialSensor: correct compilation with HAL_INS_ACCELCAL_ENABLED false 2022-03-22 10:39:44 +11:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: update_waypoint wrap added to nav_bearing 2022-02-16 18:29:48 +11:00
AP_LTM_Telem AP_LTM_Telem: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Landing AP_Landing: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_LandingGear AP_LandingGear: add enable param 2021-11-23 11:40:44 +11:00
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: increase stack of log_io thread by 256 2022-04-01 19:56:30 +11:00
AP_MSP AP_MSP: include cleanups 2022-03-01 11:21:33 +11:00
AP_Math AP_Math: added unsigned versions of constrain functions 2022-04-05 17:46:52 +10:00
AP_Menu
AP_Mission AP_Mission: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Module AP_Module: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Motors AP_Motors: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Mount AP_Mount: enable Solo Gimbal only on CubeGreen 2022-03-29 08:24:59 +09:00
AP_NMEA_Output AP_NMEA_Output: use a fixed maximum number of NMEA outputs 2022-02-23 12:36:59 +11:00
AP_NavEKF AP_NavEKF : remove the space around the operator 2022-03-08 09:19:52 +09:00
AP_NavEKF2 AP_NavEKF2: avoid direct use of Location alt field 2022-03-22 10:33:37 +11:00
AP_NavEKF3 AP_NavEKF3: avoid direct use of Location alt field 2022-03-22 10:33:37 +11:00
AP_Navigation
AP_Notify AP_Notify: fixed DroneCAN LEDs on AP_Periph 2022-03-09 07:51:35 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OSD AP_OSD: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_OpticalFlow AP_OpticalFlow: Change division to multiplication 2022-02-01 17:34:40 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: fixed param class conversion code 2022-03-29 10:41:33 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Proximity AP_Proximity: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: added using_uart() method 2022-03-28 17:09:26 +11:00
AP_RCTelemetry AP_RCTelemetry: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_ROMFS
AP_RPM AP_RPM: move RPM sensor logging into AP_RPM 2022-01-11 11:09:26 +11:00
AP_RSSI AP_RSSI: convert floating point divides into multiplys 2022-03-18 15:26:44 +11:00
AP_RTC AP_RTC: fix oldest_acceptable_date to be in micros 2022-02-10 09:22:30 +11:00
AP_Radio AP_Radio: include cleanups 2022-03-01 11:21:33 +11:00
AP_Rally AP_Rally: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_RangeFinder AP_RangeFinder: add build option for Rangefinders 2022-03-08 14:33:38 -08:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo AP_RobotisServo: Move crc16-ibm CRC calculation method to a common class 2022-01-13 09:44:40 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: update simulation state on embedded 2022-03-17 14:39:55 +11:00
AP_Scripting AP_Scripting: remove original aerobatics example to avoid confusion 2022-04-05 10:12:13 +10:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: Add support for High Latency MAVLink protocol 2022-03-03 14:56:15 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Stats
AP_TECS AP_TECS: add reset throttle I function 2021-12-22 18:46:14 +11:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: added logging of terrain correction 2022-03-28 16:01:21 +11:00
AP_Torqeedo AP_Torqeedo: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_ToshibaCAN AP_ToshibaCAN: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_Tuning AP_Tuning: removed controller error messages 2022-02-22 12:23:48 +11:00
AP_UAVCAN AP_UAVCAN: correct array inxexing 2022-03-20 07:32:33 -07:00
AP_Vehicle AP_Vehicle: correct compilation with HAL_INS_ACCELCAL_ENABLED false 2022-03-22 10:39:44 +11:00
AP_VideoTX AP_VideoTX: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_VisualOdom AP_VisualOdom: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Volz_Protocol AP_Volz_Protocol: include cleanups 2022-03-01 11:21:33 +11:00
AP_WheelEncoder AP_WheelEncoder: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Winch AP_Winch: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_WindVane AP_WindVane: include cleanups 2022-03-01 11:21:33 +11:00
AR_Motors AR_Motors: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AR_WPNav AR_WPNav: integrate scurve snap 2022-03-30 15:34:14 +09:00
Filter Filters: HarmonicNotch: remove statment on max number of notches harmonics from parm descripstion 2022-03-25 07:14:06 +11:00
GCS_MAVLink GCS_MAVLink: send GCS voltage to GCS 2022-03-22 11:12:54 +11:00
PID PID: Change from division to multiplication 2022-03-16 18:41:52 +11:00
RC_Channel RC_Channel: rename within_min_dz to in_min_dz for consistency 2022-03-08 11:17:45 +11:00
SITL SITL: don't use adjusted terrain in SITL 2022-03-28 16:01:21 +11:00
SRV_Channel SRV_Channel: don't count disabled channels in mask and setup functions 2022-03-29 10:29:31 +11:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00
doc