ardupilot/libraries
skyscraper ba9462d13d APM_OBC: Fix up after RC_Channels refactor
Further to refactor of RC_Channel class which included
adding get_xx set_xx methods, change reads and writes to the public members
to calls to  get and set functionsss

old public member(int16_t)   get function -> int16_t     set function (int16_t)
(expression where c is an object of type RC_Channel)
c.radio_in                     c.get_radio_in()           c.set_radio_in(v)
c.control_in                   c.get_control_in()         c.set_control_in(v)
c.servo_out                    c.get_servo_out()          c.set_servo_out(v)
c.pwm_out                      c.get_pwm_out()            // use existing
c.radio_out                    c.get_radio_out()          c.set_radio_out(v)
c.radio_max                    c.get_radio_max()          c.set_radio_max(v)
c.radio_min                    c.get_radio_min()          c.set_radio_min(v)
c.radio_trim                   c.get_radio_trim()         c.set_radio_trim(v);

c.min_max_configured() // return true if min and max are configured

Because data members of RC_Channels are now private and so cannot be written directly
 some overloads are provided in the Plane classes to provide the old functionality

new overload Plane::stick_mix_channel(RC_Channel *channel)
which forwards to the previously existing
void stick_mix_channel(RC_Channel *channel, int16_t &servo_out);

new overload Plane::channel_output_mixer(Rc_Channel* , RC_Channel*)const
which forwards to
(uint8_t mixing_type, int16_t & chan1, int16_t & chan2)const;

Rename functions

 RC_Channel_aux::set_radio_trim(Aux_servo_function_t function)
    to RC_Channel_aux::set_trim_to_radio_in_for(Aux_servo_function_t function)

 RC_Channel_aux::set_servo_out(Aux_servo_function_t function, int16_t value)
    to RC_Channel_aux::set_servo_out_for(Aux_servo_function_t function, int16_t value)

 Rationale:

        RC_Channel is a complicated class, which combines
        several functionalities dealing with stick inputs
        in pwm and logical units, logical and actual actuator
        outputs, unit conversion etc, etc
        The intent of this PR is to clarify existing use of
        the class. At the basic level it should now be possible
        to grep all places where private variable is set by
        searching for the set_xx function.

        (The wider purpose is to provide a more generic and
        logically simpler method of output mixing. This is a small step)
2016-05-10 16:21:15 +10:00
..
AC_AttitudeControl AC_AttControl: remove unused call to motors.set_stabilizing 2016-05-07 10:08:38 +09: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: expose parameters as AP_Float 2016-05-07 18:34:03 +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 AC_Sprayer: replace header guard with pragma once 2016-03-16 18:40:39 +11:00
AC_WPNav AC_WPNav: simplify use of terrain to just current location 2016-04-30 10:33:01 +09: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
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_AHRS: finish implementing have_ekf_logging() 2016-05-07 18:27:20 +10:00
AP_AccelCal AP_AccelCal: check return of get_calibrator 2016-04-23 23:06:27 -07:00
AP_Airspeed Added temperature to the Airspeed.cpp example script 2016-04-29 17:59:11 -03:00
AP_Arming AP_Arming: Fetch GPS configuration failure reason 2016-04-13 11:24:01 -03:00
AP_Baro AP_Baro: allow setHIL to set last update time 2016-05-07 18:27:21 +10: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 Global: use ap_version.h 2016-05-06 13:11:28 -03:00
AP_Compass AP_Compass: allow setting of exact timestamp in HIL compass 2016-05-07 18:27:19 +10: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_GPS: allow Replay to set last sample time 2016-05-07 18:27:23 +10:00
AP_HAL AP_HAL: fix signed and unsigned comparison warning 2016-05-04 08:58:37 -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 HAL_Linux: cope with non-root for Replay 2016-05-07 18:27:17 +10:00
AP_HAL_PX4 HAL_PX4: added comment on oneshot 2016-04-22 13:50:05 +10:00
AP_HAL_QURT HAL_QURT: added uartF 2016-04-20 09:39:49 +10:00
AP_HAL_SITL AP_HAL_SITL: add calibration model 2016-05-10 16:16:37 +10:00
AP_HAL_VRBRAIN HAL_VRBRAIN: added uartF 2016-04-20 09:39:49 +10:00
AP_IRLock AP_IRLock: replace header guard with pragma once 2016-03-16 18:40:41 +11:00
AP_InertialNav AP_InertialNav: replace header guard with pragma once 2016-03-16 18:40:41 +11:00
AP_InertialSensor AP_InertialSensor: added set of delta angle time for replay 2016-04-26 15:50:46 +10:00
AP_L1_Control AP_L1_Control: replace fabsf with labs 2016-04-23 23:06:25 -07:00
AP_LandingGear AP_LandingGear: replace header guard with pragma once 2016-03-16 18:40:41 +11:00
AP_Math AP_Math: matrix_alg: disable FE_OVERFLOW in inverse4x4() for SITL 2016-05-10 16:16:37 +10: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: remove unused set_stabilizing 2016-05-07 10:08:36 +09:00
AP_Mount AP_Mount: replace header guard with pragma once 2016-03-16 18:40:42 +11:00
AP_NavEKF AP_NavEKF: check mag instance id when returning mag offsets 2016-04-21 09:51:41 +10:00
AP_NavEKF2 AP_NavEKF2: use LOG_REPLAY and EK2_LOG_MASK parameters 2016-05-09 12:26:57 +10:00
AP_Navigation AP_L1 - add a stale flag 2016-04-21 21:30:57 -07:00
AP_Notify AP_Notify: improved tones for AP_Tuning 2016-05-09 17:24:38 +10:00
AP_OpticalFlow AP_OpticalFlow: remove trailing whitespaces 2016-04-29 12:10:52 -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_RCMapper AP_RCMapper: 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_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_Relay AP_Relay: replace header guard with pragma once 2016-03-16 18:40:43 +11: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: replace header guard with pragma once 2016-03-16 18:40:43 +11: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: use better tones for next parameter 2016-05-09 17:24:56 +10:00
AP_Vehicle AP_Vehicle: replace header guard with pragma once 2016-03-16 18:40:44 +11:00
DataFlash DataFlash: added imu_mask to Log_Write_IMUDT 2016-05-09 12:26:30 +10:00
Filter Global: start using cmath instead of math.h 2016-04-05 21:06:19 -07:00
GCS_Console GCS_Console: replace header guard with pragma once 2016-03-16 18:40:44 +11:00
GCS_MAVLink GCS_MAVLink: log parameter changes to DataFlash 2016-05-08 19:12:09 +10:00
PID Global: start using cmath instead of math.h 2016-04-05 21:06:19 -07:00
RC_Channel RC_Channel_aux: Rename static member functions 2016-05-10 16:21:15 +10:00
SITL SITL: add SIM_Calibration 2016-05-10 16:16:37 +10:00
StorageManager Revising ardupilot.com to .org 2016-04-23 22:49:40 -07:00
doc