.. |
AC_AttitudeControl
|
AC_AttitudeControl: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AC_AutoTune
|
AC_AutoTune: Write_Rate() moved to AC_AttitudeControl
|
2024-09-10 16:33:04 +01:00 |
AC_Autorotation
|
AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false
|
2024-01-17 18:25:55 +11:00 |
AC_Avoidance
|
AC_Avoidance: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AC_CustomControl
|
AC_CustomControl: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +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: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AC_PrecLand
|
AC_PrecLand: remove assumption about how precland update method is called
|
2024-09-24 10:56:57 +09: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: lower WPNAV_SPEED min to 10 cm/s
|
2024-08-30 07:55:50 +09:00 |
APM_Control
|
APM_Control: add missing include for AP::ins()
|
2024-09-06 08:52:01 +10:00 |
AP_ADC
|
AP_ADC: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_ADSB
|
AP_ADSB: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_AHRS
|
AP_AHRS: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_AIS
|
AP_AIS: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_AccelCal
|
AP_AccelCal: remove pointless assignment when counting calibrators
|
2024-01-21 09:53:04 +11:00 |
AP_AdvancedFailsafe
|
AP_AdvancedFailsafe: use GCS_SEND_TEXT rather than gcs().send_text
|
2024-08-07 18:33:16 +10:00 |
AP_Airspeed
|
AP_Airspeed: Don't fail on REG_WHOAMI_RECHECK_ID
|
2024-09-17 10:36:29 +10:00 |
AP_Arming
|
AP_GPS: create real AP_GPS_Blended backend
|
2024-08-27 09:26:06 +10:00 |
AP_Avoidance
|
AP_Avoidance: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_BLHeli
|
AP_BLHeli: make AP_Motors::PWMType enum class
|
2024-08-06 18:15:35 +10:00 |
AP_Baro
|
AP_Baro: SPx06 adds Background mode
|
2024-09-11 18:27:47 +10: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_BoardConfig
|
AP_BoardConfig: use GCS_SEND_TEXT rather than gcs().send_text
|
2024-08-07 18:33:16 +10:00 |
AP_Button
|
…
|
|
AP_CANManager
|
AP_CANManager: ensure we only remove our own fwd registrations
|
2024-09-23 21:01:22 +10:00 |
AP_CSVReader
|
…
|
|
AP_Camera
|
AP_Camera: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +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: fixed cygwin for non-SITL builds
|
2024-09-04 11:12:45 +10:00 |
AP_Compass
|
AP_Compass: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_CustomRotations
|
AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_DAL
|
AP_DAL: add missing include file for Replay build
|
2024-09-06 08:52:01 +10:00 |
AP_DDS
|
AP_DDS: add params for ping timeout and max retries
|
2024-09-24 22:49:49 +10:00 |
AP_Declination
|
…
|
|
AP_Devo_Telem
|
…
|
|
AP_DroneCAN
|
AP_DroneCAN: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_EFI
|
AP_EFI: Hirth: fix sensor health bitmask
|
2024-09-13 18:52:48 +10:00 |
AP_ESC_Telem
|
AP_ESC_Telem: tidy old calls to _telem_data
|
2024-09-11 10:23:00 +10:00 |
AP_ExternalAHRS
|
AP_ExternalAHRS: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_ExternalControl
|
…
|
|
AP_FETtecOneWire
|
AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_Filesystem
|
AP_Filesystem: remove dependency on tmpnam
|
2024-09-24 22:49:18 +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: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_GPS
|
AP_GPS: move initialisation of some members into header
|
2024-09-24 09:30:05 +10:00 |
AP_GSOF
|
AP_GSOF: Use sparse endian instead of custom code
|
2024-08-26 13:31:49 +10:00 |
AP_Generator
|
AP_Generator: use GCS_SEND_TEXT rather than gcs().send_text
|
2024-08-07 18:33:16 +10:00 |
AP_Gripper
|
AP_Gripper: correct emitting of grabbed/released messages
|
2024-06-20 10:59:14 +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
|
AP_HAL: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_HAL_ChibiOS
|
AP_HAL_ChibiOS: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_HAL_ESP32
|
AP_HAL_ESP32: Change the magic number to a defined value
|
2024-09-12 14:23:10 +10:00 |
AP_HAL_Empty
|
AP_HAL_Empty: removed run_debug_shell
|
2024-07-11 07:42:54 +10:00 |
AP_HAL_Linux
|
AP_HAL_Linux: file descriptor leaking and other issues in "Storage" of Linux.
|
2024-09-17 10:09:05 +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: add legacy label to gps and ice params
|
2024-09-06 14:46:50 +10:00 |
AP_IOMCU
|
AP_IOMCU: add support for disabled channels
|
2024-09-04 18:34:10 +10:00 |
AP_IRLock
|
…
|
|
AP_InertialNav
|
AP_InertialNav: remove use of AP_AHRS from most headers
|
2024-09-03 10:35:54 +10:00 |
AP_InertialSensor
|
AP_InertialSensor: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_InternalError
|
AP_InternalError: fix signedness issue with snprintf
|
2024-05-22 23:22:23 +10: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: remove use of AP_AHRS from most headers
|
2024-09-03 10:35:54 +10:00 |
AP_LTM_Telem
|
AP_LTM_Telem: disable LTM telemetry by default
|
2024-08-06 09:30:49 +10: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: restart logging after log transfer
|
2024-09-03 11:01:24 +10:00 |
AP_MSP
|
AP_MSP: MSP_RAW_GPS cog should be decidegrees not centidegrees
|
2024-09-13 12:45:22 +10:00 |
AP_Math
|
AP_Math: add a test for rand_float
|
2024-08-27 11:09:13 +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: Change the magic number to a defined value
|
2024-09-12 14:23:10 +10:00 |
AP_Module
|
AP_Module: remove use of AP_AHRS from most headers
|
2024-09-03 10:35:54 +10:00 |
AP_Motors
|
AP_Motors: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_Mount
|
AP_Mount: create and use AP_Terrain_config.h
|
2024-09-24 11:59:13 +10:00 |
AP_NMEA_Output
|
AP_NMEA_Output: stop passing serial manager to GPS init
|
2024-03-19 07:28:55 +11:00 |
AP_NavEKF
|
AP_NavEKF: define SourceSetSelection enum class and use it for clarity
|
2024-09-08 10:02:29 +10:00 |
AP_NavEKF2
|
AP_NavEKF2: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_NavEKF3
|
AP_NavEKF3: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_Navigation
|
…
|
|
AP_Networking
|
AP_Networking: add connector loopback test for Ethernet
|
2024-09-19 11:44:22 +10:00 |
AP_Notify
|
AP_Notify: Fix compilation error in GPIO_LED_1.cpp
|
2024-08-29 09:37:50 +10:00 |
AP_OLC
|
…
|
|
AP_ONVIF
|
AP_ONVIF: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
AP_OSD
|
AP_OSD: don't go via RCMap singleton to get RPTY RC channels
|
2024-09-17 22:10:53 +10:00 |
AP_OpenDroneID
|
Copter: Give better error in opendroneid build when DID_ENABLE=0.
|
2024-09-17 09:17:24 +10:00 |
AP_OpticalFlow
|
AP_OpticalFlow: simplify condition used for building onboard optical flow in
|
2024-08-13 10:45:31 +10:00 |
AP_Parachute
|
AP_Parachute: remove AUX_FUNC entries based on feature defines
|
2024-09-08 00:55:43 +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_DroneCAN: fix code stype
|
2024-09-10 23:36:44 +10:00 |
AP_RAMTRON
|
…
|
|
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: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_RCTelemetry
|
AP_RCTelemetry: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
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_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_RangeFinder
|
AP_RangeFinder: RDS02UF: avoid nuking partial messages after good parse
|
2024-09-03 14:34:23 +10:00 |
AP_Relay
|
AP_Relay: added relay output invert function
|
2024-04-06 10:58:43 +11:00 |
AP_RobotisServo
|
…
|
|
AP_SBusOut
|
…
|
|
AP_Scheduler
|
AP_Scheduler: record and make available the last sample time
|
2024-09-17 10:12:35 +10:00 |
AP_Scripting
|
AP_Scripting: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
AP_SerialLED
|
…
|
|
AP_SerialManager
|
AP_SerialManager: avoid use of AP_HAL.h in config file
|
2024-09-24 11:59:13 +10:00 |
AP_ServoRelayEvents
|
…
|
|
AP_SmartRTL
|
AP_SmartRTL: add point made public
|
2024-07-24 17:22:44 +10:00 |
AP_Soaring
|
AP_Soaring: remove use of AP_AHRS from most headers
|
2024-09-03 10:35:54 +10:00 |
AP_Stats
|
AP_Stats: update flight time on disarm
|
2024-04-05 11:31:20 +11:00 |
AP_SurfaceDistance
|
AP_SurfaceDistance: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +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: allow AP_TEMPERATURE_SENSOR_DUMMY_METHODS_ENABLED to be overridden
|
2024-09-22 20:34:33 +10:00 |
AP_Terrain
|
AP_Terrain: create and use AP_Terrain_config.h
|
2024-09-24 11:59:13 +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: correct initialisation of WheelRateController objects
|
2024-09-24 10:46:34 +09: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 |
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: re-order initialiser lines so -Werror=reorder will work
|
2024-09-24 22:50:28 +10:00 |
Filter
|
Filter: only update notch on init if fixed
|
2024-09-09 09:29:32 +10:00 |
GCS_MAVLink
|
GCS_MAVLink: Add conditions and delete the same processing
|
2024-09-19 11:44:57 +10:00 |
PID
|
…
|
|
RC_Channel
|
RC_Channel: adjust description of aux function 90 (EK3 Source Set
|
2024-09-16 22:34:34 +10:00 |
SITL
|
SITL: correctly cast types for MegaSquirt error format string
|
2024-09-24 09:00:29 +10:00 |
SRV_Channel
|
SRV_Channel: added lift_release
|
2024-09-10 10:15:34 +10:00 |
StorageManager
|
StorageManager: use NEW_NOTHROW for new(std::nothrow)
|
2024-06-04 09:20:21 +10:00 |
doc
|
treewide: fix shebangs - /bin/bash -> /usr/bin/env bash
|
2024-02-13 11:36:23 +11:00 |
COLCON_IGNORE
|
…
|
|