You can not select more than 25 topics Topics must start with a letter or number, can include dashes ('-') and can be up to 35 characters long.
 
 
 
 
 
 
Peter Barker b024ff8ea4 AP_Notify: remove unused variables 4 years ago
..
AC_AttitudeControl AC_AttitudeControl: revert Add PosControl PID logging 4 years ago
AC_AutoTune AC_AutoTune: set FLTT to zero while twitching 5 years ago
AC_Autorotation AC_Autorotation: remove unused variables 4 years ago
AC_Avoidance AC_Avoid: hide params with enable flag 4 years ago
AC_Fence AC_Fence: remove dead and misleading assignment 5 years ago
AC_InputManager
AC_PID AC_HELI_PID: spelling in comment, leaded -> leaked 4 years ago
AC_PrecLand AC_PrecLand: correct @User field in ACC_P_NSE documentation 4 years ago
AC_Sprayer
AC_WPNav AC_Circle: add Circle options 4 years ago
APM_Control APM_Control: replace '@User: User' with '@User: Standard' 4 years ago
AP_ADC
AP_ADSB AP_ADSB: remove unused variables 4 years ago
AP_AHRS AP_AHRS: removed duplicate implementation of airspeed_estimate() 5 years ago
AP_AccelCal
AP_AdvancedFailsafe AP_AdvancedFailsafe: Change the unit of barometric pressure from mbar to hPa. 5 years ago
AP_Airspeed AP_Airspeed: added get_num_sensors() 5 years ago
AP_Arming AP_Arming: arming check for osd menu 4 years ago
AP_Avoidance AP_Avoidance: conditionally compile based on ADSB support 4 years ago
AP_BLHeli AP_BLHeli: added have_telem_data() API 4 years ago
AP_Baro AP_Baro: remove unnecessary debug on DPS280 4 years ago
AP_BattMonitor AP_BattMonitor: create and use new AP_HAL::PWMSource object 4 years ago
AP_Beacon AP_Beacon: fix sitl position to be NED 5 years ago
AP_BoardConfig AP_BoardConfig: disable watchdog in examples 4 years ago
AP_Button
AP_CANManager AP_CANManager: fixed build warning for stack size 4 years ago
AP_Camera AP_Camera: keep trying to initialize RunCam after boot 4 years ago
AP_Common AP_Common: Add missing const in AP_FWVersion variables 4 years ago
AP_Compass AP_Compass: add set_dev_id when initialising HIL 4 years ago
AP_Declination
AP_Devo_Telem
AP_EFI
AP_ESC_Telem AP_ESC_Telem: move to using CANManager library 5 years ago
AP_Filesystem AP_Filesystem: increase tasks buffer size 4 years ago
AP_FlashStorage AP_FlashStorage: fixed alignment errors 5 years ago
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: reformat new filed using astyle.sh; no history to lose 4 years ago
AP_GPS AP_GPS: fix type and update reserved bytes in ublox PVT 4 years ago
AP_Generator AP_Generator: remove unused variables 4 years ago
AP_Gripper
AP_GyroFFT AP_GyroFFT: reduce locking to avoid contention and match thread priority to IO 4 years ago
AP_HAL AP_HAL: make bools to use single bit in CANTxItem 4 years ago
AP_HAL_ChibiOS AP_HAL_ChibiOS: disable CANFilter on H7 boards temporarily 4 years ago
AP_HAL_Empty
AP_HAL_Linux AP_HAL_Linux: throw warning if we ever stop-clock backwards 4 years ago
AP_HAL_SITL AP_HAL_SITL: fix segv in examples 4 years ago
AP_Hott_Telem
AP_ICEngine AP_ICEngine: check for valid RC input for ICE 4 years ago
AP_IOMCU AP_IOMCU: fixed handling of RC ignore failsafe option 5 years ago
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: trigger internal error on persistent IMU reset 4 years ago
AP_InternalError AP_InternalError: added imu_reset error 4 years ago
AP_JSButton
AP_KDECAN AP_KDECAN: remove KDECAN example KDECAN test is moved to CANTester 5 years ago
AP_L1_Control
AP_LTM_Telem
AP_Landing AP_Landing: replace '@User: User' with '@User: Standard' 4 years ago
AP_LandingGear
AP_LeakDetector AP_LeakDetector: Remove not used LeakDetector_Type enum 4 years ago
AP_Logger AP_Logger: keep pointer to link rather than using its ->chan 4 years ago
AP_MSP AP_MSP: fixed build warnings for MSP with AP_Periph 4 years ago
AP_Math AP_Math: add bitwise fetch/load 16, 24, 32bit operations 4 years ago
AP_Menu
AP_Mission AP_Mission: add accessor for in_landing_flag() 4 years ago
AP_Module
AP_Motors AP_Motors: eliminate flags structure 4 years ago
AP_Mount AP_Mount: remove unused GPS.h include 4 years ago
AP_NMEA_Output
AP_NavEKF AP_NavEKF: remove unused variables 4 years ago
AP_NavEKF2 AP_NavEKF2: reset body mag variances at key points 4 years ago
AP_NavEKF3 AP_NavEKF3: shorten buffer size send_text message length 4 years ago
AP_Navigation
AP_Notify AP_Notify: remove unused variables 4 years ago
AP_OLC AP_OLC: remove use of algorithm header 4 years ago
AP_OSD AP_OLC: clean namespace and use constexpr instead of init method 4 years ago
AP_OpticalFlow AP_OpticalFlow: aligned msp message data struct name to gps,baro and mag 4 years ago
AP_Parachute
AP_Param AP_Param: add set_and_save_and_notify() 4 years ago
AP_PiccoloCAN AP_PiccoloCAN: Constrain ESC command message rate 4 years ago
AP_Proximity AP_Proximity: resolve ambiguity about which distance is in which sector 5 years ago
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: fix fport rssi 4 years ago
AP_RCTelemetry AP_RCTelemetry: move CRSF link statistics definition to AP_RCProtocol 5 years ago
AP_ROMFS
AP_RPM
AP_RSSI AP_RSSI: create and use new AP_HAL::PWMSource object 4 years ago
AP_RTC
AP_Radio
AP_Rally
AP_RangeFinder AP_RangeFinder: remove default case from Rangefinder init switch 4 years ago
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 5 years ago
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: print task total time as a percentage of all tasks time 4 years ago
AP_Scripting AP_Scripting: remove compile errors and warnings 4 years ago
AP_SerialLED
AP_SerialManager AP_SerialManager: add support for Sagetech protocol 4 years ago
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: fixed build warning on gcc9 4 years ago
AP_Soaring AP_Soaring: Only compile if HAL_SOARING_ENABLED. 4 years ago
AP_SpdHgtControl
AP_Stats
AP_TECS AP_TECS: replace '@User: User' with '@User: Standard' 4 years ago
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: fix snprintf-overflow compilation error 5 years ago
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 5 years ago
AP_Tuning
AP_UAVCAN AP_UAVCAN: disable UAVCAN library when libuavcan drivers are disabled 4 years ago
AP_Vehicle AP_Vehicle: move orderly rebooting code from GCS into AP_Vehicle 4 years ago
AP_VisualOdom AP_VisualOdom: Shorten the distinguished name. 5 years ago
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 4 years ago
AP_WindVane AP_WindVane: report apparent wind with named float 4 years ago
AR_WPNav AR_WPNav: minor param description typo fix 5 years ago
Filter Filter: return active harmonics based on dynamic harmonic enablement 5 years ago
GCS_MAVLink GCS_MAVLink: move orderly rebooting code from GCS into AP_Vehicle 4 years ago
PID
RC_Channel RC_Channel: conditionlly compile in ADSB support 4 years ago
SITL SITL: adjust for START_STOP_D now not polluting global namespace 4 years ago
SRV_Channel SRV_Channels: refactor zero_rc_outputs() out of GCS_Mavlink 4 years ago
StorageManager
doc