ardupilot/libraries
Andy Piper 667b386356 AP_HAL_ChibiOS: port to ChibiOS 21.11.x
convert RCOutput to new virtual timer interface
cope with SDC vs SDMMC
use new SPIv3 driver. Correct clocks for SDMMCv2.
add STM32L431 support
port ChibiOS config to version 8
support SPIv3 driver model v2 on H7
use currcore in debug options
use new mmc API
disable speed optimizations in the bootloader to save a little flash
upgrade to halconf v8.4
relax constraints on QSP/flash clock.
add support for disabling QSPI reset in main firmware
2023-03-29 20:49:40 +11:00
..
AC_AttitudeControl AC_Attitude:add TKOFF/LAND only weathervane option 2023-03-01 09:51:36 +11:00
AC_AutoTune AC_AutoTune: add option for tuning yaw D-term 2023-03-14 11:01:31 +11:00
AC_Autorotation
AC_Avoidance AC_Avoidance: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_CustomControl
AC_Fence AC_Fence: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_InputManager
AC_PID AC_PID: AC_PI: fix param defualting 2023-02-06 08:09:13 +09:00
AC_PrecLand AC_PrecLand: configuration of Precision Landing for custom build server 2023-03-27 09:04:07 +11:00
AC_Sprayer
AC_WPNav AC_WPNav: Provide terrain altitude for surface tracking 2023-03-07 13:41:35 +11:00
APM_Control
AP_ADC
AP_ADSB AP_ADSB: create AP_ADSB_config.h 2023-01-31 11:11:26 +11:00
AP_AHRS AP_AHRS: fixed earth frame accel for EKF3 with significant trim 2023-02-28 17:16:39 +11:00
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_AccelCal
AP_AdvancedFailsafe AP_AdvancedFailsafe: add and use AP_ADVANCEDFAILSAFE_ENABLED 2023-02-08 19:00:13 +11:00
AP_Airspeed AP_Airspeed: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_Arming AP_Arming: add and use a define for AP_ARMING_AUX_AUTH_ENABLED 2023-03-25 15:56:22 +11:00
AP_Avoidance
AP_BLHeli
AP_Baro AP_Baro: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_BattMonitor AP_BattMonitor: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_Beacon
AP_BoardConfig AP_BoardConfig: ensure that debug pins are enabled if compiled with debug 2023-03-29 20:49:40 +11:00
AP_Button
AP_CANManager AP_CANManager: setup CANManager for DroneCAN Driver tests 2023-03-29 17:16:39 +11:00
AP_CSVReader
AP_Camera AP_Camera: correct config boards include 2023-03-19 09:08:41 +11:00
AP_CheckFirmware
AP_Common AP_Common: NOINLINE is now defined in ChibiOS 2023-03-29 20:49:40 +11:00
AP_Compass AP_Compass: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_CustomRotations
AP_DAL AP_DAL: use MAX_EKF_CORES instead of INS_MAX_INSTANCES in ekf_low_time_remaining 2023-03-21 10:04:16 +11:00
AP_DDS AP_DDS: update readme headers overhaul 2023-03-29 07:11:42 +11:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_ESC_Telem AP_ESC_Telem: add and use an AP_ESC_Telem_config.h 2023-03-10 08:48:24 +11:00
AP_ExternalAHRS AP_ExternalAHRS: add and use a "bool read(c)" method to AP_HAL 2023-03-22 17:59:11 +11:00
AP_FETtecOneWire
AP_Filesystem AP_Filesystem: support file rename 2023-03-05 09:42:48 +11:00
AP_FlashIface AP_FlashIface: build fix for examples 2023-03-29 20:49:40 +11:00
AP_FlashStorage AP_FlashStorage: fix spelling 2023-02-14 14:33:01 +00:00
AP_Follow
AP_Frsky_Telem
AP_GPS AP_GPS: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_Generator AP_Generator: turn RichenPower on on 2MB boards 2023-03-22 18:06:31 +11:00
AP_Gripper AP_Gripper: correct config boards include 2023-03-19 09:08:41 +11:00
AP_GyroFFT AP_GyroFFT: change default FFT frequency range to something more useful 2023-01-24 10:56:33 +11:00
AP_HAL AP_HAL: sitl: set default value of HAL_CAN_DRIVER_DEFAULT as 1 2023-03-29 17:16:39 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: port to ChibiOS 21.11.x 2023-03-29 20:49:40 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: add and use a "bool read(c)" method to AP_HAL 2023-03-22 17:59:11 +11:00
AP_HAL_Empty AP_HAL_Empty: add and use a "bool read(c)" method to AP_HAL 2023-03-22 17:59:11 +11:00
AP_HAL_Linux AP_HAL_Linux: add option to use vitual CAN in linux 2023-03-29 17:16:39 +11:00
AP_HAL_SITL AP_HAL_SITL: setup for DroneCAN driver test build 2023-03-29 17:16:39 +11:00
AP_Hott_Telem
AP_ICEngine
AP_IOMCU AP_IOMCU: support forcing heater to enabled with a feature bit 2023-03-07 10:33:24 +11:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: HAL_WITH_DSP -> HAL_GYROFFT_ENABLED 2023-03-29 20:49:40 +11:00
AP_InternalError AP_InternalError: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LTM_Telem
AP_Landing AP_Landing: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: add and use RC_Channel_config.h 2023-03-22 14:25:09 +11:00
AP_MSP AP_MSP: add and use RC_Channel_config.h 2023-03-22 14:25:09 +11:00
AP_Math AP_Math: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_Menu
AP_Mission AP_Mission: allow clearing mission in AUTO when disarmed 2023-03-28 09:43:42 +11:00
AP_Module
AP_Motors AP_Motors: add method for scripting to set external limit flags 2023-03-07 10:12:30 +11:00
AP_Mount AP_Mount: clarify attitude returned in get_attitude_quaternion method call 2023-03-27 09:03:35 +09:00
AP_NMEA_Output AP_NMEA_Output: fix GPGGA hdop, fix, sats 2023-03-14 12:45:47 -07:00
AP_NavEKF AP_NavEKF: ensure gyro biases are numbers 2023-03-21 12:18:33 +11:00
AP_NavEKF2 AP_NavEKF2: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NavEKF3 AP_NavEKF3: use INS_MAX_INSTANCES instead of MAX_EKF_CORES for IMU mask 2023-03-21 10:04:16 +11:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Notify AP_Notify: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_OLC AP_OLC: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_ONVIF
AP_OSD AP_OSD: add and use RC_Channel_config.h 2023-03-22 14:25:09 +11:00
AP_OpenDroneID AP_OpenDroneID: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_OpticalFlow AP_Opticalflow: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_Parachute
AP_Param AP_Param: print length of defaults list as part of key dump 2023-01-24 10:16:56 +11:00
AP_PiccoloCAN AP_PiccoloCAN: tidy AP_EFI defines 2023-03-21 09:01:13 +11:00
AP_Proximity AP_Proximity: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: add and use RC_Channel_config.h 2023-03-22 14:25:09 +11:00
AP_RCTelemetry AP_RCTelemetry: add and use AP_RCTelemetry_config.h 2023-03-21 08:47:53 +11:00
AP_ROMFS
AP_RPM
AP_RSSI
AP_RTC
AP_Radio
AP_Rally
AP_RangeFinder AP_RangeFinder: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
AP_Relay
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_Scripting AP_Scripting: added wrap32_test.lua for testing wrap32 usec bdshot bug 2023-03-24 08:31:25 +11:00
AP_SerialLED AP_SerialLED: add defines for some AP_Notify LED libraries 2023-03-07 10:30:13 +11:00
AP_SerialManager AP_SerialManager: Add enum for DDS over serial 2023-03-22 09:22:36 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring
AP_Stats
AP_TECS AP_TECS: protect against low airspeed in reset 2023-02-19 10:20:03 -08:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor:correct TEMP sensor metadata 2023-01-24 11:16:51 +11:00
AP_Terrain AP_Terrain: terrain offset max default to 30m 2023-03-14 11:59:49 +11:00
AP_Torqeedo AP_Torqeedo: add and use AP_Generator_config.h 2023-03-10 08:48:24 +11:00
AP_Tuning
AP_UAVCAN AP_UAVCAN: allow multithreaded register/unregistering handlers 2023-03-29 17:16:39 +11:00
AP_Vehicle AP_Vehicle: Add DDS initialization and params to the vehicle if enabled 2023-03-22 09:22:36 +11:00
AP_VideoTX AP_VideoTX: protect vtx from pitmode changes when not enabled or not armed 2023-02-15 19:30:28 +11:00
AP_VisualOdom AP_VisualOdom: handle voxl yaw and pos jump on reset 2023-01-24 11:07:02 +11:00
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch AP_Winch: Fix baud rate handling 2023-03-04 07:59:23 +09:00
AP_WindVane AP_WindVane: use body frame when setting apparent wind in sitl physics backend 2023-03-15 12:58:49 +00:00
AR_Motors
AR_WPNav AR_WPNav: avoid using struct Location 2023-02-04 22:51:54 +11:00
Filter Filter: HarmonicNotch: update FREQ description 2023-03-15 18:53:55 +11:00
GCS_MAVLink GCS_MAVLink: add and use a "bool read(c)" method to AP_HAL 2023-03-22 17:59:11 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: add and use RC_Channel_config.h 2023-03-22 14:25:09 +11:00
SITL SITL: add support for testing DroneCAN 2023-03-29 17:16:39 +11:00
SRV_Channel SRV_Channel: replace libuavcan with libcanard based driver 2023-03-29 17:16:39 +11:00
StorageManager StorageManager: fixed startup crash 2023-03-12 07:15:01 +11:00
doc