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 ca5ee2bfbc AP_Param: correct fetching of flags for parameters 6 years ago
..
AC_AttitudeControl AC_AttitudeControl: Support seperate roll and pitch limits 6 years ago
AC_AutoTune AC_AutoTune: support for upgrade to PID object 6 years ago
AC_Avoidance AC_Avoidance: Dijkstra's returns oa-not-required if path has been completed 6 years ago
AC_Fence AC_Fence: tidy get_breach_distance 6 years ago
AC_InputManager
AC_PID AC_HELI_PID: support for upgrade to PID object 6 years ago
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 6 years ago
AC_Sprayer AC_Sprayer: clean headers 6 years ago
AC_WPNav AC_WPNav: integrate OAPathPlanner 6 years ago
APM_Control AR_AttitudeControl: minor comment fixes 6 years ago
AP_ADC AP_ADC: remove keywords.txt 6 years ago
AP_ADSB AP_ADSB: resolve gcs::send_text compiler warning 6 years ago
AP_AHRS AP_AHRS: var_info is now in GCS_MAVLINK_Parameters 6 years ago
AP_AccelCal AP_AccelCal: remove wrapper around send_text 6 years ago
AP_AdvancedFailsafe AP_Advanced_Failsafe: Reduce scope of AP_Baro.h 6 years ago
AP_Airspeed AP_Airspeed: examples: var_info is now in GCS_MAVLINK_Parameters 6 years ago
AP_Arming AP_Arming: Directly include needed headers 6 years ago
AP_Avoidance AP_Avoidance: stop copying adsb vehicle onto stack in src_id_for_adsb_vehicle 6 years ago
AP_BLHeli AP_BLHeli: Update to support newer targets and protocols 6 years ago
AP_Baro AP_Baro: Directly include needed headers 6 years ago
AP_BattMonitor AP_BattMonitor: Detect bad configuration of failsafes 6 years ago
AP_Beacon AP_Beacon: Common modbus crc method 6 years ago
AP_BoardConfig AP_BoardConfig: fixed AP_Periph build error 6 years ago
AP_Buffer
AP_Button AP_Button: use send_to_active_channels() 6 years ago
AP_Camera AP_Camera: pass mavlink_message_t by const reference 6 years ago
AP_Common AP_Common: Make hexadecimal character number conversion method common 6 years ago
AP_Compass AP_Compass: fixed uninitialised CAN device ID bits 6 years ago
AP_Declination AP_Declination: added get_earth_field_ga() interface 6 years ago
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 6 years ago
AP_Filesystem AP_Filesystem: added set_mtime() call 6 years ago
AP_FlashStorage AP_FlashStorage: added support for STM32F1xx 6 years ago
AP_Follow AP_Follow: correct parameter descriptions 6 years ago
AP_Frsky_Telem AP_FrSkyTelem: Refactor battery current interface 6 years ago
AP_GPS AP_GPS: Directly include needed headers 6 years ago
AP_Gripper AP_Gripper: unify singleton naming to _singleton and get_singleton() 6 years ago
AP_HAL AP_HAL: remove unused HAL_BARO_ defines 6 years ago
AP_HAL_ChibiOS HAL_ChibiOS: convert more boards to use BARO specifier 6 years ago
AP_HAL_Empty HAL_Empty: added uartH 6 years ago
AP_HAL_Linux AP_HAL_Linux: Fix bad check order on heap_realloc 6 years ago
AP_HAL_SITL AP_HAL_SITL: Fix build with --sitl-flash-storage option 6 years ago
AP_ICEngine AP_ICEngine: Add missing header guard 6 years ago
AP_IOMCU AP_IOMCU: use blocking writes to uart 6 years ago
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 6 years ago
AP_InertialNav AP_InertialNav: Remove unneeded methods 6 years ago
AP_InertialSensor AP_InertialSensor: removed old method of specifying most IMUs 6 years ago
AP_InternalError AP_InternalError: added error for i2c isr error 6 years ago
AP_JSButton
AP_KDECAN AP_KDECAN: Fix includes 6 years ago
AP_L1_Control AP_L1_Control: use get_distance_NE instead of location_diff 6 years ago
AP_Landing AP_Landing: Directly include needed headers 6 years ago
AP_LandingGear AP_LandingGear: minor format fix 6 years ago
AP_LeakDetector AP_LeakDetector: add missing override keywords 6 years ago
AP_Logger AP_Logger: Forward declare AHRS 6 years ago
AP_Math AP_Math: add comment to vector2f::point_on_segment 6 years ago
AP_Menu
AP_Mission Revert "AP_Mission: Better AUTO watchdog restore" 6 years ago
AP_Module AP_Module: update example baro include 6 years ago
AP_Motors AP_Motors: Tradheli - Make H3-120 swashplate the default 6 years ago
AP_Mount AP_Mount: stop passing serial manager through to init() 6 years ago
AP_NMEA_Output AP_NMEA_Output: new library for writing NMEA to serial ports 6 years ago
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 7 years ago
AP_NavEKF2 AP_NavEKF2: don't fuse GPS when EK2_GPS_TYPE=3 6 years ago
AP_NavEKF3 AP_NavEKF3: shorten EKF3 initialisation send-text string 6 years ago
AP_Navigation
AP_Notify AP_Notify: convert to use AP_Filesystem 6 years ago
AP_OSD AP_OSD: add primary airspeed item 6 years ago
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 6 years ago
AP_Parachute AP_Parachute: Added time check for sink rate to avoid glitches 6 years ago
AP_Param AP_Param: correct fetching of flags for parameters 6 years ago
AP_Proximity AP_Proximity: use strtol instead of sscanf 6 years ago
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 6 years ago
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 6 years ago
AP_RCProtocol AP_RCProtocol: IBUS remove unused field 6 years ago
AP_ROMFS AP_ROMFS: Add missing header guard 6 years ago
AP_RPM AP_RPM: Added Arduino RPM Sensor Debug Tool 6 years ago
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 6 years ago
AP_RTC AP_RTC: add clarifying comment on get_time_utc 6 years ago
AP_Radio AP_Radio: add missing override keywords 6 years ago
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 6 years ago
AP_RangeFinder RangeFinder: Change to coding style (NFC) 6 years ago
AP_Relay AP_Relay: add AP::relay() to get relay singleton 6 years ago
AP_RobotisServo AP_RobotisServo: fix includes place and order 6 years ago
AP_SBusOut AP_SBusOut: fix includes place and order 6 years ago
AP_Scheduler AP_Scheduler: log I2C ISR count 6 years ago
AP_Scripting AP_Scripting: use AP_Filesystem API 6 years ago
AP_SerialManager AP_SerialManager: added uartH support 6 years ago
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 6 years ago
AP_SmartRTL AP_SmartRTL: rangefinder no longer takes SerialManager in constructor 6 years ago
AP_Soaring AP_Soaring: move include of logger to .cpp file 6 years ago
AP_SpdHgtControl AP_SpdHgtControl: remove unused includes 6 years ago
AP_Stats AP_Stats: Improve reset documentation (NFC) 6 years ago
AP_TECS AP_TECS: prevent rapid changing of pitch limits on landing approach 6 years ago
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 6 years ago
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 7 years ago
AP_Terrain AP_Terrain: Directly include needed headers 6 years ago
AP_ToshibaCAN AP_ToshibaCAN: constify some local variables 6 years ago
AP_Tuning AP_Tuning: tidy includes 6 years ago
AP_UAVCAN AP_UAVCAN: convert to use AP_Filesystem 6 years ago
AP_Vehicle AP_Vehicle: added AP_Periph vehicle type 6 years ago
AP_VisualOdom AP_VisualOdom: Directly include needed headers 6 years ago
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 6 years ago
AP_WheelEncoder AP_WheelEncoder: support for upgrade to PID object 6 years ago
AP_Winch AP_Winch: support for upgrade to PID object 6 years ago
AP_WindVane AP_Windvane: fix NMEA vehicle to earth frame 6 years ago
AR_WPNav AR_WPNav: add oa_wp_bearing_cd function 6 years ago
Filter Filter: Allow all filter frequencies to be 16bit. 6 years ago
GCS_MAVLink GCS_MAVLink: Directly include needed headers 6 years ago
PID Global: rename desired to target in PID info 6 years ago
RC_Channel RC_Channel: unify debounce code 6 years ago
SITL SITL: AirSim: Store last timestamp only 6 years ago
SRV_Channel SRV_Channel: allow DO_SET_SERVO commands while rc pass-thru 6 years ago
StorageManager StorageManager: enable use of a single storage region 6 years ago
doc