ardupilot/libraries
Andrew Tridgell 89bd6ab218 AP_GPS: implement the GPS_DRV_OPTION for ellisoid height in mode drivers
this allows a lot more drivers to use the GPS_DRV_OPTION but to use
ellisoid height. Particularly useful for DroneCAN GPS modules

using ellisoid height instead of AMSL is useful in some specialised
application
2023-09-21 19:36:26 +10:00
..
AC_AttitudeControl AC_AttitudeControl: rename get_angle_P_scale_logging() 2023-09-13 18:02:44 +10:00
AC_AutoTune AC_AutoTune: remove unsued variables 2023-07-13 11:02:40 +10:00
AC_Autorotation
AC_Avoidance AC_Avoidance: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AC_CustomControl AC_CustomControl_PID: set false to avoid hitting limits 2023-06-20 10:50:11 +10:00
AC_Fence AC_Fence: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AC_InputManager
AC_PID AC_PID: add const kP accessor 2023-09-12 19:14:01 +10:00
AC_PrecLand Copter: Allow fast descend while Prec Landing 2023-09-13 11:49:16 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: add roi circle_option metadata 2023-07-02 13:15:20 +10:00
APM_Control APM_Control: implement single-cycle feed-forward scaler for roll and pitch 2023-09-13 18:02:44 +10:00
AP_ADC
AP_ADSB AP_ADSB: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_AHRS AP_AHRS: move AP_AHRS_DCM::groundspeed_vector into correct file 2023-09-20 19:06:10 +10:00
AP_AIS
AP_AccelCal AP_AccellCal: initialize HAL_INS_ACCELCAL_ENABLED for periph 2023-07-04 05:41:03 -07:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_Airspeed AP_Airspeed: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Arming AP_Arming: Don't allow same CAN rangefinder on different can bus 2023-09-09 17:21:44 +10:00
AP_Avoidance
AP_BLHeli AP_BLHeli: normalize motor index correctly for iomcu running dshot 2023-08-15 06:53:48 +10:00
AP_Baro AP_Baro: Remove executable permissions 2023-09-08 17:09:26 +10:00
AP_BattMonitor AP_BattMonitor: log external temperature if available 2023-09-05 10:31:24 +10:00
AP_Beacon AP_Beacon: MarvelMind: avoid potentially reading INT32_MAX bytes of input 2023-07-18 11:18:47 +10:00
AP_BoardConfig AP_BoardConfig: control dshot availability with HAL_WITH_IO_MCU_DSHOT 2023-08-15 06:53:48 +10:00
AP_Button AP_Button: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_CANManager AP_CANManager: handle CAN_FORWARD as both command_INT and COMMAND_LONG 2023-09-20 17:50:56 +10:00
AP_CSVReader
AP_Camera AP_Camera: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: remove unused Location constructor from Vector3d 2023-09-12 09:29:26 +10:00
AP_Compass AP_Compass: correct compilation with COMPASS_CAL_ENABLED off 2023-09-19 16:54:59 +10:00
AP_CustomRotations
AP_DAL AP_DAL: add missing internalerror include 2023-09-03 08:41:10 +10:00
AP_DDS AP_DDS: Added Mode Switch Service 2023-09-11 09:50:14 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: support string parameters 2023-09-19 10:58:52 +10:00
AP_EFI EFI: added efi MavLink class 2023-07-11 12:32:19 +10:00
AP_ESC_Telem AP_ESC_Telem: fix fake value of SITL ESC 2023-09-11 09:48:34 +10:00
AP_ExternalAHRS AP_ExternalAHRS: correct AP_ExternalAHRS init 2023-08-31 11:08:51 +10:00
AP_ExternalControl AP_ExternalControl: external control library for MAVLink,lua and DDS 2023-08-22 18:21:23 +10:00
AP_FETtecOneWire AP_FETtecOneWire: fixed build on periph 2023-08-24 13:06:40 +10:00
AP_Filesystem AP_Filesystem: move AP_RTC::mktime to be ap_mktime 2023-06-27 11:25:11 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: add and use AP_FOLLOW_ENABLED 2023-08-15 09:57:35 +10:00
AP_Frsky_Telem AP_Frsky_Telem: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_GPS AP_GPS: implement the GPS_DRV_OPTION for ellisoid height in mode drivers 2023-09-21 19:36:26 +10:00
AP_Generator AP_Generator: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Gripper AP_Gripper: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_GyroFFT
AP_HAL AP_HAL: relax F4 notch constraints slightly to allow triple notch on quads 2023-09-20 17:37:24 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: Explicitly include InternalError 2023-09-20 19:51:48 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: update esp32empty 2023-09-02 09:43:14 +10:00
AP_HAL_Empty AP_HAL_Empty: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_Linux AP_HAL_Linux: make all semaphores priority-inherit 2023-09-06 15:58:58 -05:00
AP_HAL_SITL AP_HAL_SITL: added last_transmit_us to CAN stats 2023-09-05 06:56:51 +10:00
AP_Hott_Telem AP_Hott_Telem: removed set_blocking_writes 2023-07-12 17:06:02 +10:00
AP_ICEngine AP_ICEngine: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_IOMCU AP_IOMCU: fix eventing mask and some minor cleanups 2023-08-15 06:53:48 +10:00
AP_IRLock
AP_InertialNav AP_InertialNav: clarify get_vert_pos_rate AHRS method name to include 'D' 2023-06-06 20:09:28 +10:00
AP_InertialSensor AP_InertialSensor: update to support esp32 2023-09-02 09:43:14 +10:00
AP_InternalError AP_InternalError: improve gating of use of AP_InternalError library 2023-08-17 09:16:46 +10:00
AP_JSButton AP_JSButton: add unittest 2023-06-07 17:16:15 +10:00
AP_KDECAN
AP_L1_Control AP_L1_Control: check vehicle yaw (heading) and ground track agree 2023-09-05 10:07:14 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Landing AP_Landing: trim LogStructure base off included code 2023-08-01 10:07:28 +10:00
AP_LandingGear AP_LandingGear: avoid use of MINIMIZE_FEATURES in AP_LandingGear_config.h 2023-08-01 10:44:59 +10:00
AP_LeakDetector
AP_Logger AP_Logger: log valid-input and in-rc-failsafe 2023-09-12 19:14:18 +10:00
AP_MSP AP_MSP: remove references to HAL_BUILD_AP_PERIPH 2023-08-09 17:39:49 +10:00
AP_Math AP_Math: add conversions from metres to feet 2023-09-08 19:44:07 +10:00
AP_Menu
AP_Mission AP_Mission: remove unused method mavlink_cmd_long_to_mission_cmd 2023-09-12 09:22:36 +10:00
AP_Module
AP_Motors AP_Motors: Add missing shebang 2023-09-08 17:09:26 +10:00
AP_Mount AP_Mount: Xacti sets datetime 2023-09-19 10:58:52 +10:00
AP_NMEA_Output AP_NMEA_Output: remove from 1MB boards 2023-08-15 08:45:30 +10:00
AP_NavEKF AP_NavEKF: fallback to no baro on boards that have no baro 2023-08-23 18:25:26 +10:00
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: do not use fmaxF on floating point values 2023-09-12 09:47:17 +10:00
AP_Navigation
AP_Networking Update libraries/AP_Networking/AP_Networking.cpp 2023-08-22 09:25:42 -07:00
AP_Notify AP_Notify: tidy use of DiscreteRGB 2023-09-16 08:47:37 +09:00
AP_OLC
AP_ONVIF
AP_OSD AP_OSD:Update/correct DisplayPort BF MSP symbols 2023-09-19 11:13:54 +10:00
AP_OpenDroneID AP_OpenDroneID: remove Chip ID as Basic ID mechanism 2023-06-17 14:49:22 +10:00
AP_OpticalFlow AP_OpticalFlow: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Parachute AP_Parachute: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Param AP_Param: fixed parameter defaults array length handling 2023-08-22 11:07:30 +10:00
AP_PiccoloCAN AP_PiccoloCAN: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Proximity AP_Proximity: Add backend for scripted Lua Driver 2023-08-03 08:02:49 +09:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: allow for fport without FRSky telem 2023-08-19 20:27:24 +10:00
AP_RCTelemetry AP_RCTelemetry: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI AP_RSSI: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_RTC AP_RTC: get-date-and-time returns milliseconds 2023-07-18 21:02:02 +09:00
AP_Radio
AP_Rally AP_Rally: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_RangeFinder AP_RangeFinder: Small optimizations 2023-09-09 17:21:44 +10:00
AP_Relay AP_Relay: check enabled relay mask for passing relay outputs to hardware 2023-09-11 12:21:13 +10:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_SBusOut AP_SBusOut: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
AP_Scheduler AP_Scheduler: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Scripting AP_Scripting: tricks-on-a-switch activation bugfix 2023-09-12 09:21:38 +10:00
AP_SerialLED AP_SerialLED: configure serial LED feature based on hal availability 2023-08-15 06:53:48 +10:00
AP_SerialManager AP_SerialManager: removed set_blocking_writes_all 2023-07-12 17:06:02 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_SmartRTL AP_SmartRTL: fix disable if second point fails to add 2023-09-19 08:01:47 +09:00
AP_Soaring
AP_Stats
AP_TECS AP_TECS: ensure good TECS state before running update_pitch_throttle 2023-09-10 12:32:13 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TempertureSensor:clarify temp sourec for pitot tube 2023-09-19 10:15:45 -07:00
AP_Terrain AP_Terrain: fixed build for periph 2023-08-24 13:06:40 +10:00
AP_Torqeedo AP_Torqeedo: error code reporting fix 2023-09-12 08:44:39 +10:00
AP_Tuning AP_Tuning: add and use AP_TUNING_ENABLED 2023-09-21 07:07:58 +10:00
AP_Vehicle AP_Vehicle: Added DDS_Command as a new ModeReason 2023-09-11 09:50:14 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands 2023-09-13 18:05:24 +10:00
AP_VisualOdom AP_VisualOdom: Change name from position to pose 2023-08-10 13:58:00 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Winch
AP_WindVane AP_WindVane: Change from DOS to UNIX line endings 2023-09-08 17:09:26 +10:00
AR_Motors AP_MotorsUGV: add asymmetry factor for skid-steering 2023-08-22 09:14:42 +09:00
AR_WPNav
Filter Filter: fix notch filter test. 2023-08-02 16:22:59 +01:00
GCS_MAVLink GCS_MAVLink: handle CAN_FORWARD as both command_INT and COMMAND_LONG 2023-09-20 17:50:56 +10:00
PID
RC_Channel RC_Channel: correct compilation with COMPASS_CAL_ENABLED off 2023-09-19 16:54:59 +10:00
SITL SITL: fix balancebot yaw reset to be kinimatically consistent 2023-09-20 22:59:41 +10:00
SRV_Channel SRV_Channel: correct description of SERVO_RC_FS_MSK 2023-08-15 08:16:16 +10:00
StorageManager
doc
COLCON_IGNORE