Ardupilot2/libraries
2021-10-06 06:44:36 +11:00
..
AC_AttitudeControl AC_AttitudeControl: Fix initialize bug 2021-10-01 13:14:46 -04:00
AC_Autorotation
AC_AutoTune AC_AutoTune: stop specifying bit-widths for state 2021-09-28 11:00:30 +10:00
AC_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AC_Fence
AC_InputManager
AC_PID
AC_PrecLand AC_PrecLand: Raise internal error if state machine is running while precland is disabled 2021-08-30 14:08:44 +09:00
AC_Sprayer AC_Sprayer: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AC_WPNav AC_WPNav: add getter for wp_radius_cm 2021-09-15 20:36:56 +10:00
AP_AccelCal AP_AccelCal: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_ADC
AP_ADSB AP_ADSB: Ping200X update health, remove option for external baro, and gnss altitude units bugfix 2021-10-03 09:57:39 -05:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: Change orientation labels to march order of rotation 2021-10-05 11:21:48 +11:00
AP_Airspeed AP_Airspeed: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_AIS
AP_Arming AP_Arming: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Baro AP_Baro: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_BattMonitor AP_BattMonitor: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Beacon AP_Beacon: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_BLHeli AP_BLHeli: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_BoardConfig AP_BoardConfig: remove ALT_CONFIG param if no alt config is posible 2021-09-29 19:55:21 +10:00
AP_Button AP_Button: update FUNx values 2021-09-21 09:36:24 +10:00
AP_Camera AP_Camera: use location methods to convert altitudes 2021-10-05 13:54:19 +11:00
AP_CANManager AP_CANManager:replace config_error with allocation_error 2021-09-30 08:51:26 +10:00
AP_Common AP_Common: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_Compass AP_Compass: Change orientation labels to match order of rotation 2021-10-05 11:22:32 +11:00
AP_DAL AP_DAL: replace config_error with allocation_error 2021-09-30 08:51:26 +10:00
AP_Declination AP_Declination: added a test suite for AP_Declination 2021-09-03 14:45:17 +10:00
AP_Devo_Telem
AP_EFI
AP_ESC_Telem AP_ESC_Telem: fix raw rpm 2021-09-01 17:15:32 +10:00
AP_ExternalAHRS AP_ExternalAHRS: use config error instead of panic on allocation failure 2021-09-30 08:51:26 +10:00
AP_FETtecOneWire AP_FETtecOneWire: README.md clarity improvements 2021-08-25 16:05:05 +10:00
AP_Filesystem AP_Filesystem: add fgets 2021-09-30 10:31:03 +10:00
AP_FlashIface AP_FlashIface: add jedec test using bootloader config 2021-09-01 17:10:53 +10:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: fix periph-heavy compile errors with different things enabled 2021-09-24 10:47:13 -05:00
AP_Generator AP_Generator: rename GENERATOR_ENABLED to HAL_GENERATOR_ENABLED 2021-09-26 19:24:09 +10:00
AP_GPS AP_GPS: fix build and working with single GPS Receiver config 2021-09-30 21:53:07 +10:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_HAL AP_HAL: allow for selection of Storage backend type at runtime 2021-10-05 10:16:54 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: fixed f1 bootloader build errors 2021-10-06 06:44:36 +11:00
AP_HAL_Empty AP_HAL_Empty: add check owner method 2021-09-01 17:10:53 +10:00
AP_HAL_Linux AP_HAL_Linux: make panic() WEAK 2021-09-28 09:11:48 +10:00
AP_HAL_SITL AP_HAL_SITL: add and use HAL_SITL &hal_sitl 2021-10-05 22:24:38 +11:00
AP_Hott_Telem AP_Hott_Telem: cope with BARO_MAX_INSTANCES = 1 2021-09-29 10:51:14 +10:00
AP_ICEngine
AP_InertialNav AP_InertialNav: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_InertialSensor AP_InertialSensor: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_IOMCU AP_IOMCU: ensure page_GPIO is aligned to 16bit 2021-09-29 19:08:10 +10:00
AP_IRLock AP_IRLock_I2C: add comment on calibration equation 2021-09-13 10:56:00 +09:00
AP_JSButton
AP_KDECAN
AP_L1_Control
AP_Landing AP_landing: hide deepstall params with enable flag 2021-08-24 09:38:46 +10:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: fixed stuck logging with LOG_DISARMED=1 2021-09-28 10:47:48 +10:00
AP_LTM_Telem
AP_Math AP_Math: add Internal_Error for quaternion of 0 length 2021-09-28 19:09:16 +10:00
AP_Menu
AP_Mission AP_Mission: fix infinite loop with nav commands that won't start 2021-09-21 13:42:01 +10:00
AP_Module AP_Module: fix examples for AP_AHRS_DCM becoming backend 2021-08-31 14:28:53 +10:00
AP_Motors AP_Motors: add note about test to new inverse functions 2021-10-01 22:04:51 +01:00
AP_Mount AP_Mount: initialize backends after all mounts were added 2021-09-01 18:57:24 +10:00
AP_MSP AP_MSP: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_NavEKF3 AP_NavEKF3: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_Notify AP_Notify: link to notify module 2021-09-10 08:17:37 +10:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OpticalFlow AP_OpticalFlow: SITL driver applies _FX/YSCALER params 2021-08-24 16:49:04 +09:00
AP_OSD OP_OSD_Screen: make the rangefinder distance element fixed length 2021-10-05 12:15:08 +11:00
AP_Parachute
AP_Param AP_Param: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_PiccoloCAN
AP_Proximity AP_Proximity: lower SF45B update rate 2021-09-26 20:26:20 +09:00
AP_Radio AP_Radio: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_Rally AP_Rally: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_RAMTRON
AP_RangeFinder AP_Rangefinder : make get_temp const 2021-10-03 09:21:31 -04:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: increase CRSF frame timeout to account for scheduling delays 2021-08-31 08:18:32 +10:00
AP_RCTelemetry AP_RCTelemetry: don't enter parameter mode while armed. 2021-09-21 10:41:58 +10:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo
AP_ROMFS
AP_RPM AP_RPM: Mark type = PWM as not used in docs 2021-08-25 09:36:58 +10:00
AP_RSSI
AP_RTC AP_RTC: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Scripting AP_HAL_ChibiOS: setup led control via lua script for HerePro 2021-09-30 08:52:27 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: always set options 2021-10-05 12:11:47 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: Initialize filter to the current filtered measurement 2021-08-25 19:00:46 +10:00
AP_SpdHgtControl
AP_Stats
AP_TECS
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: make TERRAIN_MARGIN a float 2021-08-31 09:25:36 +10:00
AP_Torqeedo
AP_ToshibaCAN
AP_Tuning AP_Tuning: add options to prevent spamming tuning error messages 2021-09-21 07:56:19 +09:00
AP_UAVCAN AP_UAVCAN: add dsdl for sending vehicle notify state 2021-09-30 08:52:27 +10:00
AP_Vehicle AP_Vehicle: Add Heli build type 2021-09-29 19:55:48 +10:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch
AP_WindVane AP_WindVane: remove empty contructors 2021-08-25 20:42:23 +10:00
APM_Control AP_Control: apply pitch rate limit to turn coordination 2021-09-29 17:03:32 +01:00
AR_Motors AR_Motors: re-work omni output to scale evenly at saturation 2021-09-16 08:48:47 +09:00
AR_WPNav
doc
Filter Filter: add more unittests 2021-08-30 09:51:25 +10:00
GCS_MAVLink GCS_MAVLink: use AHRS position for location 2021-10-05 10:20:44 +11:00
PID
RC_Channel RC_Channel: add trim to current servo and RC option 2021-09-28 09:16:24 +10:00
SITL SITL: remove mtk GPSs 2021-09-29 17:28:59 +10:00
SRV_Channel SRV_Channel: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
StorageManager StorageManager: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00