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.
 
 
 
 
 
 
Pat Hickey 9f9c183a4d remove AP_Vector.h as deprecated 12 years ago
..
AC_PID Various example sketches: hal.uart0->begin(115200) is redundant. use console. 12 years ago
APM_Control APM_Control: ported to AP_HAL 12 years ago
APM_OBC AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
APM_PI AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
APM_RC APM_RC: fixed APM1 example sketch 12 years ago
APO/examples remove APO library: deprecated 12 years ago
AP_ADC Fix calls to AP_HAL::Scheduler::register_timer_process 12 years ago
AP_ADC_AnalogSource AP_AnalogSource: obsoleted by AP_HAL. Renamed to AP_ADC_AnalogSource. 12 years ago
AP_AHRS AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
AP_Airspeed HAL_AVR: more uart0 -> console changes 12 years ago
AP_AnalogSource AP_AnalogSource: obsoleted by AP_HAL. Renamed to AP_ADC_AnalogSource. 12 years ago
AP_Baro Fix calls to AP_HAL::Scheduler::register_timer_process 12 years ago
AP_Buffer AP_Buffer: add size 5 float fifo buffer to predeclared types 12 years ago
AP_Camera AP_Camera: add three new parameters DURATION, SERVO_ON and SERVO_OFF to allow better shutter control when using servo. 12 years ago
AP_Common remove AP_Vector.h as deprecated 12 years ago
AP_Compass AP_Compass: ported to AP_HAL 12 years ago
AP_Curve AP_Curve: made into its own library 12 years ago
AP_Declination AP_Declination: translated to AP_HAL 12 years ago
AP_GPS HAL_AVR: more uart0 -> console changes 12 years ago
AP_HAL AP_HAL Scheduler: simplify register_timer_process, min time for delay cb 12 years ago
AP_HAL_AVR AP_HAL Scheduler: simplify register_timer_process, min time for delay cb 12 years ago
AP_HAL_PX4/examples/AP_HAL_Hello examples: mark some examples as unable to build 12 years ago
AP_InertialNav AP_InertialNav_test: small change to #include in example sketch 12 years ago
AP_InertialSensor AP_InertialSensor: ported to AP_HAL 12 years ago
AP_LeadFilter AP_LeadFitler: ported to AP_HAL 12 years ago
AP_Limits AP_Limits: fix spacing to 80 columns, use standard cpp header guard conventions 12 years ago
AP_Math AP_Math: port to work on coreless arduino (AP_HAL) 12 years ago
AP_Menu AP_Menu: allow menus to work on ports other than UART0 12 years ago
AP_Motors AP_Motors: ported to AP_HAL 12 years ago
AP_Mount AP_Mount: resolve compiler warning about unused mount_open variable 12 years ago
AP_Navigation examples: mark some examples as unable to build 12 years ago
AP_OpticalFlow AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
AP_PID/examples/AP_pid AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
AP_Param AP_Param: Port to work with AP_HAL class instead of FastSerial 12 years ago
AP_PeriodicProcess PeriodicProcess: switch to SREG = oldSREG pattern for interrupt mask/restore 12 years ago
AP_RangeFinder AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
AP_Relay uncrustify libraries/AP_Relay/AP_Relay.h 13 years ago
AP_Semaphore Semaphore: switch to SREG = oldSREG pattern for interrupt mask/restore 12 years ago
AP_Var/examples/AP_Var remove AP_Var: deprecated 12 years ago
Arduino_Mega_ISR_Registry uncrustify libraries/Arduino_Mega_ISR_Registry/Arduino_Mega_ISR_Registry.h 13 years ago
DataFlash DataFlash: fixes to lib include and make the test smaller 12 years ago
Desktop SITL: prevent the GPS pipe filling up and delaying GPS readings 12 years ago
DigitalWriteFast DigitalWriteFast: fixed example build 12 years ago
FastSerial FastSerial: added a vprintf_P() function 12 years ago
Filter Various example sketches: hal.uart0->begin(115200) is redundant. use console. 12 years ago
GCS_Console GCS Console: add lib implementing message handling from DATA16 and DATA32 msgs 12 years ago
GCS_MAVLink GCS_MAVLink: wibble to mavlink_helpers.h to fix build. 12 years ago
I2C I2C:: catch some more types of I2C errors for error count 12 years ago
PID AP_Param: #include <AP_Param.h> fixups for libraries & sketches 12 years ago
RC_Channel RC_Channel: ported to AP_HAL 12 years ago
SITL SITL: added SIM_WIND_* parameters 13 years ago
SPI3 SPI3: add checks that SPI bus has been initialised to reduce possibility of interfering with UART3 on APM1 12 years ago
doc Checking these in makes the libraries too bulky. We need to host them somewhere. 14 years ago
memcheck uncrustify libraries/memcheck/memcheck.h 13 years ago