..
AC_AttitudeControl
AC_PosControl: default gains for sub
7 years ago
AC_Avoidance
AC_Avoid: reduce min and default DIST_MAX values
7 years ago
AC_Fence
AC_Fence: hide ALT_MAX parameter from Rover
7 years ago
AC_InputManager
…
AC_PID
AC_PID: fixes after peer review of AC_PID_2D
7 years ago
AC_PrecLand
…
AC_Sprayer
…
AC_WPNav
AC_WPNav: minor formatting fix
7 years ago
APM_Control
AR_AttitudeControl: minor arg name fix
7 years ago
AP_ADC
…
AP_ADSB
AP_ADSB: fixed build warning
7 years ago
AP_AHRS
AP_AHRS: fixed AP_MODULE_SUPPORTED
7 years ago
AP_AccelCal
…
AP_AdvancedFailsafe
AP_AdvancedFailsafe: Report MAV_PROTOCOL_CAPABILITY_FLIGHT_TERMINATION
7 years ago
AP_Airspeed
AP_Airspeed: Fix ARSPD2_TYPE docs
7 years ago
AP_Arming
AP_Arming: check all airspeed sensors are healthy
7 years ago
AP_Avoidance
…
AP_Baro
AP_Baro: fixed baro scaling for LPS2XH
7 years ago
AP_BattMonitor
AP_BattMonitor: allow hwdef.dat config of battery pins
7 years ago
AP_Beacon
AP_Beacon: fixed example build on ChibiOS
7 years ago
AP_BoardConfig
AP_BoardConfig: add param defaults for EMLID_EDGE for CAN_DRIVER=1
7 years ago
AP_Buffer
…
AP_Button
…
AP_Camera
AP_Camera: delete \n from the log using gcs().send_text
7 years ago
AP_Common
AP_Common: added ARRAY_SIZE_SIMPLE()
7 years ago
AP_Compass
AP_Compass: fixed compass orientation for mini-pix
7 years ago
AP_Declination
AP_Declination: added inclination and intensity tables
7 years ago
AP_FlashStorage
AP_FlashStorage: fixed two bugs found by night-ghost
7 years ago
AP_Frsky_Telem
AP_Frsky_Telem: fixed build warnings
7 years ago
AP_GPS
AP_GPS: add param defaults for EMLID_EDGE for GPS_TYPE=9
7 years ago
AP_Gripper
AP_Gripper: build fix for ChibiOS
7 years ago
AP_HAL
AP_HAL: use 1/0 not HIGH/LOW for LEDs in ChibiOS
7 years ago
AP_HAL_AVR
…
AP_HAL_ChibiOS
HAL_ChibiOS: fixed RCIN on revo-mini
7 years ago
AP_HAL_Empty
HAL_Empty: fixed I2C get_device() interface
7 years ago
AP_HAL_F4Light
modules: added submodules for HAL_F4Light
7 years ago
AP_HAL_FLYMAPLE
…
AP_HAL_Linux
AP_HAL_Linux: rpi: sort include headers
7 years ago
AP_HAL_PX4
HAL_PX4: used cypress bus defines
7 years ago
AP_HAL_QURT
HAL_QURT: implement _timer_tick in UARTDriver
7 years ago
AP_HAL_SITL
HAL_SITL: implement _timer_tick in UARTDriver
7 years ago
AP_HAL_VRBRAIN
HAL_VRBrain: Storage::_timer_tick is an override
7 years ago
AP_ICEngine
…
AP_IOMCU
AP_IOMCU: fix data type for available bytes
7 years ago
AP_IRLock
…
AP_InertialNav
…
AP_InertialSensor
AP_InertialSensor: add ins() to AP:: namespace
7 years ago
AP_JSButton
…
AP_L1_Control
…
AP_Landing
…
AP_LandingGear
…
AP_LeakDetector
…
AP_Math
AP_Math: add Vector2f::circle_segment_intersection
7 years ago
AP_Menu
…
AP_Mission
…
AP_Module
AP_Module: fixed AP_MODULE_SUPPORTED defines
7 years ago
AP_Motors
AP_Motors: reduce unnecessary multiple call of get_compensation_gain()
7 years ago
AP_Mount
…
AP_NavEKF
…
AP_NavEKF2
AP_NavEKF2: allocate NavEKF core from MEM_FAST region
7 years ago
AP_NavEKF3
AP_NavEKF3: delete \n from the log using gcs().send_text
7 years ago
AP_Navigation
…
AP_Notify
AP_Notify: allow ChibiOS to use PixracerLED driver
7 years ago
AP_OpticalFlow
AP_OpticalFlow: enable pixart flow on PCNC1 boards
7 years ago
AP_Parachute
…
AP_Param
AP_Param: added back key dumping code
7 years ago
AP_Param_Helper
AP_Param_Helper: param table support for HAL
7 years ago
AP_Proximity
…
AP_RAMTRON
AP_RAMTRON: added RAMTRON fram device driver
7 years ago
AP_RCMapper
…
AP_RCProtocol
AP_RCProtocol: tidy up frontend/backend split
7 years ago
AP_RPM
VRBRAIN / AP_RPM: removed RPM_PX4_PWM for VR Brain 5.1 and VR Micro Brain 5.2 (they haven't this input pin)
7 years ago
AP_RSSI
…
AP_Radio
AP_Radio: allow build of AP_Radio under PX4
7 years ago
AP_Rally
…
AP_RangeFinder
VRBRAIN / AP_RangeFinder: removed AP_RangeFinder_PX4_PWM for VR Brain boards
7 years ago
AP_Relay
…
AP_SBusOut
…
AP_Scheduler
AP_Scheduler: initialise _last_loop_time_s in init()
7 years ago
AP_SerialManager
AP_SerialManager: allow hwdef.dat setup of serial5 config
7 years ago
AP_ServoRelayEvents
…
AP_SmartRTL
AP_SmartRTL: attempts to set home in update
7 years ago
AP_Soaring
AP_Soaring: delete \n from the log using gcs().send_text
7 years ago
AP_SpdHgtControl
…
AP_Stats
…
AP_TECS
…
AP_TempCalibration
AP_TempCalibration: fixed build warning
7 years ago
AP_TemperatureSensor
…
AP_Terrain
AP_Terrain: fix snprintf buffer length warning
7 years ago
AP_Tuning
…
AP_UAVCAN
AP_UAVCAN: non-functional change - fix style
7 years ago
AP_Vehicle
…
AP_VisualOdom
…
AP_Volz_Protocol
…
AP_WheelEncoder
AP_WheelEncoder: hide parameters by default
7 years ago
AP_Winch
…
DataFlash
DataFlash: move logging of PM messages to AP_Scheduler
7 years ago
Filter
…
GCS_MAVLink
GCS_MAVLink: added DATA96 hook for AP_Radio
7 years ago
PID
…
RC_Channel
RC_Channel: added set_and_save_radio_trim()
7 years ago
SITL
SITL: use AP_Declination for magnetic tables
7 years ago
SRV_Channel
SRV_Channels: fix for replay
7 years ago
StorageManager
StorageManager: fixed header order
7 years ago
doc
…