.. |
AC_AttitudeControl
|
AC_AttitudeControl: use quat.to_euler(Vector3f&)
|
2023-04-19 14:24:45 +10:00 |
AC_AutoTune
|
AC_AutoTune: add option for tuning yaw D-term
|
2023-03-14 11:01:31 +11:00 |
AC_Autorotation
|
…
|
|
AC_Avoidance
|
AC_Avoidance: correct compilation when fence and beacon compiled out
|
2023-04-12 09:24:39 +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
|
AC_WPNav: Provide terrain altitude for surface tracking
|
2023-03-07 13:41:35 +11:00 |
APM_Control
|
…
|
|
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: fixed earth frame accel for EKF3 with significant trim
|
2023-02-28 17:16:39 +11: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: Add missing D in ARSP
|
2023-04-15 23:14:12 +10:00 |
AP_Arming
|
AP_Arming: correct prearm check for mission storage file
|
2023-04-19 18:05:20 +10:00 |
AP_Avoidance
|
…
|
|
AP_BLHeli
|
…
|
|
AP_Baro
|
AP_Baro: text messages and more defines
|
2023-04-11 10:31:31 +10:00 |
AP_BattMonitor
|
AP_BattMonitor: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_Beacon
|
…
|
|
AP_BoardConfig
|
AP_BoardConfig: resetting the BRD_HEAT_TARG to 45 is not needed anymore
|
2023-04-19 17:59:08 +10:00 |
AP_Button
|
…
|
|
AP_CANManager
|
AP_CANManager: remove CANTester
|
2023-04-18 11:43:58 +10:00 |
AP_CSVReader
|
…
|
|
AP_Camera
|
AP_Camera: move ZoomType def to separate .h
|
2023-04-19 17:31:46 +10:00 |
AP_CheckFirmware
|
…
|
|
AP_Common
|
AP_Common: Add same_loc_as function to Location
|
2023-04-04 09:40:45 +10:00 |
AP_Compass
|
AP_Compass: use new vector methods to make for more compact code
|
2023-04-19 14:25:06 +10:00 |
AP_CustomRotations
|
…
|
|
AP_DAL
|
AP_DAL: use MAX_EKF_CORES instead of INS_MAX_INSTANCES in ekf_low_time_remaining
|
2023-03-21 10:04:16 +11:00 |
AP_DDS
|
AP_DDS: Switch BatteryState topic to sensor data QOS
|
2023-04-15 09:40:33 +10:00 |
AP_Declination
|
…
|
|
AP_Devo_Telem
|
…
|
|
AP_DroneCAN
|
AP_DroneCAN: fix DroneCAN run for SITL
|
2023-04-19 17:26:57 +10:00 |
AP_EFI
|
AP_EFI: poll MS at 10Hz not 5Hz
|
2023-04-15 09:39:39 +10:00 |
AP_ESC_Telem
|
AP_ESC_Telem: add and use an AP_ESC_Telem_config.h
|
2023-03-10 08:48:24 +11:00 |
AP_ExternalAHRS
|
AP_ExternalAHRS: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +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: support file rename
|
2023-03-05 09:42:48 +11:00 |
AP_FlashIface
|
AP_FlashIface: add comment on alternate byte usage with fast read
|
2023-03-29 20:49:40 +11:00 |
AP_FlashStorage
|
AP_FlashStorage: port for STM32L4+ processor
|
2023-04-14 07:48:56 +10:00 |
AP_Follow
|
…
|
|
AP_Frsky_Telem
|
…
|
|
AP_GPS
|
AP_GPS_NMEA: fix stringop truncation failure on g++ 9
|
2023-04-18 11:44:57 +10:00 |
AP_Generator
|
AP_Generator: turn RichenPower on on 2MB boards
|
2023-03-22 18:06:31 +11: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: change to 16 bit timeout in event interface
|
2023-04-19 17:26:57 +10:00 |
AP_HAL_ChibiOS
|
AP_HAL_ChibiOS: update MambaF405v2 for ICM42688, bdshot and DMA on UART1
|
2023-04-19 17:47:51 +10:00 |
AP_HAL_ESP32
|
AP_HAL_ESP32: Fix spelling receiver
|
2023-04-06 09:13:09 +10:00 |
AP_HAL_Empty
|
AP_HAL_Empty: add and use a "bool read(c)" method to AP_HAL
|
2023-03-22 17:59:11 +11:00 |
AP_HAL_Linux
|
AP_HAL_Linux: change to 16 bit timeout in event interface
|
2023-04-19 17:26:57 +10:00 |
AP_HAL_SITL
|
AP_HAL_SITL: change to 16 bit timeout in event interface
|
2023-04-19 17:26:57 +10:00 |
AP_Hott_Telem
|
…
|
|
AP_ICEngine
|
…
|
|
AP_IOMCU
|
AP_IOMCU: support forcing heater to enabled with a feature bit
|
2023-03-07 10:33:24 +11:00 |
AP_IRLock
|
…
|
|
AP_InertialNav
|
…
|
|
AP_InertialSensor
|
AP_InertialSensor: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_InternalError
|
AP_InternalError: add waf argument to get consistent builds
|
2023-02-17 20:48:45 +11:00 |
AP_JSButton
|
…
|
|
AP_KDECAN
|
AP_KDECAN: remove prearm and allow better mapping
|
2023-04-17 11:52:52 +10:00 |
AP_L1_Control
|
AP_L1_Control: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_LTM_Telem
|
…
|
|
AP_Landing
|
AP_Landing: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_LandingGear
|
…
|
|
AP_LeakDetector
|
…
|
|
AP_Logger
|
AP_Logger: avoid many method calls logging RCOU
|
2023-04-17 21:28:49 +10:00 |
AP_MSP
|
AP_MSP: add and use RC_Channel_config.h
|
2023-03-22 14:25:09 +11:00 |
AP_Math
|
AP_Math: allow conversion of a quaternion into an rpy Vector3f
|
2023-04-19 14:24:45 +10:00 |
AP_Menu
|
…
|
|
AP_Mission
|
AP_Mount: integrate ZoomType def move out of AP_Camera
|
2023-04-19 17:31:46 +10:00 |
AP_Module
|
…
|
|
AP_Motors
|
AP_Motors: Thrust Linearization: disable density comp in example as baro is not declared
|
2023-04-18 09:32:22 +10:00 |
AP_Mount
|
AP_Mount: integrate ZoomType def move out of AP_Camera
|
2023-04-19 17:31:46 +10:00 |
AP_NMEA_Output
|
AP_NMEA_Output: fix GPGGA hdop, fix, sats
|
2023-03-14 12:45:47 -07:00 |
AP_NavEKF
|
AP_NavEKF: ensure gyro biases are numbers
|
2023-03-21 12:18:33 +11:00 |
AP_NavEKF2
|
AP_NavEKF2: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_NavEKF3
|
AP_NavEKF3: use quat.to_euler(Vector3f&)
|
2023-04-19 14:24:45 +10:00 |
AP_Navigation
|
AP_Navigation: avoid using struct Location
|
2023-02-04 22:51:54 +11:00 |
AP_Notify
|
AP_Notify: text messages and more defines
|
2023-04-11 10:31:31 +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 option to convert home,wind,waypoint and gndspd arrows for BF font set
|
2023-04-08 07:30:33 +10:00 |
AP_OpenDroneID
|
AP_OpenDroneID: rename more variables, types and defines
|
2023-04-11 10:31:31 +10:00 |
AP_OpticalFlow
|
AP_OpticalFlow: rename more variables, types and defines
|
2023-04-11 10:31:31 +10:00 |
AP_Parachute
|
…
|
|
AP_Param
|
AP_Param: added set() to AP_Enum
|
2023-04-14 07:48:24 +10:00 |
AP_PiccoloCAN
|
AP_PiccoloCAN: tidy AP_EFI defines
|
2023-03-21 09:01:13 +11:00 |
AP_Proximity
|
AP_Proximity: include AP_Proximity_Backend.h in AP_Proximity.cpp
|
2023-04-16 12:29:42 +10:00 |
AP_RAMTRON
|
AP_RAMTRON: added PB85RS128C and PB85RS2MC
|
2023-03-19 17:22:53 +11:00 |
AP_RCMapper
|
…
|
|
AP_RCProtocol
|
AP_RCProtocol: add and use RC_Channel_config.h
|
2023-03-22 14:25:09 +11:00 |
AP_RCTelemetry
|
AP_RCTelemetry: add and use AP_RCTelemetry_config.h
|
2023-03-21 08:47:53 +11:00 |
AP_ROMFS
|
…
|
|
AP_RPM
|
…
|
|
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: add and use AP_RangeFinder_config.h
|
2023-04-13 07:07:18 +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: integrate camera_state_t scope change
|
2023-04-19 17:31:46 +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: allow SERIAL1 protocol to be hwdef defined
|
2023-04-08 14:02:29 -07: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_TemperatureSensor: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE
|
2023-04-15 09:33:35 +10:00 |
AP_Terrain
|
AP_Terrain: terrain offset max default to 30m
|
2023-03-14 11:59:49 +11: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: move AP_KDECAN to AP_Vehicle
|
2023-04-17 11:52:52 +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: 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: HarmonicNotch: update FREQ description
|
2023-03-15 18:53:55 +11:00 |
GCS_MAVLink
|
GCS_MAVLink: remove CANTester
|
2023-04-18 11:43:58 +10:00 |
PID
|
PID: use new defualt pattern
|
2023-01-24 10:16:56 +11:00 |
RC_Channel
|
RC_Channel: integrate ZoomType def move out of AP_Camera
|
2023-04-19 17:31:46 +10:00 |
SITL
|
SITL: initialize battery at 0V
|
2023-04-12 15:20:05 +10:00 |
SRV_Channel
|
SRV_Channel: remove CANTester
|
2023-04-18 11:43:58 +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 |