ardupilot/libraries
Andrew Tridgell e471b23f58 HAL_ChibiOS: add a max quota of GPIO interrupts
This implements a max quota of GPIO interrupts per 100ms period to
prevent high interrupt counts from consuming all CPU and causing a
lockup. The limit is set as 10k interrupts per 0.1s period. That limit
should be high enough for all reasonable uses of GPIO interrupt
handlers while being below the level that causes significant CPU loads
and flight issues

This addresses issue #15384
2020-10-02 09:38:24 +10:00
..
AC_AttitudeControl AC_AttitudeControl: revert Add PosControl PID logging 2020-09-12 08:10:33 +09:00
AC_AutoTune AC_AutoTune: set FLTT to zero while twitching 2020-06-30 20:09:48 +10:00
AC_Autorotation AC_Autorotation: remove unused variables 2020-10-01 21:13:20 +10:00
AC_Avoidance AC_Avoid: hide params with enable flag 2020-09-14 08:54:13 +09:00
AC_Fence AC_Fence: remove dead and misleading assignment 2020-08-06 17:02:12 +10:00
AC_InputManager
AC_PID AC_HELI_PID: spelling in comment, leaded -> leaked 2020-09-11 08:39:58 +09:00
AC_PrecLand AC_PrecLand: correct @User field in ACC_P_NSE documentation 2020-09-22 14:56:04 +10:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_Circle: add Circle options 2020-09-30 17:58:12 +10:00
APM_Control APM_Control: replace '@User: User' with '@User: Standard' 2020-09-22 14:56:04 +10:00
AP_ADC
AP_ADSB AP_ADSB: remove unused variables 2020-10-01 21:13:20 +10:00
AP_AHRS AP_AHRS: removed duplicate implementation of airspeed_estimate() 2020-08-27 20:20:51 +10:00
AP_AccelCal
AP_AdvancedFailsafe AP_AdvancedFailsafe: Change the unit of barometric pressure from mbar to hPa. 2020-07-21 09:56:21 +10:00
AP_Airspeed AP_Airspeed: added get_num_sensors() 2020-08-27 20:20:51 +10:00
AP_Arming AP_Arming: arming check for osd menu 2020-09-09 20:36:42 +10:00
AP_Avoidance AP_Avoidance: conditionally compile based on ADSB support 2020-09-22 09:33:51 +10:00
AP_BLHeli AP_BLHeli: added have_telem_data() API 2020-09-02 05:56:46 +10:00
AP_Baro AP_Baro: remove unnecessary debug on DPS280 2020-09-25 08:19:29 +10:00
AP_BattMonitor AP_BattMonitor: create and use new AP_HAL::PWMSource object 2020-09-08 16:10:50 +10:00
AP_Beacon AP_Beacon: fix sitl position to be NED 2020-08-25 09:38:10 +09:00
AP_BoardConfig AP_BoardConfig: disable watchdog in examples 2020-09-26 11:47:46 +10:00
AP_Button
AP_CANManager AP_CANManager: fixed build warning for stack size 2020-09-15 09:40:03 +10:00
AP_Camera AP_Camera: keep trying to initialize RunCam after boot 2020-09-16 18:00:53 +10:00
AP_Common AP_Common: Add missing const in AP_FWVersion variables 2020-09-25 08:55:18 +10:00
AP_Compass AP_Compass: add set_dev_id when initialising HIL 2020-09-30 17:01:37 +10:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ESC_Telem AP_ESC_Telem: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_Filesystem AP_Filesystem: increase tasks buffer size 2020-09-30 17:37:20 +10:00
AP_FlashStorage AP_FlashStorage: fixed alignment errors 2020-07-10 13:31:27 +10:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: reformat new filed using astyle.sh; no history to lose 2020-09-30 23:14:40 +10:00
AP_GPS AP_GPS: fix type and update reserved bytes in ublox PVT 2020-09-28 16:31:14 -07:00
AP_Generator AP_Generator: remove unused variables 2020-10-01 21:13:20 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: reduce locking to avoid contention and match thread priority to IO 2020-09-21 20:44:34 +10:00
AP_HAL AP_HAL: added timer_tick() on GPIO 2020-10-02 09:38:24 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: add a max quota of GPIO interrupts 2020-10-02 09:38:24 +10:00
AP_HAL_Empty AP_HAL_Empty: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_HAL_Linux AP_HAL_Linux: throw warning if we ever stop-clock backwards 2020-09-15 10:02:36 +10:00
AP_HAL_SITL AP_HAL_SITL: fix segv in examples 2020-09-10 14:30:24 +10:00
AP_Hott_Telem AP_Hott_Telem: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ICEngine AP_ICEngine: check for valid RC input for ICE 2020-09-14 12:20:55 +10:00
AP_IOMCU AP_IOMCU: fixed handling of RC ignore failsafe option 2020-08-25 09:53:26 +10:00
AP_IRLock AP_IRLock: Change the tab code to whitespace 2020-04-27 09:29:11 +09:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: trigger internal error on persistent IMU reset 2020-09-02 06:42:44 +10:00
AP_InternalError AP_InternalError: added an internal error for GPIO ISR overload 2020-10-02 09:38:24 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: remove KDECAN example KDECAN test is moved to CANTester 2020-08-20 07:44:53 +10:00
AP_L1_Control
AP_LTM_Telem
AP_Landing AP_Landing: replace '@User: User' with '@User: Standard' 2020-09-22 14:56:04 +10:00
AP_LandingGear AP_LandingGear: Change the tab code to whitespace 2020-04-27 09:29:18 +09:00
AP_LeakDetector AP_LeakDetector: Remove not used LeakDetector_Type enum 2020-10-01 16:31:13 +10:00
AP_Logger AP_Logger: keep pointer to link rather than using its ->chan 2020-09-25 09:01:00 +10:00
AP_MSP AP_MSP: fixed build warnings for MSP with AP_Periph 2020-09-15 09:40:03 +10:00
AP_Math AP_Math: add bitwise fetch/load 16, 24, 32bit operations 2020-09-15 13:09:50 -07:00
AP_Menu
AP_Mission AP_Mission: add accessor for in_landing_flag() 2020-09-17 07:31:43 -07:00
AP_Module
AP_Motors AP_Motors: eliminate flags structure 2020-09-22 20:26:24 +10:00
AP_Mount AP_Mount: remove unused GPS.h include 2020-09-17 10:55:08 +10:00
AP_NMEA_Output
AP_NavEKF AP_NavEKF: remove unused variables 2020-10-01 21:13:20 +10:00
AP_NavEKF2 AP_NavEKF2: reset body mag variances at key points 2020-09-20 09:25:57 +10:00
AP_NavEKF3 AP_NavEKF3: shorten buffer size send_text message length 2020-09-29 08:57:52 +09:00
AP_Navigation
AP_Notify AP_Notify: remove unused variables 2020-10-01 21:13:20 +10:00
AP_OLC AP_OLC: remove use of algorithm header 2020-10-01 09:40:45 +10:00
AP_OSD AP_OLC: clean namespace and use constexpr instead of init method 2020-10-01 09:40:45 +10:00
AP_OpticalFlow AP_OpticalFlow: aligned msp message data struct name to gps,baro and mag 2020-09-09 06:35:50 +10:00
AP_Parachute AP_Parachute: Fix singleton panic message 2020-05-05 07:43:02 +10:00
AP_Param AP_Param: add set_and_save_and_notify() 2020-09-15 13:09:50 -07:00
AP_PiccoloCAN AP_PiccoloCAN: Constrain ESC command message rate 2020-09-09 15:31:21 +10:00
AP_Proximity AP_Proximity: remove unused variables 2020-10-01 21:13:20 +10:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: fix fport rssi 2020-09-29 09:04:38 +10:00
AP_RCTelemetry AP_RCTelemetry: move CRSF link statistics definition to AP_RCProtocol 2020-08-06 18:24:46 +10:00
AP_ROMFS
AP_RPM AP_RPM: allow harmonic notch driver to appear as RPM values. 2020-04-14 09:43:16 +10:00
AP_RSSI AP_RSSI: create and use new AP_HAL::PWMSource object 2020-09-08 16:10:50 +10:00
AP_RTC AP_RTC: use GCS_SEND_TEXT() 2020-04-29 07:36:55 +10:00
AP_Radio
AP_Rally AP_Rally: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_RangeFinder AP_RangeFinder: remove unused variables 2020-10-01 21:13:20 +10:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: print task total time as a percentage of all tasks time 2020-09-30 17:37:20 +10:00
AP_Scripting AP_Scripting: remove compile errors and warnings 2020-09-22 09:37:02 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: add support for Sagetech protocol 2020-09-15 13:09:50 -07:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: fixed build warning on gcc9 2020-09-22 08:07:23 +10:00
AP_Soaring AP_Soaring: remove unused variables 2020-10-01 21:13:20 +10:00
AP_SpdHgtControl
AP_Stats
AP_TECS AP_TECS: replace '@User: User' with '@User: Standard' 2020-09-22 14:56:04 +10:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: fix snprintf-overflow compilation error 2020-08-07 12:36:12 +10:00
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 2020-08-19 17:31:09 +10:00
AP_Tuning AP_Tuning: add documentation for PRTN message 2020-04-14 07:34:59 +10:00
AP_UAVCAN AP_UAVCAN: disable UAVCAN library when libuavcan drivers are disabled 2020-09-24 12:32:19 +10:00
AP_Vehicle AP_Vehicle: move orderly rebooting code from GCS into AP_Vehicle 2020-09-29 18:07:59 +10:00
AP_VisualOdom AP_VisualOdom: Shorten the distinguished name. 2020-07-28 09:09:27 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: Change the tab code to whitespace 2020-04-27 09:32:15 +09:00
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 2020-09-09 11:56:00 +09:00
AP_WindVane AP_WindVane: report apparent wind with named float 2020-09-30 17:03:58 +10:00
AR_WPNav AR_WPNav: minor param description typo fix 2020-08-07 08:30:03 +09:00
Filter Filter: return active harmonics based on dynamic harmonic enablement 2020-07-14 09:50:06 +10:00
GCS_MAVLink GCS_MAVLink: move orderly rebooting code from GCS into AP_Vehicle 2020-09-29 18:07:59 +10:00
PID
RC_Channel RC_Channel: conditionlly compile in ADSB support 2020-09-22 09:33:51 +10:00
SITL SITL: adjust for START_STOP_D now not polluting global namespace 2020-09-30 23:14:40 +10:00
SRV_Channel SRV_Channels: refactor zero_rc_outputs() out of GCS_Mavlink 2020-09-29 18:07:59 +10:00
StorageManager
doc