ardupilot/libraries
Andy Piper 3d0cf7e12a AP_HAL_ChibiOS: hardware M4-Cortex and M7-Cortex (and H7) implementation of HAL FFT abstraction
implements an FFT engine based on the betaflight feature using ARM hardware accelerated CMSIS library
make the FFT feature optional
add dynamic gyro windows
add quinns and candans estimators and record in DSP state
disable DSP for boards with limited flash
calculate power spectrum rather than amplitude
start/analyse version of analysis to support threading
allocate memory in a specific region
constrain window size by CPU class
control inclusion of DSP based on board size
2020-02-22 11:15:37 +11:00
..
AC_AttitudeControl AC_PosControl: allow smaller changes in max speed and accel 2020-02-22 08:53:41 +09:00
AC_Autorotation AC_Autorotation: Created autorotation library 2019-11-29 08:06:10 +08:00
AC_AutoTune AC_AutoTune: fix restoring of original gains 2020-01-31 19:40:21 +09:00
AC_Avoidance AC_Avoidance: keep track of velocity liminting status 2020-02-04 10:24:33 +09:00
AC_Fence AC_Fence: add the description of FENCE_ACTION in Rover 2020-02-05 14:58:56 +09:00
AC_InputManager AC_InputManager: tradheli-Fix parameter metadata errors 2020-01-13 12:41:30 -05:00
AC_PID AC_PID: added AC_PI controller 2019-11-02 16:31:04 +11:00
AC_PrecLand AC_PrecLand: POS param range of 5m and 1cm increment 2020-02-01 08:46:03 +09:00
AC_Sprayer AC_Sprayer: make configurable in hwdef.dat 2020-01-18 13:48:48 +11:00
AC_WPNav AC_WPNAV:make speed changes during missions obey WPNAV_ACCEL 2020-02-22 08:53:41 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: add missing break statement 2020-01-15 13:55:42 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: correct WP_GPS_LOSS param documentation block 2020-02-19 15:09:16 +11:00
AP_AHRS AP_AHRS: allow NavEKFs to be compiled out 2020-01-21 11:53:18 +11:00
AP_Airspeed AP_Airspeed: hide unused parameters for AP_Periph 2020-02-18 11:15:05 +11:00
AP_Arming AP_Arming: add arming message for compass not detected but assigned 2020-02-19 13:59:53 +09:00
AP_Avoidance AP_Avoidance: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Baro AP_Baro: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_BattMonitor AP_Battmonitor_SMBus_Solo: removed unused code/options 2020-02-06 15:04:18 -07:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BLHeli AP_BlHeli: always report test results and report band channel once 2020-02-04 10:38:20 +11:00
AP_BoardConfig AP_BoardConfig: use take_blocking instead of HAL_SEMAPHORE_BLOCK_FOREVER 2020-01-19 20:19:30 +11:00
AP_Button AP_Button: make singleton 2019-12-10 09:29:52 +09:00
AP_Camera AP_Camera: bug fixes to support 5-key remote RunCams 2020-02-20 19:58:43 +11:00
AP_Common AP_Common: add method that can help to put contraint on accessor type 2020-02-19 13:59:53 +09:00
AP_Compass AP_Compass: run style script on Compass.cpp 2020-02-19 13:59:53 +09:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_EFI AP_EFI: fix for updated mavlink extensions 2020-01-29 08:16:59 +11:00
AP_ESC_Telem AP_ESC_Telem: wrapper for ESCs with feedback 2020-02-12 11:58:34 +09:00
AP_Filesystem AP_Filesystem: fixed EOF on file read 2020-02-19 18:11:41 +11:00
AP_FlashStorage AP_FlashStorage: implement erase() method 2020-01-02 09:52:57 +11:00
AP_Follow AP_Follow: minor format fix to FOLL_ALT_TYPE param desc 2020-02-17 14:30:18 +09:00
AP_Frsky_Telem AP_Frsky_Telem: add semaphores to ahrs access and fix potential array out of bounds access 2020-02-21 07:54:59 +11:00
AP_GPS AP_GPS: reduce POS param range to 5m and add increment 2020-02-01 08:46:03 +09:00
AP_Gripper AP_Gripper: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00
AP_HAL AP_HAL: hardware abstraction for FFT. 2020-02-22 11:15:37 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: hardware M4-Cortex and M7-Cortex (and H7) implementation of HAL FFT abstraction 2020-02-22 11:15:37 +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: fixed bitmask error on storage erase 2020-01-31 11:06:29 +11:00
AP_HAL_SITL AP_HAL_SITL: update search for dumpstack.sh 2020-02-20 20:41:26 +11:00
AP_Hott_Telem AP_Hott_Telem: avoid 1-byte overwrite in prearm check string 2020-01-28 17:06:29 +11:00
AP_ICEngine AP_ICEngine: correct IDLE_DB parameter documentation 2020-02-19 15:09:16 +11: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_InertialSensor: expose statically filtered gyro values for FFT analysis and allow sampling to gyro window for FFT analysis. 2020-02-22 11:15:37 +11:00
AP_InternalError AP_InternalError: added hex and decimal comments 2019-12-09 12:43:39 +11:00
AP_IOMCU AP_IOMCU: use more efficient read API for rcin 2020-01-31 11:09:07 +11:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: fixed build error on Linux 2019-12-31 11:38:30 +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_Deepstall: correct missing parameter docs 2020-02-18 13:28:03 +11:00
AP_LandingGear AP_Landing: emit DEPLOY gcs text only if not already deployed 2019-12-02 07:28:53 +08:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: EKF4 change flags state from uint16_t to uint32_t 2020-02-19 06:45:07 +11:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: define ROTATION_MAX_AUTO_ROTATION 2020-01-01 16:59:27 +11:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: Check if failsafes should interupt landing approach 2020-02-18 21:03:29 +11:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: Added cwx motor setup for hexa, octa and octaquad 2020-02-19 11:28:25 +09:00
AP_Mount AP_Mount: change type of roi_target_set to boolean 2019-11-12 07:52:22 +08:00
AP_NavEKF AP_NavEKF: add initalized flag and change to uint32_t 2020-02-19 06:45:07 +11:00
AP_NavEKF2 AP_NavEKF2: fixed use of antenna position when switching GPS primary 2020-02-19 18:12:54 +11:00
AP_NavEKF3 AP_NavEKF3: fixed use of antenna position when switching GPS primary 2020-02-19 18:12:54 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Notify AP_Notify: add mah consumed to BAT line in OLED displays 2020-02-18 15:15:52 +11:00
AP_OpticalFlow AP_OpticalFlow: add orient-yaw parameter units 2020-02-03 19:35:40 +09:00
AP_OSD AP_Notify: add mah consumed to BAT line in OLED displays 2020-02-18 15:15:52 +11:00
AP_Parachute AP_Parachute: default to parachute enabled 2020-01-18 13:48:48 +11:00
AP_Param AP_Param: add method to find key of top level group variable by pointer 2020-02-19 13:59:53 +09:00
AP_PiccoloCAN AP_PiccoloCAN: fixed build error on Linux 2019-12-31 11:38:30 +11:00
AP_Proximity AP_Proximity: TeraRangerTower uses intermediate serial class 2020-02-19 11:12:37 +09:00
AP_Radio AP_Radio: use take_blocking instead of HAL_SEMAPHORE_BLOCK_FOREVER 2020-01-19 20:19:30 +11:00
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RangeFinder AP_RangeFinder: comment out no-loner-used PX4 enum entry 2020-02-12 21:18:47 +11:00
AP_RCMapper AP_RCMapper: add singleton 2019-12-30 13:02:04 +11:00
AP_RCProtocol AP_RCProtocol: handle 0x10 and 0x00 frames, check scheduler delay and fix incoming crc 2020-02-21 09:29:15 +11: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_ROMFS AP_ROMFS: fixed build warning 2019-12-20 16:50:48 +11:00
AP_RPM AP_RPM: use updated rpm information for sitl 2019-12-17 10:07:06 +11:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: Add a lock that is held during all normal operations 2020-02-18 09:16:10 +11:00
AP_Scripting AP_Scripting: Reduce the sleep time with no scripts 2020-02-19 13:24:23 -07:00
AP_SerialLED AP_SerialLED: check for valid channel 2019-11-04 13:06:08 +11:00
AP_SerialManager AP_SerialManager: added Hott telemetry 2020-01-16 20:36:54 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: do-set-servo affects sprayer and gripper 2020-02-11 11:08:02 +11:00
AP_SmartRTL AP_SmartRTL: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Soaring AP_Soaring: remove empty Units: parameter doc entries 2020-02-19 15:09:16 +11:00
AP_SpdHgtControl AP_SpdHgtControl: added reset() 2020-02-16 17:04:07 +11:00
AP_Stats AP_Stats: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_TECS AP_TECS: added reset() method 2020-02-16 17:04:07 +11:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: fix TSYS01 warning on SITL 2020-02-05 17:10:58 -05:00
AP_Terrain AP_Terrain: Avoid update() IO operations when not enabled 2020-01-26 10:35:29 +11:00
AP_ToshibaCAN AP_ToshibaCAN: move usage_sec in telemetry struct 2020-02-12 11:58:34 +09:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Vehicle AP_Vehicle: add AP_ESC_Telem 2020-02-12 11:58:34 +09:00
AP_VisualOdom AP_VisualOdom: POS param range of 5m and 1cm increment 2020-02-01 08:46:03 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: add param docs for new PID filter parameters 2020-02-19 15:09:16 +11:00
AP_Winch AP_Winch: use enum-class for SRV_CHANNEL_LIMIT_TRIM and friends 2019-11-26 10:17:17 +11:00
AP_WindVane AP_WindVane: use strtof instead of atof 2019-10-28 15:53:16 +11:00
APM_Control APM_Control: move to airspeed_estimate with pointer 2020-01-14 22:34:37 -07:00
AR_WPNav AR_WPNav: remove unneeded overshoot methods 2019-10-23 08:28:39 +08:00
doc
Filter Filter: switch harmomic notch mode to enum class 2019-11-19 07:08:01 +08:00
GCS_MAVLink GCS_MAVLink: don't send statustext from other than main thread 2020-02-20 10:39:29 +11:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: Add GoPro mode toggle Aux switch 2020-02-18 11:13:27 +11:00
SITL SITL: Rename morse-rover to morse-skid 2020-02-21 08:23:54 +09:00
SRV_Channel SRV_Channel: remove release and choke from FUNCTION param description 2020-02-11 11:08:02 +11:00
StorageManager StorageManager: use pragmas to set storage layout rather than call 2020-01-28 11:34:51 +11:00