..
AC_PID
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_ADC
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_ADC_AnalogSource
AP_AnalogSource: obsoleted by AP_HAL. Renamed to AP_ADC_AnalogSource.
2012-12-20 14:51:25 +11:00
AP_AHRS
AP_AHRS: port to AP_HAL
2012-12-20 14:51:29 +11:00
AP_Airspeed
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_AnalogSource
AP_AnalogSource: obsoleted by AP_HAL. Renamed to AP_ADC_AnalogSource.
2012-12-20 14:51:25 +11:00
AP_Baro
AP_Baro tests rebase fixups
2012-12-20 14:51:29 +11:00
AP_Buffer
AP_Buffer: ported to AP_HAL
2012-12-20 14:51:29 +11:00
AP_Camera
AP_Camera: ported to AP_HAL
2012-12-20 14:51:30 +11:00
AP_Common
Arduino.mk: norelax.inoflag will disable -Wl,--relax on a per sketch basis
2012-12-20 14:51:29 +11:00
AP_Compass
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_Curve
AP_Curve: made into its own library
2012-12-20 14:51:27 +11:00
AP_Declination
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_GPS
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_HAL
AP_HAL AnalogIn: gets constants for BOARD_VCC and NONE
2012-12-20 14:51:30 +11:00
AP_HAL_AVR
AP_HAL_AVR: AnalogIn channels respect pins, obey NONE input, all common
2012-12-20 14:51:30 +11:00
AP_HAL_PX4
AP_HAL_PX4: added stdio.h
2012-12-20 14:51:29 +11:00
AP_InertialNav
AP_InertialNav: did my best at a meaningful test sketch
2012-12-20 14:51:30 +11:00
AP_InertialSensor
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_LeadFilter
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_Limits
AP_Limits: fix spacing to 80 columns, use standard cpp header guard conventions
2012-12-20 14:51:26 +11:00
AP_Math
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
AP_Menu
AP_Menu: ported to AP_HAL
2012-12-20 14:51:29 +11:00
AP_Motors
AP_Motors: ported to AP_HAL
2012-12-20 14:51:26 +11:00
AP_Mount
AP_Mount: ported to AP_HAL
2012-12-20 14:51:29 +11:00
AP_Navigation
examples: mark some examples as unable to build
2012-11-24 21:09:55 +11:00
AP_OpticalFlow
AP_OpticalFlow: ported to AP_HAL
2012-12-20 14:51:30 +11:00
AP_Param
AP_Param: eeprom translated to use AP_HAL. No unit tests available!
2012-12-20 14:51:29 +11:00
AP_PeriodicProcess
PeriodicProcess: switch to SREG = oldSREG pattern for interrupt mask/restore
2012-11-20 22:31:23 +11:00
AP_PID/examples /AP_pid
AP_Param: #include <AP_Param.h> fixups for libraries & sketches
2012-12-20 14:51:19 +11:00
AP_Progmem
AP_Progmem: check for PX4FMU_BUILD explicitly
2012-12-20 14:51:29 +11:00
AP_RangeFinder
AP_Rangefinder: ported to AP_HAL. Only officially supports MaxsonarXL.
2012-12-20 14:51:30 +11:00
AP_Relay
uncrustify libraries/AP_Relay/AP_Relay.h
2012-08-21 19:04:10 -07:00
AP_Semaphore
AP_Semaphore: ported to AP_HAL
2012-12-20 14:51:29 +11:00
AP_Var/examples /AP_Var
remove AP_Var: deprecated
2012-12-20 14:51:28 +11:00
APM_Control
APM_Control: ported to AP_HAL
2012-12-20 14:51:26 +11:00
APM_OBC
APM_OBC: translate to AP_HAL, make trivial test sketch to test build
2012-12-20 14:51:29 +11:00
APM_PI
AP_Param: #include <AP_Param.h> fixups for libraries & sketches
2012-12-20 14:51:19 +11:00
APM_RC
APM_RC: fixed APM1 example sketch
2012-11-22 15:42:33 +11:00
APO /examples
remove APO library: deprecated
2012-12-20 14:51:27 +11:00
Arduino_Mega_ISR_Registry
uncrustify libraries/Arduino_Mega_ISR_Registry/Arduino_Mega_ISR_Registry.h
2012-08-21 19:04:10 -07:00
DataFlash
DataFlash: fixes to lib include and make the test smaller
2012-12-20 14:51:22 +11:00
Desktop
SITL: prevent the GPS pipe filling up and delaying GPS readings
2012-11-28 14:23:53 +11:00
DigitalWriteFast
DigitalWriteFast: fixed example build
2012-11-24 21:08:36 +11:00
doc
Checking these in makes the libraries too bulky. We need to host them somewhere.
2011-01-04 06:22:02 +00:00
FastSerial
FastSerial: added a vprintf_P() function
2012-11-21 21:41:34 +11:00
Filter
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
GCS_Console
AP_Progmem: fix dependencies for all sketches touched by AP_HAL_AVR
2012-12-20 14:51:28 +11:00
GCS_MAVLink
GCS_MAVLink: wibble to mavlink_helpers.h to fix build.
2012-12-20 14:51:25 +11:00
I2C
I2C:: catch some more types of I2C errors for error count
2012-11-12 11:25:07 +11:00
memcheck
uncrustify libraries/memcheck/memcheck.h
2012-08-21 19:04:31 -07:00
PID
AP_Param: #include <AP_Param.h> fixups for libraries & sketches
2012-12-20 14:51:19 +11:00
RC_Channel
RC_Channel: ported to AP_HAL
2012-12-20 14:51:26 +11:00
SITL
SITL: added SIM_WIND_* parameters
2012-08-25 17:49:26 +10:00
SPI3
SPI3: add checks that SPI bus has been initialised to reduce possibility of interfering with UART3 on APM1
2012-10-18 19:17:24 +09:00