ardupilot/libraries
Andrew Tridgell 0ec6210184 HAL_ChibiOS: removed wait on CAN peripheral in H7
these wait busy loops can take a very long time, and end up causing
interrupts to be lost elsewhere in the system, causing lost bytes on
UARTs

We should not have while loops waiting on peripharals like this. If we
do need to wait for a flag to clear then it needs to be done in a low
priority thread, or we need to check for completion in a timer

CAN still seems to work with this change, but needs flight testing
2019-10-06 10:58:07 +11:00
..
AC_AttitudeControl AC_AttitudeControl: Support seperate roll and pitch limits 2019-08-03 12:06:32 +09:00
AC_AutoTune AC_AutoTune: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_Avoidance AC_Avoidance: remove OADatabase check that can never be true 2019-09-10 09:15:56 +10:00
AC_Fence AC_Fence: tidy get_breach_distance 2019-08-08 16:47:41 +09:00
AC_InputManager
AC_PID AC_HELI_PID: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_Sprayer AC_Sprayer: clean headers 2019-02-19 09:16:26 +11:00
AC_WPNav AC_WPNav: integrate OAPathPlanner 2019-08-17 09:42:43 +09:00
APM_Control AR_AttitudeControl: minor comment fixes 2019-08-06 20:00:05 +09:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_AHRS AP_AHRS: fix custom orientation ToRad conversion 2019-10-06 10:58:07 +11:00
AP_AccelCal AP_AccelCal: remove wrapper around send_text 2019-07-30 10:06:42 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: added AFS_MAX_RANGE option 2019-09-12 09:59:17 +10:00
AP_Airspeed AP_Airspeed: examples: var_info is now in GCS_MAVLINK_Parameters 2019-08-14 18:25:43 +10:00
AP_Arming AP_Arming: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_Avoidance AP_Avoidance: stop copying adsb vehicle onto stack in src_id_for_adsb_vehicle 2019-07-16 10:30:55 +10:00
AP_BLHeli AP_BLHeli: fix watchdog resets with telemetry active from non-multirotor motors 2019-10-06 10:58:07 +11:00
AP_Baro AP_Baro: use GET_I2C_DEVICE() for i2c probes 2019-09-04 16:27:47 +10:00
AP_BattMonitor AP_BattMonitor: Detect bad configuration of failsafes 2019-08-26 18:57:59 +01:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BoardConfig AP_BoardConfig: add support for CubeBlackPlus 2019-09-16 12:55:32 +10:00
AP_Buffer
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera AP_Camera: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Common AP_Common: expanding array checks memory before allocating 2019-09-11 06:56:35 +10:00
AP_Compass AP_Compass: fix example by instantiating Baro 2019-09-13 08:54:21 +09:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-03 12:21:29 +10:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_Filesystem AP_Filesystem: build fixes for SITL on macOS 2019-09-09 20:18:00 +10:00
AP_FlashStorage AP_FlashStorage: added support for STM32F1xx 2019-08-27 10:29:56 +10:00
AP_Follow AP_Follow: correct parameter descriptions 2019-05-13 15:34:01 +10:00
AP_Frsky_Telem AP_Frsky_Telem: move FrSky handling to it's own thread 2019-09-05 10:50:17 +10:00
AP_GPS AP_GPS: fixed a bug in handling corrupt u-blox packets 2019-10-01 08:31:20 +10:00
AP_Gripper AP_Gripper: unify singleton naming to _singleton and get_singleton() 2019-02-10 19:09:58 -07:00
AP_HAL AP_HAL: added HAL_MEM_CLASS for amount of memory 2019-10-06 10:58:07 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: removed wait on CAN peripheral in H7 2019-10-06 10:58:07 +11:00
AP_HAL_Empty AP_HAL_Empty: Remove set_stop_pin from AnalogSource 2019-09-04 09:54:50 +10:00
AP_HAL_Linux HAL_Linux: use AP::RC() 2019-09-06 08:51:45 +10:00
AP_HAL_SITL Revert "AP_HAL_SITL: set initial PWM values to a flag value" 2019-09-15 18:26:50 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_IOMCU AP_IOMCU: fix IO fast channel mask 2019-10-01 08:32:03 +10:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_InertialNav AP_InertialNav: Remove unneeded methods 2019-07-16 12:11:42 +09:00
AP_InertialSensor HAL_ChibiOS: fixes from LGTM errors 2019-09-22 21:07:54 +10:00
AP_InternalError AP_InternalError: added error for i2c isr error 2019-08-25 17:12:16 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Fix includes 2019-04-05 20:12:53 +11:00
AP_L1_Control AP_L1_Control: use get_distance_NE instead of location_diff 2019-04-08 08:00:52 -07:00
AP_Landing AP_Landing: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_LandingGear AP_LandingGear: minor format fix 2019-05-11 08:49:40 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: fixed LOG_FILE_DSRMROT with delayed log stop 2019-10-06 10:58:07 +11:00
AP_Math AP_Math: add comment to vector2f::point_on_segment 2019-08-10 12:21:01 +09:00
AP_Menu
AP_Mission Revert "AP_Mission: Better AUTO watchdog restore" 2019-08-27 13:18:12 -06:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: tradheli-make all RSC params part of library 2019-09-13 08:53:54 +09:00
AP_Mount AP_Mount: stop passing serial manager through to init() 2019-08-28 06:55:28 +10:00
AP_NMEA_Output AP_NMEA_Output: new library for writing NMEA to serial ports 2019-05-21 09:41:15 +10:00
AP_NavEKF AP_NavEKF: move logging in from AP_Logger 2019-09-03 09:28:37 +10:00
AP_NavEKF2 AP_NavEKF2: change optimisation from -O3 to -O2 2019-10-02 12:03:47 +10:00
AP_NavEKF3 AP_NavEKF3: change optimisation from -O3 to -O2 2019-10-02 12:03:53 +10:00
AP_Navigation
AP_Notify AP_Notify: added NTZ_BUZZ_VOLUME parameter 2019-09-10 16:22:33 +10:00
AP_OSD AP_OSD: Add autoranging to current and speed displays 2019-09-22 21:11:06 +10:00
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Parachute AP_Parachute: Added time check for sink rate to avoid glitches 2019-04-30 10:04:58 +10:00
AP_Param AP_Param: support @READONLY marker in param files 2019-09-12 10:50:30 +10:00
AP_Proximity AP_Proximity: fixed incorrect use of fabs() 2019-10-06 10:58:07 +11:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: fixed SUMD with 16 channels 2019-09-07 10:02:26 +10:00
AP_ROMFS AP_ROMFS: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_RPM AP_RPM: Added Arduino RPM Sensor Debug Tool 2019-08-20 09:13:09 +10:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: Don't allow RTC times before 2019 2019-09-09 04:43:29 +10:00
AP_Radio AP_Radio: added support for Skyviper 2018 model radios 2019-09-12 14:02:36 +10:00
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RangeFinder AP_RangeFinder: add missing overrides 2019-09-22 21:08:14 +10:00
AP_Relay AP_Relay: add AP::relay() to get relay singleton 2019-07-03 23:59:24 -07:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: cope with high CPU load by stretching loop times 2019-09-22 21:08:34 +10:00
AP_Scripting AP_Scripting: use AP_Filesystem API 2019-08-27 15:40:43 +10:00
AP_SerialManager AP_SerialManager: fixed AP_Periph build 2019-09-06 08:51:45 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: rangefinder no longer takes SerialManager in constructor 2019-07-16 09:29:48 +10:00
AP_Soaring AP_Soaring: move include of logger to .cpp file 2019-07-09 10:57:20 +10:00
AP_SpdHgtControl AP_SpdHgtControl: remove unused includes 2019-07-09 10:57:20 +10:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: prevent rapid changing of pitch limits on landing approach 2019-08-01 11:28:22 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 2018-05-17 15:37:14 +10:00
AP_Terrain AP_Terrain: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_ToshibaCAN AP_ToshibaCAN: constify some local variables 2019-08-14 13:29:14 +09:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: support safety buttons on UAVCAN 2019-09-10 16:22:33 +10:00
AP_Vehicle AP_Vehicle: added AP_Periph vehicle type 2019-08-27 10:29:56 +10:00
AP_VisualOdom AP_VisualOdom: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_Winch AP_Winch: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_WindVane AP_WindVane: rename abs to true wind 2019-09-11 11:22:12 +09:00
AR_WPNav AR_WPNav: add oa_wp_bearing_cd function 2019-08-24 09:05:29 +09:00
Filter Filter: Alter Notch filter formula to remove /0 and allow perfect notch. 2019-09-11 18:41:05 +10:00
GCS_MAVLink GCS_MAVLink: use HAL_MEM_CLASS for status sizes 2019-10-06 10:58:07 +11:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: add fence and value for rover 2019-09-02 11:03:27 +09:00
SITL SITL: added SIM_LOOP_DELAY parameter 2019-09-22 21:08:38 +10:00
SRV_Channel SRV_Channel: add neopixel as an output type 2019-09-10 13:03:28 +10:00
StorageManager StorageManager: enable use of a single storage region 2019-08-27 10:29:56 +10:00
doc