ardupilot/libraries
Willian Galvani e82949d241 AP_HAL_Linux: update Navigator available GPIOs
The comment was wrong. gpio 26 is actually used for the PCA Output Enable signal.
This also adds GPIO18, which is the one broken out to the PWM0 pin
2023-09-04 18:06:37 +10:00
..
AC_AttitudeControl AC_AttitudeControl: tidy AC_PID construction 2023-08-31 11:09:10 +10:00
AC_Autorotation AC_Autorotation: add and use AP_RPM_ENABLED 2022-09-20 09:28:27 +10:00
AC_AutoTune AC_AutoTune: remove unsued variables 2023-07-13 11:02:40 +10:00
AC_Avoidance AC_Avoidance: make _output_level AP_Enum 2023-05-15 09:25:57 +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: remove old polygon fence conversion code 2023-08-16 17:13:31 +10:00
AC_InputManager
AC_PID AC_PID: tidy AC_PID construction 2023-08-31 11:09:10 +10:00
AC_PrecLand AC_PrecLand: fixes for feature disablement 2023-04-05 18:33:19 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: add roi circle_option metadata 2023-07-02 13:15:20 +10:00
AP_AccelCal AP_AccellCal: initialize HAL_INS_ACCELCAL_ENABLED for periph 2023-07-04 05:41:03 -07:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: add missing includes 2023-08-30 12:26:14 +10:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: fixes for macos CAN SITL build 2023-08-29 15:09:48 +10:00
AP_Airspeed AP_Airspeed: increased timeout on DroneCAN airspeed data 2023-08-11 10:33:36 +10:00
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Arming AP_Arming: mag field check vs world magnetic model 2023-08-30 11:17:42 +09:00
AP_Avoidance
AP_Baro AP_Baro: add and use AP_BARO_ENABLED 2023-06-21 22:28:48 +10:00
AP_BattMonitor AP_BattMonitor: expose CAPACITY param on periph 2023-08-30 12:25:46 +10:00
AP_Beacon AP_Beacon: MarvelMind: avoid potentially reading INT32_MAX bytes of input 2023-07-18 11:18:47 +10:00
AP_BLHeli AP_BLHeli: normalize motor index correctly for iomcu running dshot 2023-08-15 06:53:48 +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_Camera AP_Camera: add missing includes 2023-08-30 12:26:14 +10:00
AP_CANManager AP_CANManager: update docs 2023-09-01 13:04:59 +10:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: ensure that constants are float not double if not otherwise declared 2023-08-02 16:22:59 +01:00
AP_Compass AP_Compass: fixes for macos CAN SITL build 2023-08-29 15:09:48 +10:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_CustomRotations
AP_DAL AP_DAL: add missing internalerror include 2023-09-03 08:41:10 +10:00
AP_DDS AP_DDS: Stub out external odom 2023-08-24 07:46:06 +10:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_DroneCAN AP_DroneCAN: use correct define for DroneCAN GPS drivers 2023-09-03 08:43:03 +10:00
AP_EFI EFI: added efi MavLink class 2023-07-11 12:32:19 +10:00
AP_ESC_Telem AP_ESC_Telem: use SIM_CAN_SRV_MSK and fixed throttle dependency 2023-08-24 13:06:40 +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_FlashIface: support OctoSPI flash correctly 2023-04-28 08:31:15 +10:00
AP_FlashStorage AP_FlashStorage: port for STM32L4+ processor 2023-04-14 07:48:56 +10:00
AP_Follow AP_Follow: add and use AP_FOLLOW_ENABLED 2023-08-15 09:57:35 +10:00
AP_Frsky_Telem AP_Frsky_Telem: add build_options.py option to remove fencepoint protocol 2023-08-09 17:53:54 +10:00
AP_Generator AP_Generator: rename generator define to fix feature extraction 2023-08-16 17:35:59 +10:00
AP_GPS AP_GPS: use correct define for DroneCAN GPS drivers 2023-09-03 08:43:03 +10:00
AP_Gripper AP_Gripper: text messages and more defines 2023-04-11 10:31:31 +10:00
AP_GyroFFT
AP_HAL AP_HAL: Delete commented-out processes 2023-09-04 13:55:12 +10:00
AP_HAL_ChibiOS hwdef: Restore I2C2 on HolybroG4_GPS 2023-09-01 13:44:23 +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_ESP32 AP_HAL_ESP32: update esp32empty 2023-09-02 09:43:14 +10:00
AP_HAL_Linux AP_HAL_Linux: update Navigator available GPIOs 2023-09-04 18:06:37 +10:00
AP_HAL_SITL HAL_SITL: support multicast UDP for CAN in SITL 2023-08-29 15:09:48 +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 for ICE with no RPM support 2023-05-30 07:29:55 +10:00
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_IOMCU AP_IOMCU: fix eventing mask and some minor cleanups 2023-08-15 06:53:48 +10:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_JSButton AP_JSButton: add unittest 2023-06-07 17:16:15 +10:00
AP_KDECAN AP_KDECAN: move and rename CAN Driver_Type enumeration 2023-04-20 08:53:46 +10:00
AP_L1_Control AP_L1_Control: Made changes to avoid zero division in proposed formula 2023-08-01 10:01:47 +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_LeakDetector: add manual leak-pin selection 2022-11-12 20:38:35 -03:00
AP_Logger AP_Logger: Align indentation with others 2023-09-04 13:55:43 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Math AP_Math: improve gating of use of AP_InternalError library 2023-08-17 09:16:46 +10:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: show tag or jump index on WP change 2023-08-14 16:55:04 -07:00
AP_Module AP_Module: correct ModuleTest example for lack of GCS object 2022-08-19 18:34:19 +10:00
AP_Motors AP_Motors: correct metadata for H_DDFP_SPIN_MIN param 2023-08-07 07:36:47 -04:00
AP_Mount AP_Mount: Siyi supports rangefinder distance 2023-09-01 10:35:12 +10:00
AP_MSP AP_MSP: remove references to HAL_BUILD_AP_PERIPH 2023-08-09 17:39:49 +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: Allow operation with EK3_SRCx_POSZ = 0 (NONE) 2023-08-23 18:25:26 +10:00
AP_Navigation
AP_Networking Update libraries/AP_Networking/AP_Networking.cpp 2023-08-22 09:25:42 -07:00
AP_NMEA_Output AP_NMEA_Output: remove from 1MB boards 2023-08-15 08:45:30 +10:00
AP_Notify AP_Notify: fixed DroneCAN LEDs 2023-06-24 20:48:08 +10:00
AP_OLC
AP_ONVIF
AP_OpenDroneID AP_OpenDroneID: remove Chip ID as Basic ID mechanism 2023-06-17 14:49:22 +10:00
AP_OpticalFlow AP_OpticalFlow: add missing internalerror include 2023-09-03 08:41:10 +10:00
AP_OSD AP_OSD: added OSD_TYPE2 param to enable dual OSDs backend support 2023-07-13 12:39:19 +10:00
AP_Parachute AP_Parachute: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_Param AP_Param: fixed parameter defaults array length handling 2023-08-22 11:07:30 +10:00
AP_PiccoloCAN AP_PiccoloCAN: remove double-definition of HAL_PICCOLOCAN_ENABLED 2023-06-09 08:00:46 +10:00
AP_Proximity AP_Proximity: Add backend for scripted Lua Driver 2023-08-03 08:02:49 +09:00
AP_Radio AP_Radio: correct build of AP_Radio_bk2425 2023-04-14 20:10:11 +10:00
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: add missing internalerror include 2023-09-03 08:41:10 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: allow for fport without FRSky telem 2023-08-19 20:27:24 +10:00
AP_RCTelemetry AP_RCTelemetry:Surpress DMA warning on H7 bds 2023-08-27 16:18:10 +01:00
AP_Relay AP_Relay: enable sending of RELAY_STATUS message 2023-08-09 07:44:07 +10:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RTC AP_RTC: get-date-and-time returns milliseconds 2023-07-18 21:02:02 +09:00
AP_SBusOut AP_SBusOut: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
AP_Scheduler AP_Scheduler: add and use AP_SCHEDULER_EXTENDED_TASKINFO_ENABLED 2023-06-27 10:43:39 +10:00
AP_Scripting AP_Scripting: added EFI driver for DLA EFI serial protocol 2023-09-03 08:34:33 +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: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_SmartRTL AP_SmartRTL: params always use set method 2022-08-03 13:43:48 +01:00
AP_Soaring
AP_Stats
AP_TECS AP_TECS: remove unused variables 2023-07-13 11:02:40 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: add Source Pitot_tube 2023-08-11 13:20:51 -07:00
AP_Terrain AP_Terrain: fixed build for periph 2023-08-24 13:06:40 +10:00
AP_Torqeedo AP_Torqeedo: allow build for periph 2023-08-24 13:06:40 +10:00
AP_Tuning AP_Tuning: tidy includes 2022-05-03 09:14:58 +10:00
AP_Vehicle AP_Vehicle: add missing include for accelcal 2023-09-04 13:55:27 +10: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: Change name from position to pose 2023-08-10 13:58:00 +09:00
AP_Volz_Protocol AP_Volz_Protocol: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_WheelEncoder
AP_Winch
AP_WindVane AP_WindVane: Enable SITL when it is selected 2023-06-17 14:48:49 +10:00
APM_Control APM_Control: allow autotune FLTD and FLTT updates to be disabled 2023-08-23 18:06:22 +10:00
AR_Motors AP_MotorsUGV: add asymmetry factor for skid-steering 2023-08-22 09:14:42 +09:00
AR_WPNav
doc
Filter Filter: fix notch filter test. 2023-08-02 16:22:59 +01:00
GCS_MAVLink GCS_MAVLink: handle servo/relay events as both command_long and command_int 2023-08-29 11:15:14 +10:00
PID
RC_Channel RC_Channel: add camera functions to RC init 2023-08-29 11:34:51 +10:00
SITL SITL: document SIM_GPS_BYTELOSS and SIM_GPS_NUMSATS 2023-08-31 16:58:06 +10:00
SRV_Channel SRV_Channel: correct description of SERVO_RC_FS_MSK 2023-08-15 08:16:16 +10:00
StorageManager
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00