2 * This file is part of Cleanflight.
4 * Cleanflight is free software: you can redistribute it and/or modify
5 * it under the terms of the GNU General Public License as published by
6 * the Free Software Foundation, either version 3 of the License, or
7 * (at your option) any later version.
9 * Cleanflight is distributed in the hope that it will be useful,
10 * but WITHOUT ANY WARRANTY; without even the implied warranty of
11 * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
12 * GNU General Public License for more details.
14 * You should have received a copy of the GNU General Public License
15 * along with Cleanflight. If not, see <http://www.gnu.org/licenses/>.
26 #include "build/debug.h"
28 #include "blackbox/blackbox.h"
32 #include "common/axis.h"
33 #include "common/maths.h"
34 #include "common/utils.h"
36 #include "config/feature.h"
37 #include "config/parameter_group.h"
38 #include "config/parameter_group_ids.h"
40 #include "drivers/time.h"
43 #include "fc/config.h"
44 #include "fc/controlrate_profile.h"
45 #include "fc/fc_core.h"
46 #include "fc/rc_controls.h"
47 #include "fc/rc_curves.h"
48 #include "fc/rc_modes.h"
49 #include "fc/runtime_config.h"
50 #include "fc/settings.h"
52 #include "flight/pid.h"
53 #include "flight/failsafe.h"
54 #include "flight/mixer.h"
57 #include "io/beeper.h"
59 #include "navigation/navigation.h"
63 #include "sensors/barometer.h"
64 #include "sensors/battery.h"
65 #include "sensors/sensors.h"
66 #include "sensors/gyro.h"
67 #include "sensors/acceleration.h"
69 #define AIRMODE_DEADBAND 25
70 #define MIN_RC_TICK_INTERVAL_MS 20
71 #define DEFAULT_RC_SWITCH_DISARM_DELAY_MS 250 // Wait at least 250ms before disarming via switch
72 #define DEFAULT_PREARM_TIMEOUT 10000 // Prearm is invalidated after 10 seconds
74 stickPositions_e rcStickPositions
;
76 FASTRAM
int16_t rcCommand
[4]; // interval [1000;2000] for THROTTLE and [-500;+500] for ROLL/PITCH/YAW
78 PG_REGISTER_WITH_RESET_TEMPLATE(rcControlsConfig_t
, rcControlsConfig
, PG_RC_CONTROLS_CONFIG
, 4);
80 PG_RESET_TEMPLATE(rcControlsConfig_t
, rcControlsConfig
,
81 .deadband
= SETTING_DEADBAND_DEFAULT
,
82 .yaw_deadband
= SETTING_YAW_DEADBAND_DEFAULT
,
83 .pos_hold_deadband
= SETTING_POS_HOLD_DEADBAND_DEFAULT
,
84 .alt_hold_deadband
= SETTING_ALT_HOLD_DEADBAND_DEFAULT
,
85 .mid_throttle_deadband
= SETTING_3D_DEADBAND_THROTTLE_DEFAULT
,
86 .airmodeHandlingType
= SETTING_AIRMODE_TYPE_DEFAULT
,
87 .airmodeThrottleThreshold
= SETTING_AIRMODE_THROTTLE_THRESHOLD_DEFAULT
,
90 PG_REGISTER_WITH_RESET_TEMPLATE(armingConfig_t
, armingConfig
, PG_ARMING_CONFIG
, 3);
92 PG_RESET_TEMPLATE(armingConfig_t
, armingConfig
,
93 .fixed_wing_auto_arm
= SETTING_FIXED_WING_AUTO_ARM_DEFAULT
,
94 .disarm_always
= SETTING_DISARM_ALWAYS_DEFAULT
,
95 .switchDisarmDelayMs
= SETTING_SWITCH_DISARM_DELAY_DEFAULT
,
96 .prearmTimeoutMs
= SETTING_PREARM_TIMEOUT_DEFAULT
,
99 bool areSticksInApModePosition(uint16_t ap_mode
)
101 return ABS(rcCommand
[ROLL
]) < ap_mode
&& ABS(rcCommand
[PITCH
]) < ap_mode
;
104 bool areSticksDeflected(void)
106 return (ABS(rcCommand
[ROLL
]) > CONTROL_DEADBAND
) || (ABS(rcCommand
[PITCH
]) > CONTROL_DEADBAND
) || (ABS(rcCommand
[YAW
]) > CONTROL_DEADBAND
);
109 bool isRollPitchStickDeflected(uint8_t deadband
)
111 return (ABS(rcCommand
[ROLL
]) > deadband
) || (ABS(rcCommand
[PITCH
]) > deadband
);
114 throttleStatus_e FAST_CODE NOINLINE
calculateThrottleStatus(throttleStatusType_e type
)
116 int value
= rxGetChannelValue(THROTTLE
); // THROTTLE_STATUS_TYPE_RC
117 if (type
== THROTTLE_STATUS_TYPE_COMMAND
) {
118 value
= rcCommand
[THROTTLE
];
121 bool midThrottle
= value
> (reversibleMotorsConfig()->deadband_low
) && value
< (reversibleMotorsConfig()->deadband_high
);
122 if ((feature(FEATURE_REVERSIBLE_MOTORS
) && midThrottle
) || (!feature(FEATURE_REVERSIBLE_MOTORS
) && (value
< rxConfig()->mincheck
))) {
126 return THROTTLE_HIGH
;
129 bool throttleStickIsLow(void)
131 return calculateThrottleStatus(feature(FEATURE_REVERSIBLE_MOTORS
) ? THROTTLE_STATUS_TYPE_COMMAND
: THROTTLE_STATUS_TYPE_RC
) == THROTTLE_LOW
;
134 int16_t throttleStickMixedValue(void)
136 int16_t throttleValue
;
138 throttleValue
= constrain(rxGetChannelValue(THROTTLE
), rxConfig()->mincheck
, PWM_RANGE_MAX
);
139 throttleValue
= (uint16_t)(throttleValue
- rxConfig()->mincheck
) * PWM_RANGE_MIN
/ (PWM_RANGE_MAX
- rxConfig()->mincheck
); // [MINCHECK;2000] -> [0;1000]
140 return rcLookupThrottle(throttleValue
);
143 rollPitchStatus_e
calculateRollPitchCenterStatus(void)
145 if (((rxGetChannelValue(PITCH
) < (PWM_RANGE_MIDDLE
+ AIRMODE_DEADBAND
)) && (rxGetChannelValue(PITCH
) > (PWM_RANGE_MIDDLE
-AIRMODE_DEADBAND
)))
146 && ((rxGetChannelValue(ROLL
) < (PWM_RANGE_MIDDLE
+ AIRMODE_DEADBAND
)) && (rxGetChannelValue(ROLL
) > (PWM_RANGE_MIDDLE
-AIRMODE_DEADBAND
))))
152 stickPositions_e
getRcStickPositions(void)
154 return rcStickPositions
;
157 bool checkStickPosition(stickPositions_e stickPos
)
159 const uint8_t mask
[4] = { ROL_LO
| ROL_HI
, PIT_LO
| PIT_HI
, YAW_LO
| YAW_HI
, THR_LO
| THR_HI
};
160 for (int i
= 0; i
< 4; i
++) {
161 if (((stickPos
& mask
[i
]) != 0) && ((stickPos
& mask
[i
]) != (rcStickPositions
& mask
[i
]))) {
169 static void updateRcStickPositions(void)
171 stickPositions_e tmp
= 0;
173 tmp
|= ((rxGetChannelValue(ROLL
) > rxConfig()->mincheck
) ? 0x02 : 0x00) << (ROLL
* 2);
174 tmp
|= ((rxGetChannelValue(ROLL
) < rxConfig()->maxcheck
) ? 0x01 : 0x00) << (ROLL
* 2);
176 tmp
|= ((rxGetChannelValue(PITCH
) > rxConfig()->mincheck
) ? 0x02 : 0x00) << (PITCH
* 2);
177 tmp
|= ((rxGetChannelValue(PITCH
) < rxConfig()->maxcheck
) ? 0x01 : 0x00) << (PITCH
* 2);
179 tmp
|= ((rxGetChannelValue(YAW
) > rxConfig()->mincheck
) ? 0x02 : 0x00) << (YAW
* 2);
180 tmp
|= ((rxGetChannelValue(YAW
) < rxConfig()->maxcheck
) ? 0x01 : 0x00) << (YAW
* 2);
182 tmp
|= ((rxGetChannelValue(THROTTLE
) > rxConfig()->mincheck
) ? 0x02 : 0x00) << (THROTTLE
* 2);
183 tmp
|= ((rxGetChannelValue(THROTTLE
) < rxConfig()->maxcheck
) ? 0x01 : 0x00) << (THROTTLE
* 2);
185 rcStickPositions
= tmp
;
188 void processRcStickPositions(bool isThrottleLow
)
190 static timeMs_t lastTickTimeMs
= 0;
191 static uint8_t rcDelayCommand
; // this indicates the number of time (multiple of RC measurement at 50Hz) the sticks must be maintained to run or switch off motors
192 static uint32_t rcSticks
; // this hold sticks position for command combos
193 static timeMs_t rcDisarmTimeMs
; // this is an extra guard for disarming through switch to prevent that one frame can disarm it
194 const timeMs_t currentTimeMs
= millis();
196 updateRcStickPositions();
198 uint32_t stTmp
= getRcStickPositions();
199 if (stTmp
== rcSticks
) {
200 if (rcDelayCommand
< 250) {
201 if ((currentTimeMs
- lastTickTimeMs
) >= MIN_RC_TICK_INTERVAL_MS
) {
202 lastTickTimeMs
= currentTimeMs
;
213 bool armingSwitchIsActive
= IS_RC_MODE_ACTIVE(BOXARM
);
215 if (STATE(AIRPLANE
) && ifMotorstopFeatureEnabled() && armingConfig()->fixed_wing_auto_arm
) {
216 // Auto arm on throttle when using fixedwing and motorstop
217 if (!isThrottleLow
) {
223 if (armingSwitchIsActive
) {
224 rcDisarmTimeMs
= currentTimeMs
;
227 emergencyArmingUpdate(armingSwitchIsActive
, false);
228 // Disarming via ARM BOX
229 // Don't disarm via switch if failsafe is active or receiver doesn't receive data - we can't trust receiver
230 // and can't afford to risk disarming in the air
231 if (ARMING_FLAG(ARMED
) && !IS_RC_MODE_ACTIVE(BOXFAILSAFE
) && rxIsReceivingSignal() && !failsafeIsActive()) {
232 const timeMs_t disarmDelay
= currentTimeMs
- rcDisarmTimeMs
;
233 if (disarmDelay
> armingConfig()->switchDisarmDelayMs
) {
234 if (armingConfig()->disarm_always
|| isThrottleLow
) {
235 disarm(DISARM_SWITCH
);
240 rcDisarmTimeMs
= currentTimeMs
;
245 if (rcDelayCommand
!= 20) {
249 /* Disable stick commands when armed, in CLI mode or CMS is active */
250 bool disableStickCommands
= ARMING_FLAG(ARMED
) || cliMode
;
252 disableStickCommands
= disableStickCommands
|| cmsInMenu
;
254 if (disableStickCommands
) {
258 /* REMAINING SECTION HANDLES STICK COMANDS ONLY */
261 if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_LO
+ ROL_CE
) {
262 gyroStartCalibration();
267 #if defined(NAV_NON_VOLATILE_WAYPOINT_STORAGE)
268 // Save waypoint list
269 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_HI
+ ROL_LO
) {
270 const bool success
= saveNonVolatileWaypointList();
271 beeper(success
? BEEPER_ACTION_SUCCESS
: BEEPER_ACTION_FAIL
);
274 // Load waypoint list
275 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_HI
+ ROL_HI
) {
276 const bool success
= loadNonVolatileWaypointList(false);
277 beeper(success
? BEEPER_ACTION_SUCCESS
: BEEPER_ACTION_FAIL
);
279 #ifdef USE_MULTI_MISSION
280 // Increment multi mission index up
281 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_CE
+ ROL_HI
) {
282 selectMultiMissionIndex(1);
287 // Decrement multi mission index down
288 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_CE
+ ROL_LO
) {
289 selectMultiMissionIndex(-1);
294 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_LO
+ ROL_HI
) {
296 beeper(BEEPER_ACTION_FAIL
); // The above cannot fail, but traditionally, we play FAIL for not-loading
300 // Multiple configuration profiles
301 if (feature(FEATURE_TX_PROF_SEL
)) {
305 if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_CE
+ ROL_LO
) // ROLL left -> Profile 1
307 else if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_HI
+ ROL_CE
) // PITCH up -> Profile 2
309 else if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_CE
+ ROL_HI
) // ROLL right -> Profile 3
313 setConfigProfileAndWriteEEPROM(i
- 1);
319 // Multiple battery configuration profiles
320 if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_CE
+ ROL_LO
) // ROLL left -> Profile 1
322 else if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_HI
+ ROL_CE
) // PITCH up -> Profile 2
324 else if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_CE
+ ROL_HI
) // ROLL right -> Profile 3
328 setConfigBatteryProfileAndWriteEEPROM(i
- 1);
329 batteryDisableProfileAutoswitch();
330 activateBatteryProfile();
337 if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_LO
+ ROL_HI
) {
338 saveConfigAndNotify();
342 if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_LO
+ ROL_CE
) {
343 accStartCalibration();
348 if (rcSticks
== THR_HI
+ YAW_HI
+ PIT_LO
+ ROL_CE
) {
349 ENABLE_STATE(CALIBRATE_MAG
);
353 // Accelerometer Trim
354 if (rcSticks
== THR_HI
+ YAW_CE
+ PIT_HI
+ ROL_CE
) {
355 applyAndSaveBoardAlignmentDelta(0, -2);
358 } else if (rcSticks
== THR_HI
+ YAW_CE
+ PIT_LO
+ ROL_CE
) {
359 applyAndSaveBoardAlignmentDelta(0, 2);
362 } else if (rcSticks
== THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_HI
) {
363 applyAndSaveBoardAlignmentDelta(-2, 0);
366 } else if (rcSticks
== THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_LO
) {
367 applyAndSaveBoardAlignmentDelta(2, 0);
373 int32_t getRcStickDeflection(int32_t axis
) {
374 return MIN(ABS(rxGetChannelValue(axis
) - PWM_RANGE_MIDDLE
), 500);