Ardupilot2/libraries
Lucas De Marchi 388a6683ad AP_OpticalFlow: fix optical flow initialization
This fixes the initialization for Linux boards using the PX4Flow module.
The problem is that after the conversion to use I2CDevice we now need to
use I2CDeviceManager, which is statically constructed after the vehicle
object.

So, if we try to call hal.i2c_mgr->get_device(), it will call the
get_device() method before the constructor is called and receive a
SIGSEGV:

Program received signal SIGSEGV, Segmentation fault.
0x000b06c0 in OpticalFlow::OpticalFlow (this=0x140914 <copter+4980>, ahrs=...)
    at ../../libraries/AP_OpticalFlow/OpticalFlow.cpp:54
54      ../../libraries/AP_OpticalFlow/OpticalFlow.cpp: No such file or directory.
2016-05-13 11:22:12 -03:00
..
AC_AttitudeControl AC_AttitudeControl: removed use of AFF for tail control in heli 2016-05-12 17:37:22 +10:00
AC_Fence AC_Fence: replace header guard with pragma once 2016-03-16 18:40:39 +11:00
AC_InputManager AC_InputManager_Heli: get_pilot_desired_throttle in 0 to 1 range 2016-04-01 11:59:30 +09:00
AC_PID AC_PID: removed AFF from heli PID 2016-05-12 17:37:01 +10:00
AC_PrecLand AC_PrecLand: remove PI controller, speed limits as they are unused 2016-05-06 11:04:12 +09:00
AC_Sprayer AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AC_WPNav AP_Math: Replace is_equal with a type safe template function 2016-05-10 11:41:26 -03:00
AP_AccelCal AP_AccelCal: check return of get_calibrator 2016-04-23 23:06:27 -07:00
AP_ADC AP_ADC: fix warning on printf 2016-05-04 08:58:37 -03:00
AP_ADSB AP_ADSB: replace header guard with pragma once 2016-03-16 18:40:39 +11:00
AP_AHRS AP_Math: Replace is_equal with a type safe template function 2016-05-10 11:41:26 -03:00
AP_Airspeed AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_Arming AP_Arming: Fetch GPS configuration failure reason 2016-04-13 11:24:01 -03:00
AP_Baro AP_Baro: BMP085: use a moving average of 10 samples in BMP085 2016-05-10 14:24:59 -03:00
AP_BattMonitor AP_BattMonitor: make param BATT_WATT_MAX plane only 2016-04-21 13:59:45 -07:00
AP_BoardConfig AP_BoardConfig: use hal.rcout->enable_sbus_out() 2016-04-16 07:30:43 +10:00
AP_Buffer AP_Buffer: replace header guard with pragma once 2016-02-18 14:52:34 -02:00
AP_Camera AP_Camera: clearer parameter docs for trigger pin 2016-04-15 09:33:47 +10:00
AP_Common AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_Compass AP_Compass: add an extra rotation for internal LSM9DS1 on Navio2 2016-05-10 17:24:43 -03:00
AP_Declination Global: start using cmath instead of math.h 2016-04-05 21:06:19 -07:00
AP_EPM Revising ardupilot.com to .org 2016-04-23 22:49:41 -07:00
AP_Frsky_Telem AP_Frsky_Telem: remove unnecessary abs 2016-04-23 23:06:22 -07:00
AP_GPS AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_HAL AP_Compass: added external compass autodetection on Navio 2016-05-10 17:24:43 -03:00
AP_HAL_AVR HAL_AVR: update URL 2016-03-25 20:47:35 +11:00
AP_HAL_Empty HAL_Empty: added uartF 2016-04-20 09:39:49 +10:00
AP_HAL_FLYMAPLE Revising ardupilot.com to .org 2016-04-23 22:49:45 -07:00
AP_HAL_Linux AP_HAL_Linux: Scheduler: set stack sizes to 256k 2016-05-12 13:35:23 -03:00
AP_HAL_PX4 AP_HAL_PX4: fixed hexacopter on Pixracer 2016-05-11 13:01:15 +10:00
AP_HAL_QURT HAL_QURT: added uartF 2016-04-20 09:39:49 +10:00
AP_HAL_SITL AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_HAL_VRBRAIN HAL_VRBRAIN: added uartF 2016-04-20 09:39:49 +10:00
AP_InertialNav AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_InertialSensor AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_IRLock AP_IRLock: replace header guard with pragma once 2016-03-16 18:40:41 +11:00
AP_L1_Control AP_L1_Control: remove tabs and trailing whitespaces 2016-05-10 11:41:26 -03:00
AP_LandingGear AP_LandingGear: replace header guard with pragma once 2016-03-16 18:40:41 +11:00
AP_Math AP_Math: use inline wrappers for constrain_* functions 2016-05-11 22:51:19 -03:00
AP_Menu AP_Menu: replace header guard with pragma once 2016-03-16 18:40:42 +11:00
AP_Mission AP_Mission: Added mavlink_cmd_long_to_mission_cmd method. 2016-05-06 11:59:44 -07:00
AP_Motors AP_Motors: added hook for vehicle based thrust compensation 2016-05-11 05:55:23 +10:00
AP_Mount AP_Mount: block forwarding of MAVlink by bitmask 2016-05-12 17:44:09 +10:00
AP_NavEKF AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_NavEKF2 AP_Math: Replace the pythagorous* functions with a variadic template 2016-05-10 11:41:26 -03:00
AP_Navigation AP_L1 - add a stale flag 2016-04-21 21:30:57 -07:00
AP_Notify AP_Notify: play vehicle lost tone 2016-05-11 22:49:52 -03:00
AP_OpticalFlow AP_OpticalFlow: fix optical flow initialization 2016-05-13 11:22:12 -03:00
AP_Parachute AP_Parachute: resolve compile warning re init order 2016-04-22 21:32:35 +09:00
AP_Param AP_Param: explicitly cast to float to avoid Clang warning 2016-04-22 17:33:06 +01:00
AP_Rally AP_Rally: replace header guard with pragma once 2016-03-16 18:40:42 +11:00
AP_RangeFinder AP_RangeFinder: add Bebop and MAVLink types 2016-05-04 15:00:48 +09:00
AP_RCMapper AP_RCMapper: replace header guard with pragma once 2016-03-16 18:40:43 +11:00
AP_Relay AP_Relay: replace header guard with pragma once 2016-03-16 18:40:43 +11:00
AP_RPM Global: start using cmath instead of math.h 2016-04-05 21:06:19 -07:00
AP_RSSI AP_RSSI: use fabsf instead of abs 2016-04-23 23:06:26 -07:00
AP_Scheduler AP_Scheduler: added optional perf counters at SCHED_DEBUG >= 4 2016-04-21 16:45:02 +10:00
AP_SerialManager AP_SerialManager: changed default for SERIAL4_PROTOCOL to 5 2016-05-05 08:08:30 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: Fix up after RC_Channels refactor 2016-05-10 16:21:15 +10:00
AP_SpdHgtControl AP_TECS: created accessor for TECS_LAND_ARSPD param 2016-04-21 21:30:48 -07:00
AP_TECS AP-TECS: constrain proportion to 0-1 for spdweight scale so it doesn't grow backup after land point 2016-04-21 21:31:02 -07:00
AP_Terrain AP_Terrain: update comments for height_terrain_difference_home 2016-04-30 10:33:01 +09:00
AP_Tuning AP_Tuning: Fix up after RC_Channels refactor 2016-05-10 16:21:16 +10:00
AP_Vehicle AP_Vehicle: replace header guard with pragma once 2016-03-16 18:40:44 +11:00
APM_Control APM_Control: expose parameters as AP_Float 2016-05-07 18:34:06 +10:00
APM_OBC APM_OBC: Fix up after RC_Channels refactor 2016-05-10 16:21:15 +10:00
DataFlash DataFlash: added imu_mask to Log_Write_IMUDT 2016-05-09 12:26:30 +10:00
doc Checking these in makes the libraries too bulky. We need to host them somewhere. 2011-01-04 06:22:02 +00:00
Filter Filter: add AverageFilter variant to save current sum 2016-05-10 14:24:59 -03:00
GCS_Console GCS_Console: replace header guard with pragma once 2016-03-16 18:40:44 +11:00
GCS_MAVLink GCS_MAVLink: add route mask for blocking MAVlink forwading 2016-05-12 17:44:06 +10:00
PID Global: start using cmath instead of math.h 2016-04-05 21:06:19 -07:00
RC_Channel RC_Channel: added motor tilt auxillary channel 2016-05-11 05:55:23 +10:00
SITL SITL: setsid() when starting JSBSim so Ctrl-C doesn't kill it in GDB 2016-05-11 14:10:48 +10:00
StorageManager Revising ardupilot.com to .org 2016-04-23 22:49:40 -07:00