ardupilot/libraries
Andrew Tridgell cbfc505003 HAL_ChibiOS: fixed a race condition in UART DMA transmit
this fixes an issue seen on one board which caused a watchdog on high
uart DMA load. We have reproduced the issue on another board by
forcing a very high DMA transfer rate on the same DMA channel while
also requesting very high transfer rates on the UART. The likely race
is in the DMA transmit timeout code, and the simplest fix is to lock
out interrupts during the DMA setup to ensure the tx timeout cannot
trigger during the setup
2020-10-08 08:25:00 +11:00
..
AC_AttitudeControl AC_AttitudeControlHeli: update filter parameter desc mins 2020-05-06 14:31:06 +09:00
AC_AutoTune AC_AutoTune: fix restoring of original gains 2020-02-01 16:57:18 +09:00
AC_Autorotation AC_Autorotation: Created autorotation library 2019-12-16 14:05:10 +09:00
AC_Avoidance AP_OADatabase: send_adsb uses vehicle's current altitude 2020-05-11 10:22:27 +09:00
AC_Fence AC_Fence: turn off debug msg re memory allocation 2019-12-16 14:17:49 +09:00
AC_InputManager AC_InputManager: tradheli-Fix parameter metadata errors 2020-01-14 08:25:28 +09:00
AC_PID AC_PID: added AC_PI controller 2019-12-16 13:35: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:make speed changes during missions obey WPNAV_ACCEL 2020-05-06 14:22:23 +09:00
APM_Control APM_Control: AR_AttitudeControl: add description for new PID params 2019-09-23 09:45:46 +09:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: added handle_adsb_vehicle() API 2019-10-16 13:13:24 +11:00
AP_AHRS AP_AHRS: attitudes_consistent obeys always_use_EKF 2020-06-16 10:26:23 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_AdvancedFailsafe AP_AdvancedFailSafe: add singleton getter 2019-09-17 09:13:43 +10:00
AP_Airspeed AP_Airspeed: Add additional DLVR support 20inH2O 30inH2O 60inH2O 2020-10-02 10:07:51 +10:00
AP_Arming AP_Arming: add arming message for compass not detected but assigned 2020-05-11 19:41:11 +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: fixed critical errors caused by BLHeli code 2019-11-01 08:51:53 +09:00
AP_Baro AP_Baro: resync for 4.0 2020-05-11 17:22:07 +10:00
AP_BattMonitor AP_BattMonitor: NeoDesign battery driver 2020-05-06 15:48:49 +09:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BoardConfig AP_BoardConfig: added BRD_ALT_CONFIG 2020-05-11 16:01:33 +10:00
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera AP_Camera: Make trigger type enum class 2020-05-06 14:14:23 +09:00
AP_Common AP_Common: added TSIndex.h 2020-05-11 19:35:03 +10:00
AP_Compass AP_Compass: support probing RM3100 on all 4 addresses 2020-09-24 11:16:19 +10:00
AP_Declination AP_Declination: re-generate mag tables 2020-01-08 20:57:21 +11:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_Filesystem AP_FileSystem: chunk IOs to max 4k 2020-01-18 16:04:46 +11:00
AP_FlashStorage AP_FlashStorage: resync for 4.0 update 2020-05-11 16:46:43 +10:00
AP_Follow AP_Follow: add clear_offsets_if_required method 2019-10-07 08:30:45 +09:00
AP_Frsky_Telem AP_Frsky_Telem: support FPort 2020-05-11 15:57:44 +10:00
AP_GPS AP_GPS: fixed issue with GPS selection for moving baseline 2020-05-27 11:29:22 +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 timer_tick() on GPIO 2020-10-02 09:42:13 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: fixed a race condition in UART DMA transmit 2020-10-08 08:25:00 +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 AP_HAL_Linux: RCInput_UDP: accept up to 16 channels 2020-10-02 10:07:51 +10:00
AP_HAL_SITL HAL_SITL: resync for 4.0 update 2020-05-11 15:55:43 +10:00
AP_Hott_Telem AP_Hott_Telem: sync with master 2020-05-11 17:45:58 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_IOMCU AP_IOMCU: fixed bug in SBUS output when scanning for FPort input 2020-10-07 15:10:47 +11:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_InertialNav AP_InertialNav: use ekf::get_vert_pos_rate during high vibration 2019-10-18 11:15:25 +09:00
AP_InertialSensor AP_HAL_ChibiOS: Added support for Bitcraze Crazyflie 2.1 2020-06-10 17:34:37 +10:00
AP_InternalError AP_InternalError: added an internal error for GPIO ISR overload 2020-10-02 09:42:49 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: fixed build error on Linux 2020-01-08 20:58:37 +11:00
AP_L1_Control AP_L1_Control: wrap_180_cd no longer solely returns floats 2019-09-18 12:57:02 +10:00
AP_Landing AP_Landing: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_LandingGear AP_LandingGear: add OPTIONS param to auto deploy and retract 2020-05-06 14:32:44 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: fix locking issues, uninitialized read and status message length 2020-02-04 12:11:07 +09:00
AP_Math AP_Math: add vector2f::offset_bearing 2020-05-11 10:22:15 +09:00
AP_Menu
AP_Mission AP_Mission: added contains_terrain_relative() 2020-10-02 10:10:45 +10:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: Tradheli servo_test fix 2020-08-10 09:18:05 +09:00
AP_Mount AP_Mount: ignore rc trim when calculating desired mount angles 2020-05-06 14:27:01 +09:00
AP_NMEA_Output AP_NMEA_Output: 10hz rate limiting uses uint32_t 2019-12-17 11:01:05 +09:00
AP_NavEKF AP_NavEKF: fixed build with vector index checking 2019-10-01 15:39:03 +10:00
AP_NavEKF2 AP_NavEKF2: apply min GPS accuracy at measurement point 2020-10-02 10:07:51 +10:00
AP_NavEKF3 AP_NavEKF3: apply min GPS accuracy at measurement point 2020-10-02 10:07:51 +10:00
AP_Navigation
AP_Notify AP_Notify: fixed recursion bug in tone player 2020-05-11 17:25:13 +10:00
AP_OSD AP_OSD: fixes for modified AP_ROMFS API 2019-10-24 22:03:43 +11:00
AP_OpticalFlow AP_OpticalFlow: probe all I2C buses for px4flow on Hex Cubes 2020-01-28 14:42:57 +09: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: added find_top_level_key_by_pointer 2020-05-11 19:35:20 +10:00
AP_Proximity AP_Proximity: fix proximity ignored zone calulation 2020-06-12 16:51:37 +09:00
AP_RAMTRON AP_RAMTRON: resync for 4.0 2020-05-11 16:01:17 +10:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: added fport prototol support 2020-05-11 15:57:44 +10:00
AP_ROMFS AP_ROMFS: support uncompressed romfs data 2019-10-24 22:03:43 +11:00
AP_RPM AP_RPM: rename px4-pwm to just pwm 2019-10-22 07:15:48 +08:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: add local time support 2019-10-07 19:55:42 +11:00
AP_Radio AP_Radio: Change direct value to define name 2019-09-24 13:23:24 +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: fixed legacy parsing of 65436 for lightware i2c 2020-07-30 08:44:36 +09:00
AP_Relay AP_Relay: change parameter name from relay to instance 2019-09-27 12:02:38 +10: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: use fill_nanf() on each scheduler function 2019-10-01 17:35:26 +10:00
AP_Scripting AP_Scripting: example to check battery cycle count 2020-05-06 15:47:17 +09:00
AP_SerialLED AP_SerialLED: support ProfiLEDs 2020-04-21 08:03:01 +09:00
AP_SerialManager AP_SerialManager: added Hott telem 2020-05-11 17:45:58 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: do-set-servo affects sprayer and gripper 2020-02-20 09:52:20 +09:00
AP_SmartRTL AP_SmartRTL: fixup compile error 2019-10-04 10:01:49 +09:00
AP_Soaring AP_Soaring: move include of logger to .cpp file 2019-07-09 10:57:20 +10:00
AP_SpdHgtControl AP_SpdHgtControl: sync TECS with plane4.0 2020-05-11 18:14:48 +10:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: sync TECS with plane4.0 2020-05-11 18:14:48 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: Update TSYS01 for Pixhawk2 2019-09-27 13:08:26 -07:00
AP_Terrain AP_Terrain: added script for creating terrain *.dat files 2020-05-06 15:35:00 +09: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: protect UAVCAN DNA server with semaphore 2020-01-18 16:04:46 +11:00
AP_Vehicle AP_Vehicle: instantiate and init hott telem for copter4.0 2020-06-07 08:52:33 +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: add SITL backend 2019-10-07 07:31:51 +11:00
AP_Winch AP_Winch: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_WindVane AP_Windvane: caculate vehicles current tack 2019-09-26 18:23:03 +09:00
AR_WPNav AR_WPNav: remove unneeded overshoot methods 2019-10-23 08:28:39 +08:00
Filter Filter: add harmonic notch dynamic tracking mode 2019-10-31 20:10:28 +09:00
GCS_MAVLink GCS_MAVLink: do not process commands after we have decided to reboot 2020-08-27 20:13:03 +09:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: fixed use of radio_in out of range for angle inputs 2020-10-02 10:07:51 +10:00
SITL SITL: fixed dup param index 2020-05-12 15:34:16 +10:00
SRV_Channel SRV_Channel: change function to AP_Int16 2020-04-21 08:03:01 +09:00
StorageManager StorageManager: use hal.storage->erase() 2020-06-30 21:02:59 +09:00
doc