.. |
AC_AttitudeControl
|
AC_AttitudeControl: use quat.to_euler(Vector3f&)
|
2023-04-19 14:24:45 +10:00 |
AC_AutoTune
|
AC_AutoTune: load test gains for correct axis when testing yaw D
|
2023-05-17 07:21:53 +10:00 |
AC_Autorotation
|
…
|
|
AC_Avoidance
|
AC_Avoidance: make _output_level AP_Enum
|
2023-05-15 09:25:57 +10:00 |
AC_CustomControl
|
…
|
|
AC_Fence
|
AC_Fence: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AC_InputManager
|
…
|
|
AC_PID
|
AC_PID: AC_PI: fix param defualting
|
2023-02-06 08:09:13 +09:00 |
AC_PrecLand
|
AC_PrecLand: fixes for feature disablement
|
2023-04-05 18:33:19 +10:00 |
AC_Sprayer
|
…
|
|
AC_WPNav
|
AP_Mount: Support for pointing mount to circle center
|
2023-05-08 10:48:20 +10:00 |
APM_Control
|
AR_PosControl: add input_pos_vel_accel target
|
2023-05-30 10:17:13 +10:00 |
AP_ADC
|
…
|
|
AP_ADSB
|
AP_ADSB: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_AHRS
|
AP_AHRS: Add handlers for external lat lng position set
|
2023-06-06 15:19:12 +10:00 |
AP_AIS
|
AP_AIS: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_AccelCal
|
…
|
|
AP_AdvancedFailsafe
|
AP_AdvancedFailsafe: add and use AP_ADVANCEDFAILSAFE_ENABLED
|
2023-02-08 19:00:13 +11:00 |
AP_Airspeed
|
AP_Airspeed: correct includes
|
2023-05-09 10:56:13 +10:00 |
AP_Arming
|
AP_Arming: added BLACKBOX arming method
|
2023-05-18 12:59:09 +10:00 |
AP_Avoidance
|
…
|
|
AP_BLHeli
|
…
|
|
AP_Baro
|
AP_Baro: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_BattMonitor
|
AP_BattMonitor: fix missing method declaration compile failure
|
2023-05-20 17:28:08 +10:00 |
AP_Beacon
|
…
|
|
AP_BoardConfig
|
AP_BoardConfig: fixed documentation of safety options
|
2023-05-26 17:45:32 +10:00 |
AP_Button
|
…
|
|
AP_CANManager
|
AP_CANManager: correct gate on definition of AP_CANManager class
|
2023-04-20 08:53:46 +10:00 |
AP_CSVReader
|
AP_CSVReader: add simple CSV reader
|
2023-01-17 11:21:48 +11:00 |
AP_Camera
|
AP_Camera: remove use of AP_Mount.h from headers
|
2023-05-29 09:08:55 +10:00 |
AP_CheckFirmware
|
…
|
|
AP_Common
|
AP_Common: Remove type punning utils to AP_Math
|
2023-06-05 09:09:13 +10:00 |
AP_Compass
|
AP_Compass: Move health to cpp and add range check
|
2023-05-24 12:39:47 +10:00 |
AP_CustomRotations
|
…
|
|
AP_DAL
|
AP_DAL: Add handlers for external lat lng position set
|
2023-06-06 15:19:12 +10:00 |
AP_DDS
|
AP_DDS: Fix unitialized memory
|
2023-06-06 10:42:02 +10:00 |
AP_Declination
|
…
|
|
AP_Devo_Telem
|
…
|
|
AP_DroneCAN
|
AP_DroneCAN: add msg period measurement to DroneCAN_sniffer
|
2023-05-31 17:31:09 +10:00 |
AP_EFI
|
AP_EFI : Hirth type id is reserved
|
2023-04-24 19:23:19 +10:00 |
AP_ESC_Telem
|
AP_ESC_Telem: Add support for a max rpm check on the motors running check
|
2023-05-02 10:23:55 +10:00 |
AP_ExternalAHRS
|
AP_ExternalAHRS: Use sparse-endian be32to<ftype>_ptr
|
2023-06-05 09:09:13 +10:00 |
AP_FETtecOneWire
|
AP_FETtecOneWire: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_Filesystem
|
AP_Filesystem: enable filesystem format on all boards
|
2023-06-06 15:19:00 +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: support for Mount following the lead vehicle in follow mode
|
2023-05-26 11:10:35 -07:00 |
AP_Frsky_Telem
|
…
|
|
AP_GPS
|
AP_GPS: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_Generator
|
AP_Generator: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_Gripper
|
AP_Gripper: text messages and more defines
|
2023-04-11 10:31:31 +10:00 |
AP_GyroFFT
|
AP_GyroFFT: change default FFT frequency range to something more useful
|
2023-01-24 10:56:33 +11:00 |
AP_HAL
|
AP_HAL: Use new AP_Math utils
|
2023-06-05 09:09:13 +10:00 |
AP_HAL_ChibiOS
|
AP_HAL_ChibiOS: Option to force clock init
|
2023-06-06 19:19:10 +10:00 |
AP_HAL_ESP32
|
AP_HAL_ESP32: new board: esp32s3devkit
|
2023-05-26 10:54:01 -07:00 |
AP_HAL_Empty
|
AP_HAL_Empty: rename QSPIDevice to WSPIDevice
|
2023-04-28 08:31:15 +10:00 |
AP_HAL_Linux
|
AP_HAL_Linux: remove std:: scope from uint16_t
|
2023-05-17 11:15:43 +10:00 |
AP_HAL_SITL
|
AP_HAL_SITL: remove std:: scope from uint16_t
|
2023-05-17 11:15:43 +10:00 |
AP_Hott_Telem
|
…
|
|
AP_ICEngine
|
AP_ICEngine: allow for ICE with no RPM support
|
2023-05-30 07:29:55 +10:00 |
AP_IOMCU
|
AP_IOMCU: Add #pragma once
|
2023-05-24 12:39:47 +10:00 |
AP_IRLock
|
…
|
|
AP_InertialNav
|
…
|
|
AP_InertialSensor
|
AP_InertialSensor: SCHA63T comment fix
|
2023-05-10 17:24:02 +10:00 |
AP_InternalError
|
AP_InternalError: imu resets aren't fatal on esp32
|
2023-05-02 14:38:03 +10:00 |
AP_JSButton
|
…
|
|
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: avoid using struct Location
|
2023-02-04 22:51:54 +11: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: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_LandingGear
|
…
|
|
AP_LeakDetector
|
…
|
|
AP_Logger
|
AP_Logger: make SCR name field instance
|
2023-05-23 10:27:21 +10:00 |
AP_MSP
|
AP_MSP: add and use AP_MSP_config.h
|
2023-05-09 10:56:13 +10:00 |
AP_Math
|
AP_Math: Move conversion utilites next to AP_Math
|
2023-06-05 09:09:13 +10:00 |
AP_Menu
|
…
|
|
AP_Mission
|
AP_Mount: set_focus replaces set_manual/auto_focus
|
2023-04-26 22:55:47 +10:00 |
AP_Module
|
…
|
|
AP_Motors
|
AP_Motors: example: add ability to dump all matrix motor layouts in JSON format
|
2023-05-23 10:18:17 +10:00 |
AP_Mount
|
AP_Mount: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_NMEA_Output
|
AP_NMEA_Output: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_NavEKF
|
AP_NavEKF: ensure gyro biases are numbers
|
2023-03-21 12:18:33 +11:00 |
AP_NavEKF2
|
AP_NavEKF2: handle core setup failure
|
2023-05-08 16:28:08 +10:00 |
AP_NavEKF3
|
AP_NavEKF3: Add handlers for external lat lng position set
|
2023-06-06 15:19:12 +10:00 |
AP_Navigation
|
AP_Navigation: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_Notify
|
AP_Notify: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_OLC
|
AP_OLC: move OSD minimised features to minimize_features.inc
|
2023-02-28 10:40:27 +11:00 |
AP_ONVIF
|
…
|
|
AP_OSD
|
AP_OSD: Add missing labels for new serial protocols
|
2023-05-30 10:07:32 +10:00 |
AP_OpenDroneID
|
AP_OpenDroneID: send dronecan messages directly from update
|
2023-05-31 17:31:09 +10:00 |
AP_OpticalFlow
|
AP_OpticalFlow: add and use AP_OpticalFlow_config.h
|
2023-05-09 10:56:13 +10:00 |
AP_Parachute
|
…
|
|
AP_Param
|
AP_Param: Use math header function names for type punning
|
2023-06-05 09:09:13 +10:00 |
AP_PiccoloCAN
|
AP_PiccoloCAN: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_Proximity
|
AP_Proximity: RPLidarA2 gets S1 support
|
2023-05-16 10:15:23 +10:00 |
AP_RAMTRON
|
AP_RAMTRON: added PB85RS128C and PB85RS2MC
|
2023-03-19 17:22:53 +11:00 |
AP_RCMapper
|
…
|
|
AP_RCProtocol
|
AP_RCProtocol: let compiler elide unused method
|
2023-05-26 14:26:27 +10:00 |
AP_RCTelemetry
|
AP_RCTelemetry: use minimize_features.inc for more features
|
2023-06-06 10:14:02 +10:00 |
AP_ROMFS
|
…
|
|
AP_RPM
|
AP_RPM: prefer AP_Generator_config.h
|
2023-05-14 06:17:33 +10:00 |
AP_RSSI
|
…
|
|
AP_RTC
|
…
|
|
AP_Radio
|
AP_Radio: correct build of AP_Radio_bk2425
|
2023-04-14 20:10:11 +10:00 |
AP_Rally
|
…
|
|
AP_RangeFinder
|
AP_RangeFinder: move and rename CAN Driver_Type enumeration
|
2023-04-20 08:53:46 +10:00 |
AP_Relay
|
…
|
|
AP_RobotisServo
|
AP_RobotisServo: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_SBusOut
|
…
|
|
AP_Scheduler
|
AP_Scheduler: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED
|
2023-02-28 11:26:04 +11:00 |
AP_Scripting
|
AP_Scripting: mount-poi applet sends camera feedback message
|
2023-05-31 10:06:37 +10:00 |
AP_SerialLED
|
AP_SerialLED: add defines for some AP_Notify LED libraries
|
2023-03-07 10:30:13 +11:00 |
AP_SerialManager
|
AP_SerialManager: improve OPTIONS desc for Swap bit
|
2023-05-17 17:34:10 +10:00 |
AP_ServoRelayEvents
|
…
|
|
AP_SmartRTL
|
…
|
|
AP_Soaring
|
…
|
|
AP_Stats
|
…
|
|
AP_TECS
|
AP_TECS: correct metadata for FLARE_HGT
|
2023-04-11 08:54:45 +10:00 |
AP_TempCalibration
|
…
|
|
AP_TemperatureSensor
|
AP_Temperature: slow down temp driver thread and cleanup
|
2023-05-30 13:19:51 -07:00 |
AP_Terrain
|
AP_Terrain: replace HAVE_FILESYSTEM_SUPPORT with backend defines
|
2023-05-17 09:40:39 +10:00 |
AP_Torqeedo
|
AP_Torqeedo: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_Tuning
|
…
|
|
AP_Vehicle
|
AP_Vehicle: implement is_landing and is_taking_off for use by lua
|
2023-05-26 10:59:09 -07: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: allow VisualOdom backends to be compiled in individually
|
2023-04-15 22:19:21 +10: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_Winch: Fix baud rate handling
|
2023-03-04 07:59:23 +09:00 |
AP_WindVane
|
AP_WindVane: use body frame when setting apparent wind in sitl physics backend
|
2023-03-15 12:58:49 +00:00 |
AR_Motors
|
…
|
|
AR_WPNav
|
AR_WPNav: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
Filter
|
Filter: Examples: Add Transfer function check and MATLAB
|
2023-05-23 10:31:13 +10:00 |
GCS_MAVLink
|
GCS_MAVLink: support EXTERNAL_POSITION_ESTIMATE command_int
|
2023-06-06 15:19:12 +10:00 |
PID
|
PID: use new defualt pattern
|
2023-01-24 10:16:56 +11:00 |
RC_Channel
|
RC_Channel: option param desc gets winch control
|
2023-05-25 09:46:23 +10:00 |
SITL
|
SITL: Value Semantics for TOW calc
|
2023-05-31 15:01:31 +10:00 |
SRV_Channel
|
SRV_Channel: move and rename CAN Driver_Type enumeration
|
2023-04-20 08:53:46 +10:00 |
StorageManager
|
StorageManager: fixed startup crash
|
2023-03-12 07:15:01 +11:00 |
doc
|
…
|
|
COLCON_IGNORE
|
Tools: add COLCON_IGNORE to modules and libraries
|
2023-04-19 18:34:15 +10:00 |