ardupilot/libraries
Peter Barker a65cd27435 AP_Beacon: allow hwdefs to override number of beacons
... also a few other variables.

Also move these out of the main header file as one is internal and the others should go in the ocnfig. in case the values are used elsewhere
2024-08-26 13:48:02 +10:00
..
AC_AttitudeControl AC_AttitudeControl: update comment to reflect the current logic in is_active_xy() 2024-08-23 07:14:50 +10:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: add support for testing tune via aux function 2024-08-13 08:57:44 +09:00
AC_Avoidance AC_Avoidance: correctly set back away speed for minimum alt fences 2024-07-24 08:24:06 +10:00
AC_CustomControl AP_CustomControl: Update README.md 2024-08-01 10:23:14 +10:00
AC_Fence AC_Fence: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AC_InputManager
AC_PID AC_PID: rename pid setters to include set_ in the names 2024-07-31 18:43:42 +10:00
AC_PrecLand AC_PrecLand: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Sprayer AC_Sprayer: create and use an AP_Sprayer_config.h 2024-07-05 14:27:45 +10:00
AC_WPNav AC_WPNav: correct calculation of predict-accel when zeroing pilot desired accel 2024-07-09 10:52:14 +10:00
AP_AccelCal AP_AccelCal: remove pointless assignment when counting calibrators 2024-01-21 09:53:04 +11:00
AP_ADC AP_ADC: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ADSB AP_ADSB: cache course-over-ground for GPS message 2024-06-19 10:14:50 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_AHRS AP_AHRS: rename ins get_primary_accel to get_first_usable_accel 2024-06-26 17:12:12 +10:00
AP_Airspeed AP_Airspeed: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_AIS AP_AIS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Arming AP_Arming: added arm_force() for scripting 2024-08-03 14:29:51 +10:00
AP_Avoidance AP_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Baro AP_Baro: replace gcs().send_text with GCS_SEND_TEXT 2024-08-09 14:53:55 -07:00
AP_BattMonitor AP_BattMonitor: add and use Battery backend internal-use-only flag 2024-08-08 09:12:08 +10:00
AP_Beacon AP_Beacon: allow hwdefs to override number of beacons 2024-08-26 13:48:02 +10:00
AP_BLHeli AP_BLHeli: make AP_Motors::PWMType enum class 2024-08-06 18:15:35 +10:00
AP_BoardConfig AP_BoardConfig: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Button
AP_Camera AP_Camera: create and use an option_is_enabled 2024-08-20 14:50:23 +10:00
AP_CANManager AP_CANManager: use a switch statement to tidy driver allocation 2024-07-25 11:09:07 +10:00
AP_CheckFirmware AP_CheckFirmware: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Common AP_Common: fix initialization of ExpandingString so that it can be used on the stack 2024-07-24 08:24:06 +10:00
AP_Compass AP_Compass: avoid use of MAV_RESULT if mavlink bindings not used 2024-08-14 19:40:31 +10:00
AP_CSVReader
AP_CustomRotations AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DAL AP_DAL: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_DDS AP_DDS: add param DDS_DOMAIN_ID 2024-07-20 19:13:53 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: DNA_Server: arrange db methods into more logical order 2024-08-20 10:22:55 +10:00
AP_EFI AP_EFI: Adding EFIS log for Hirth 2024-08-19 07:11:50 +10:00
AP_ESC_Telem AP_ESC_Telem: getters: check index is in range first 2024-08-20 09:14:11 +10:00
AP_ExternalAHRS AP_ExternalAHRS: Allow InertialLabs to be used as build option properly 2024-08-13 21:32:11 +10:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: BOOL for binary types 2024-07-26 20:12:05 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Frsky_Telem AP_Frsky_Telem: fix for HAL_WITH_FRSKY_TELEM_BIDIRECTIONAL = 0 2024-07-26 20:12:40 +10:00
AP_Generator AP_Generator: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_GPS autotest: include SBF when testing GPS backends work 2024-08-21 06:31:41 +10:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +10:00
AP_GSOF AP_GSOF: Use sparse endian instead of custom code 2024-08-26 13:31:49 +10:00
AP_GyroFFT AP_GyroFFT: move to new constant dt low pass filter class 2024-08-20 09:09:41 +10:00
AP_HAL QURT: allow for external compasses 2024-08-17 13:20:00 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add SPA06 baro for RadiolinkPIX6 2024-08-23 18:38:27 +10:00
AP_HAL_Empty AP_HAL_Empty: removed run_debug_shell 2024-07-11 07:42:54 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_HAL_Linux AP_HAL_Linux: SITL: add missing header for timeval struct on alpine linux 2024-08-15 22:33:42 +10:00
AP_HAL_QURT AP_HAL_QURT: Added support for dual mavlink streams 2024-07-31 10:00:35 +10:00
AP_HAL_SITL AP_HAL_SITL: work around bug in dash 2024-08-07 17:03:52 +10:00
AP_Hott_Telem AP_Hott_Telem: disable Hott telemetry by default 2024-08-06 09:30:49 +10:00
AP_IBus_Telem AP_IBus_Telem: Initial implementation 2024-08-07 14:01:44 +10:00
AP_ICEngine AP_ICEngine: move to new constant dt low pass filter class 2024-08-20 09:09:41 +10:00
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: allow backend filters to be updated independently from a separate thread 2024-08-23 18:34:28 +10:00
AP_InternalError AP_InternalError: fix signedness issue with snprintf 2024-05-22 23:22:23 +10:00
AP_IOMCU AP_IOMCU: add GPIO mask getter and GPIO virtual read 2024-07-31 18:13:01 +10:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_KDECAN AP_KDECAN: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_L1_Control AP_L1_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Landing AP_Landing: restart_landing_sequence get current location and pass it to get_landing_sequence_start 2024-04-02 11:11:59 +11:00
AP_LandingGear AP_LandingGear: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_LeakDetector AP_LeakDetector: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Logger AP_Logger: correctly read file header for block logger 2024-08-13 10:44:35 +10:00
AP_LTM_Telem AP_LTM_Telem: disable LTM telemetry by default 2024-08-06 09:30:49 +10:00
AP_Math AP_Math: correct warning on fabsF 2024-08-13 10:42:23 +10:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission AP_Mission: add and use an option_is_set method 2024-07-29 10:37:52 +10:00
AP_Module AP_Module: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Motors AP_MotorsHeli_RSC: Make variables in constructor const 2024-08-14 23:39:01 -04:00
AP_Mount AP_Mount: correct compilation with HAL_MOUNT_SET_CAMERA_SOURCE_ENABLED off 2024-08-12 17:50:59 +10:00
AP_MSP AP_MSP: cut more code out based on defines 2024-08-12 18:07:21 +10:00
AP_NavEKF AP_NavEKF: option to align extnav to optflow pos estimate 2024-07-09 11:59:36 +10:00
AP_NavEKF2 AP_NavEKF2: added EK2_OPTIONS 2024-08-21 06:32:34 +10:00
AP_NavEKF3 AP_NavEKF3: Corrected logged units 2024-08-07 17:02:28 +10:00
AP_Navigation
AP_Networking AP_Networking: correct compilation when network port registering disabled 2024-08-13 10:46:45 +10:00
AP_NMEA_Output AP_NMEA_Output: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Notify AP_Notify: use default value for DEFAULT_NTF_LED_TYPES for NavIO2 2024-08-14 19:38:48 +10:00
AP_OLC
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpenDroneID AP_OpenDroneID: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpticalFlow AP_OpticalFlow: simplify condition used for building onboard optical flow in 2024-08-13 10:45:31 +10:00
AP_OSD AP_OSD: use highest ESC temp rather than motor temp 2024-08-07 18:10:56 +10:00
AP_Parachute AP_Parachute: optional (CHUTE_OPTIONS:1) disarm defore parachute release 2024-04-10 21:55:51 +10:00
AP_Param AP_Param: throw error if we lose parameters 2024-08-20 09:30:22 +10:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Radio AP_Radio: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_RCMapper AP_RCMapper: exclude body of AP_RCMapper based on AP_RCMAPPER_ENABLED 2024-04-17 18:17:56 +10:00
AP_RCProtocol AP_RCProtocol: remove redundant check for crsf telem on iomcu 2024-06-26 18:13:01 +10:00
AP_RCTelemetry AP_RCTelemetry: add missing gate for AP_VIDEOTX_ENABLED 2024-08-12 17:52:04 +10:00
AP_Relay AP_Relay: added relay output invert function 2024-04-06 10:58:43 +11:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: Allow more instances 2024-08-10 22:37:03 +10:00
AP_RSSI AP_RSSI: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Scripting AP_Scripting: add note about generating code for extension fields 2024-08-24 14:18:53 +01:00
AP_SerialLED
AP_SerialManager AP_SerialManager: Add serial protocol for i-BUS telemetry 2024-08-07 14:01:44 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: add point made public 2024-07-24 17:22:44 +10:00
AP_Soaring AP_Soaring: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Stats AP_Stats: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_SurfaceDistance AP_SurfaceDistance: Start library for tracking the floor/roof distance 2024-05-28 09:55:36 +10:00
AP_TECS AP_TECS: Converted parameter TKOFF_MODE to TKOFF_OPTIONS 2024-07-29 15:50:32 +10:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: add AP_TEMPERATURE_SENSOR_BACKEND_DEFAULT_ENABLED 2024-08-20 09:34:21 +10:00
AP_Terrain AP_Terrain: gate mavlink includes on HAL_GCS_ENABLED 2024-08-14 19:39:16 +10:00
AP_Torqeedo AP_Torqeedo: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: Bindings for crosstrack in Lua 2024-08-20 09:10:42 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands(RushFPV 3.3GHz) 2024-08-13 21:32:56 +10:00
AP_VisualOdom AP_VisualOdom: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Volz_Protocol AP_Volz_Protocol: move output to thread 2024-07-11 13:07:24 +10:00
AP_WheelEncoder AP_WheelEncoder: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Winch AP_Winch: correct compilation when backends compiled out 2024-08-12 18:28:27 +10:00
AP_WindVane AP_WindVane: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
APM_Control APM_Control: move to new constant dt low pass filter class 2024-08-20 09:09:41 +10:00
AR_Motors AR_Motors: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AR_WPNav AR_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
Filter Filter: examples: TransferFunctionCheck: add support for varable DT low pass 2024-08-20 09:09:41 +10:00
GCS_MAVLink GCS_MAVLink: allow cancelling of mission upload by sending MISSION_CLEAR_ALL 2024-08-20 20:46:41 +10:00
PID
RC_Channel RC_Channel: add autotune switch 2024-08-13 08:57:44 +09:00
SITL SITL: correct and augment SBF simulator 2024-08-21 06:31:41 +10:00
SRV_Channel SRV_Channels: find_channel: use channel mask remove need for search over all channels 2024-08-20 09:41:58 +10:00
StorageManager StorageManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
COLCON_IGNORE