ardupilot/libraries
Andy Piper 43b6fc0dba AP_IOMCU: constrain PWM channels to 8, telem channels to 4 and RC channels to 16
make ADC readings interrupt driven
turn off iomcu updates when debugging
allow for correct number of telemetry channels
cycle between vservo and vrssi when reading adc
build adc with O2
2023-12-18 19:02:52 +11:00
..
AC_AttitudeControl AC_AttitudeControl: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AC_AutoTune AC_AutoTune: add and use header guards 2023-12-12 11:36:15 +11:00
AC_Autorotation AC_Autorotation: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Avoidance AC_Avoidance: Fix some typos 2023-10-12 18:30:42 +11:00
AC_CustomControl AP_CustomControl: use base class AC_AttitudeControl object 2023-12-05 08:08:09 +09:00
AC_Fence AC_Fence: Fix some typos 2023-10-12 18:30:42 +11:00
AC_InputManager
AC_PID AC_PID: use AP_Filter for notch configuration 2023-11-21 13:26:23 +11:00
AC_PrecLand AC_PrecLand: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Sprayer AC_Sprayer: Fix some typos 2023-10-12 18:30:42 +11:00
AC_WPNav AC_WPNav: Fix some typos 2023-10-12 18:30:42 +11:00
APM_Control AR_PosControl: no min speed when stopping 2023-11-28 12:46:46 +09:00
AP_ADC
AP_ADSB AP_ADSB: create and use AP_MAVLINK_MSG_UAVIONIX_ADSB_OUT_STATUS_ENABLED 2023-11-21 13:21:13 +11:00
AP_AHRS AP_AHRS: use EKFType enum class in set_ekf_type() 2023-12-17 09:47:30 +11:00
AP_AIS AP_AIS: Fix some typos 2023-10-12 18:30:42 +11:00
AP_AccelCal AP_AccelCal: Fix some typos 2023-10-12 18:30:42 +11:00
AP_AdvancedFailsafe
AP_Airspeed AP_Airspeed: support external AHRS airspeed sensor 2023-12-17 09:47:30 +11:00
AP_Arming AP_Arming: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Avoidance AP_Avoidance: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_BLHeli AP_BLHeli: add accessor for motor poles and telemetry rate 2023-12-18 19:02:52 +11:00
AP_Baro AP_Baro: Returns directly calculated values 2023-11-18 12:18:36 +11:00
AP_BattMonitor AP_BattMonitor: fixed battery percentage with aux info 2023-11-27 13:02:46 +11:00
AP_Beacon AP_Beacon: fix example when Beacon not available 2023-10-17 18:21:04 +11:00
AP_BoardConfig AP_BoardConfig: add arm/disarm controlled GPIO for module power control 2023-11-18 14:27:05 +11:00
AP_Button
AP_CANManager AP_CANManager: support CAN_Dn_PROTOCOL2 for an aux 11 bit protocol 2023-11-28 11:38:16 +11:00
AP_CSVReader
AP_Camera AP_Camera: Add Camera_Mount handler for CAMERA_CAPTURE_STATUS request 2023-11-09 13:00:57 +09:00
AP_CheckFirmware
AP_Common AP_Common: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Compass AP_Compass: use tesla conversion from AP_Math/definitions.h 2023-12-17 09:47:30 +11:00
AP_CustomRotations
AP_DAL AP_DAL: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_DDS AP_DDS: Add instructions for running HW test 2023-11-22 21:44:35 -08:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: support an aux 11 bit protocol with DroneCAN 2023-11-28 11:38:16 +11:00
AP_EFI AP_EFI : Hirth Driver Addition 2023-11-17 13:09:02 +11:00
AP_ESC_Telem AP_ESC_Telem: don't set up parameters on iofirmware 2023-12-18 19:02:52 +11:00
AP_ExternalAHRS AP_ExternalARHS: Don't offer IMU by default 2023-12-18 16:03:35 +11:00
AP_ExternalControl AP_ExternalControl: Add WARN_IF_UNUSED 2023-11-01 18:30:54 +11:00
AP_FETtecOneWire
AP_Filesystem AP_RTC: fixed build on arm 2023-12-11 18:00:38 +11:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Follow AP_Follow: correct defaulting of AP_FOLLOW_ENABLED 2023-12-08 22:52:18 +11:00
AP_Frsky_Telem AP_Frsky_Telem: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GPS Revert "AP_GPS: GSOF robust config parsing" 2023-11-28 16:09:46 +11:00
AP_Generator AP_Gernerator: FuelCell: rework error check to give error cleared msg 2023-11-28 11:27:14 +11:00
AP_Gripper AP_Gripper: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GyroFFT AP_GyroFFT: Fix some typos 2023-10-12 18:30:42 +11:00
AP_HAL AP_HAL: add methods to directly access erpm array from rcout 2023-12-18 19:02:52 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: cache values of io_dshot() and io_enabled() 2023-12-18 19:02:52 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_Empty AP_HAL_Empty: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_Linux AP_HAL_Linux: add can-zero board 2023-12-05 07:41:06 -06:00
AP_HAL_SITL HAL_SITL: added InertialLabs simulator 2023-12-17 09:47:30 +11:00
AP_Hott_Telem AP_Hott_Telem: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_ICEngine AP_ICEngine: support relay for ignition and I2C for starter 2023-11-17 13:09:02 +11:00
AP_IOMCU AP_IOMCU: constrain PWM channels to 8, telem channels to 4 and RC channels to 16 2023-12-18 19:02:52 +11:00
AP_IRLock
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: added support for writing raw IMU data to a UART 2023-11-30 07:05:02 +11:00
AP_InternalError
AP_JSButton
AP_KDECAN
AP_L1_Control
AP_LTM_Telem
AP_Landing AP_Landing: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: correct compilation with AP_RSSI disabled 2023-12-13 18:30:32 +11:00
AP_MSP AP_MSP: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_Math AP_Math: added crc_sum_of_bytes_16() 2023-12-17 09:47:30 +11:00
AP_Menu
AP_Mission AP_Mission: correct compilation when RC_Channel not enabled 2023-12-12 14:52:36 +11:00
AP_Module
AP_Motors AP_Motors: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_Mount AP_Mount: validate modes before setting them 2023-11-17 11:45:38 +11:00
AP_NMEA_Output AP_NMEA_Output: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_NavEKF
AP_NavEKF2
AP_NavEKF3
AP_Navigation
AP_Networking AP_Networking: added sendfile() 2023-12-11 18:00:38 +11:00
AP_Notify AP_Notify: ensure dshot LEDs work with EDT ESCs 2023-12-18 19:02:52 +11:00
AP_OLC
AP_ONVIF
AP_OSD AP_OSD: correct compilation when RC_Channels library not available 2023-12-12 14:35:12 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: increase scaler param desc ranges 2023-11-14 10:57:30 +11:00
AP_Parachute AP_Parachute: Change to Boolean value 2023-11-11 09:06:42 +09:00
AP_Param AP_Param: check dynamic param tables are avalable before adding a param 2023-11-28 11:22:43 +11:00
AP_PiccoloCAN
AP_Proximity
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: rename crc_sum8 to crc_sum8_with_carry 2023-11-29 18:50:26 +11:00
AP_RCTelemetry AP_RCTelemetry: throttle CRSF request RX device info messages 2023-11-14 10:36:56 +11:00
AP_ROMFS
AP_RPM
AP_RSSI AP_RSSI: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_RTC AP_RTC: added time and date APIs for lua 2023-12-11 18:00:38 +11:00
AP_Radio
AP_Rally AP_Rally: add alt_frame to unused flag bits 2023-11-01 19:06:39 +11:00
AP_RangeFinder AP_RangeFinder: use boolean uartdriver read method 2023-11-29 18:29:11 +11:00
AP_Relay AP_Relay: make set() method public 2023-11-17 13:09:02 +11:00
AP_RobotisServo
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Scripting AP_Scripting: update SkyPower driver to support new model 2023-12-17 14:14:20 +11:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: reserving serial protocol for Vertiq IQUART 2023-12-13 08:12:18 +09:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_Soaring
AP_Stats AP_Stats: initialise parameter defaults 2023-11-22 21:43:00 -08:00
AP_TECS TECS: move to new `using_airspeed_sensor` ahrs method 2023-10-31 10:39:21 +11:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
AP_TemperatureSensor
AP_Terrain AP_Terrain: add get_grid_spacing accessor 2023-11-02 15:54:37 +11:00
AP_Torqeedo
AP_Tuning
AP_Vehicle AP_Vehicle: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: update for new AC_PID settings 2023-11-21 13:26:23 +11:00
AP_Winch AP_Winch: pos control user output fix 2023-10-31 10:37:45 +11:00
AP_WindVane AP_WindVane: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AR_Motors AR_Motors: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AR_WPNav AR_WPNav: correct missing include 2023-12-08 22:53:41 +11:00
Filter Filter: fixed uint8_t bug in total filters and expand_filter_count bug 2023-11-28 18:05:37 +11:00
GCS_MAVLink GCS_MAVLink: correct compilation when AP_Vehicle disabled 2023-12-13 18:34:40 +11:00
PID
RC_Channel RC_Channel: use EKFType enum class 2023-12-17 09:47:30 +11:00
SITL SITL: added InertialLabs simulator 2023-12-17 09:47:30 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
doc
COLCON_IGNORE