2 * This file is part of Cleanflight and Betaflight.
4 * Cleanflight and Betaflight are free software. You can redistribute
5 * this software and/or modify this software under the terms of the
6 * GNU General Public License as published by the Free Software
7 * Foundation, either version 3 of the License, or (at your option)
10 * Cleanflight and Betaflight are distributed in the hope that they
11 * will be useful, but WITHOUT ANY WARRANTY; without even the implied
12 * warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.
13 * See the GNU General Public License for more details.
15 * You should have received a copy of the GNU General Public License
16 * along with this software.
18 * If not, see <http://www.gnu.org/licenses/>.
29 #include "blackbox/blackbox.h"
31 #include "build/build_config.h"
33 #include "common/axis.h"
34 #include "common/maths.h"
36 #include "config/feature.h"
38 #include "drivers/camera_control.h"
40 #include "config/config.h"
43 #include "fc/runtime_config.h"
45 #include "flight/pid.h"
46 #include "flight/failsafe.h"
48 #include "io/beeper.h"
49 #include "io/usb_cdc_hid.h"
50 #include "io/dashboard.h"
52 #include "io/vtx_control.h"
55 #include "pg/pg_ids.h"
60 #include "scheduler/scheduler.h"
62 #include "sensors/acceleration.h"
63 #include "sensors/barometer.h"
64 #include "sensors/battery.h"
65 #include "sensors/compass.h"
66 #include "sensors/gyro.h"
68 #include "rc_controls.h"
70 // true if arming is done via the sticks (as opposed to a switch)
71 static bool isUsingSticksToArm
= true;
73 float rcCommand
[4]; // interval [1000;2000] for THROTTLE and [-500;+500] for ROLL/PITCH/YAW
75 PG_REGISTER_WITH_RESET_TEMPLATE(rcControlsConfig_t
, rcControlsConfig
, PG_RC_CONTROLS_CONFIG
, 0);
77 PG_RESET_TEMPLATE(rcControlsConfig_t
, rcControlsConfig
,
80 .alt_hold_deadband
= 40,
81 .alt_hold_fast_change
= 1,
82 .yaw_control_reversed
= false,
85 PG_REGISTER_WITH_RESET_TEMPLATE(armingConfig_t
, armingConfig
, PG_ARMING_CONFIG
, 1);
87 PG_RESET_TEMPLATE(armingConfig_t
, armingConfig
,
88 .gyro_cal_on_first_arm
= 0, // TODO - Cleanup retarded arm support
89 .auto_disarm_delay
= 5
92 PG_REGISTER_WITH_RESET_TEMPLATE(flight3DConfig_t
, flight3DConfig
, PG_MOTOR_3D_CONFIG
, 0);
93 PG_RESET_TEMPLATE(flight3DConfig_t
, flight3DConfig
,
94 .deadband3d_low
= 1406,
95 .deadband3d_high
= 1514,
97 .deadband3d_throttle
= 50,
100 .switched_mode3d
= false
103 bool isUsingSticksForArming(void)
105 return isUsingSticksToArm
;
108 bool areSticksInApModePosition(uint16_t ap_mode
)
110 return fabsf(rcCommand
[ROLL
]) < ap_mode
&& fabsf(rcCommand
[PITCH
]) < ap_mode
;
113 throttleStatus_e
calculateThrottleStatus(void)
115 if (featureIsEnabled(FEATURE_3D
)) {
116 if (IS_RC_MODE_ACTIVE(BOX3D
) || flight3DConfig()->switched_mode3d
) {
117 if (rcData
[THROTTLE
] < rxConfig()->mincheck
) {
120 } else if ((rcData
[THROTTLE
] > (rxConfig()->midrc
- flight3DConfig()->deadband3d_throttle
) && rcData
[THROTTLE
] < (rxConfig()->midrc
+ flight3DConfig()->deadband3d_throttle
))) {
123 } else if (rcData
[THROTTLE
] < rxConfig()->mincheck
) {
127 return THROTTLE_HIGH
;
130 #define ARM_DELAY_MS 500
131 #define STICK_DELAY_MS 50
132 #define STICK_AUTOREPEAT_MS 250
133 #define repeatAfter(t) { \
135 doNotRepeat = false; \
138 void processRcStickPositions(void)
140 // time the sticks are maintained
141 static int16_t rcDelayMs
;
142 // hold sticks position for command combos
143 static uint8_t rcSticks
;
144 // an extra guard for disarming through switch to prevent that one frame can disarm it
145 static uint8_t rcDisarmTicks
;
146 static bool doNotRepeat
;
147 static bool pendingApplyRollAndPitchTrimDeltaSave
= false;
149 // checking sticks positions
151 for (int i
= 0; i
< 4; i
++) {
153 if (rcData
[i
] > rxConfig()->mincheck
) {
154 stTmp
|= 0x80; // check for MIN
156 if (rcData
[i
] < rxConfig()->maxcheck
) {
157 stTmp
|= 0x40; // check for MAX
160 if (stTmp
== rcSticks
) {
161 if (rcDelayMs
<= INT16_MAX
- (getTaskDeltaTimeUs(TASK_SELF
) / 1000)) {
162 rcDelayMs
+= getTaskDeltaTimeUs(TASK_SELF
) / 1000;
171 if (!isUsingSticksToArm
) {
172 if (IS_RC_MODE_ACTIVE(BOXARM
)) {
174 // Arming via ARM BOX
178 // Disarming via ARM BOX
179 resetArmingDisabled();
180 const bool switchFailsafe
= (failsafeIsActive() && (IS_RC_MODE_ACTIVE(BOXFAILSAFE
) || IS_RC_MODE_ACTIVE(BOXGPSRESCUE
)));
181 if (ARMING_FLAG(ARMED
) && (failsafeIsReceivingRxData() || switchFailsafe
)) {
183 if (rcDisarmTicks
> 3) {
184 disarm(DISARM_REASON_SWITCH
);
188 } else if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_CE
+ ROL_CE
) {
189 if (rcDelayMs
>= ARM_DELAY_MS
&& !doNotRepeat
) {
191 // Disarm on throttle down + yaw
193 if (ARMING_FLAG(ARMED
))
194 disarm(DISARM_REASON_STICKS
);
196 beeper(BEEPER_DISARM_REPEAT
); // sound tone while stick held
197 repeatAfter(STICK_AUTOREPEAT_MS
); // disarm tone will repeat
199 #ifdef USE_RUNAWAY_TAKEOFF
200 // Unset the ARMING_DISABLED_RUNAWAY_TAKEOFF arming disabled flag that might have been set
201 // by a runaway pidSum detection auto-disarm.
202 // This forces the pilot to explicitly perform a disarm sequence (even though we're implicitly disarmed)
203 // before they're able to rearm
204 unsetArmingDisabled(ARMING_DISABLED_RUNAWAY_TAKEOFF
);
206 unsetArmingDisabled(ARMING_DISABLED_CRASH_DETECTED
);
210 } else if (rcSticks
== THR_LO
+ YAW_HI
+ PIT_CE
+ ROL_CE
&& !IS_RC_MODE_ACTIVE(BOXSTICKCOMMANDDISABLE
)) { // disable stick arming if STICK COMMAND DISABLE SW is active
211 if (rcDelayMs
>= ARM_DELAY_MS
&& !doNotRepeat
) {
213 if (!ARMING_FLAG(ARMED
)) {
216 if (isTryingToArm() ||
217 ((getArmingDisableFlags() == ARMING_DISABLED_CALIBRATING
) && armingConfig()->gyro_cal_on_first_arm
)) {
221 resetArmingDisabled();
229 if (ARMING_FLAG(ARMED
) || doNotRepeat
|| rcDelayMs
<= STICK_DELAY_MS
|| (getArmingDisableFlags() & (ARMING_DISABLED_RUNAWAY_TAKEOFF
| ARMING_DISABLED_CRASH_DETECTED
))) {
234 #ifdef USE_USB_CDC_HID
235 // If this target is used as a joystick, we should leave here.
236 if (cdcDeviceIsMayBeActive() || IS_RC_MODE_ACTIVE(BOXSTICKCOMMANDDISABLE
)) {
241 // actions during not armed
243 if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_LO
+ ROL_CE
) {
245 gyroStartCalibration(false);
248 if (featureIsEnabled(FEATURE_GPS
)) {
249 GPS_reset_home_position();
254 if (sensors(SENSOR_BARO
)) {
255 baroSetGroundLevel();
262 if (featureIsEnabled(FEATURE_INFLIGHT_ACC_CAL
) && (rcSticks
== THR_LO
+ YAW_LO
+ PIT_HI
+ ROL_HI
)) {
263 // Inflight ACC Calibration
264 handleInflightCalibrationStickPosition();
268 // Change PID profile
270 case THR_LO
+ YAW_LO
+ PIT_CE
+ ROL_LO
:
271 // ROLL left -> PID profile 1
274 case THR_LO
+ YAW_LO
+ PIT_HI
+ ROL_CE
:
275 // PITCH up -> PID profile 2
278 case THR_LO
+ YAW_LO
+ PIT_CE
+ ROL_HI
:
279 // ROLL right -> PID profile 3
284 if (rcSticks
== THR_LO
+ YAW_LO
+ PIT_LO
+ ROL_HI
) {
285 saveConfigAndNotify();
289 if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_LO
+ ROL_CE
) {
291 accStartCalibration();
297 if (rcSticks
== THR_HI
+ YAW_HI
+ PIT_LO
+ ROL_CE
) {
299 compassStartCalibration();
306 if (FLIGHT_MODE(ANGLE_MODE
|HORIZON_MODE
)) {
307 // in ANGLE or HORIZON mode, so use sticks to apply accelerometer trims
308 rollAndPitchTrims_t accelerometerTrimsDelta
;
309 memset(&accelerometerTrimsDelta
, 0, sizeof(accelerometerTrimsDelta
));
311 if (pendingApplyRollAndPitchTrimDeltaSave
&& ((rcSticks
& THR_MASK
) != THR_HI
)) {
312 saveConfigAndNotify();
313 pendingApplyRollAndPitchTrimDeltaSave
= false;
317 bool shouldApplyRollAndPitchTrimDelta
= false;
319 case THR_HI
+ YAW_CE
+ PIT_HI
+ ROL_CE
:
320 accelerometerTrimsDelta
.values
.pitch
= 1;
321 shouldApplyRollAndPitchTrimDelta
= true;
323 case THR_HI
+ YAW_CE
+ PIT_LO
+ ROL_CE
:
324 accelerometerTrimsDelta
.values
.pitch
= -1;
325 shouldApplyRollAndPitchTrimDelta
= true;
327 case THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_HI
:
328 accelerometerTrimsDelta
.values
.roll
= 1;
329 shouldApplyRollAndPitchTrimDelta
= true;
331 case THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_LO
:
332 accelerometerTrimsDelta
.values
.roll
= -1;
333 shouldApplyRollAndPitchTrimDelta
= true;
336 if (shouldApplyRollAndPitchTrimDelta
) {
338 applyAccelerometerTrimsDelta(&accelerometerTrimsDelta
);
340 pendingApplyRollAndPitchTrimDeltaSave
= true;
342 beeperConfirmationBeeps(1);
344 repeatAfter(STICK_AUTOREPEAT_MS
);
349 // in ACRO mode, so use sticks to change RATE profile
351 case THR_HI
+ YAW_CE
+ PIT_HI
+ ROL_CE
:
352 changeControlRateProfile(0);
354 case THR_HI
+ YAW_CE
+ PIT_LO
+ ROL_CE
:
355 changeControlRateProfile(1);
357 case THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_HI
:
358 changeControlRateProfile(2);
360 case THR_HI
+ YAW_CE
+ PIT_CE
+ ROL_LO
:
361 changeControlRateProfile(3);
367 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_HI
+ ROL_LO
) {
368 dashboardDisablePageCycling();
371 if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_HI
+ ROL_HI
) {
372 dashboardEnablePageCycling();
376 #ifdef USE_VTX_CONTROL
377 if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_CE
+ ROL_HI
) {
380 if (rcSticks
== THR_HI
+ YAW_LO
+ PIT_CE
+ ROL_LO
) {
383 if (rcSticks
== THR_HI
+ YAW_HI
+ PIT_CE
+ ROL_HI
) {
384 vtxIncrementChannel();
386 if (rcSticks
== THR_HI
+ YAW_HI
+ PIT_CE
+ ROL_LO
) {
387 vtxDecrementChannel();
391 #ifdef USE_CAMERA_CONTROL
392 if (rcSticks
== THR_CE
+ YAW_HI
+ PIT_CE
+ ROL_CE
) {
393 cameraControlKeyPress(CAMERA_CONTROL_KEY_ENTER
, 0);
394 repeatAfter(3 * STICK_DELAY_MS
);
395 } else if (rcSticks
== THR_CE
+ YAW_CE
+ PIT_CE
+ ROL_LO
) {
396 cameraControlKeyPress(CAMERA_CONTROL_KEY_LEFT
, 0);
397 repeatAfter(3 * STICK_DELAY_MS
);
398 } else if (rcSticks
== THR_CE
+ YAW_CE
+ PIT_HI
+ ROL_CE
) {
399 cameraControlKeyPress(CAMERA_CONTROL_KEY_UP
, 0);
400 repeatAfter(3 * STICK_DELAY_MS
);
401 } else if (rcSticks
== THR_CE
+ YAW_CE
+ PIT_CE
+ ROL_HI
) {
402 cameraControlKeyPress(CAMERA_CONTROL_KEY_RIGHT
, 0);
403 repeatAfter(3 * STICK_DELAY_MS
);
404 } else if (rcSticks
== THR_CE
+ YAW_CE
+ PIT_LO
+ ROL_CE
) {
405 cameraControlKeyPress(CAMERA_CONTROL_KEY_DOWN
, 0);
406 repeatAfter(3 * STICK_DELAY_MS
);
407 } else if (rcSticks
== THR_LO
+ YAW_CE
+ PIT_HI
+ ROL_CE
) {
408 cameraControlKeyPress(CAMERA_CONTROL_KEY_UP
, 2000);
413 int32_t getRcStickDeflection(int32_t axis
, uint16_t midrc
) {
414 return MIN(abs((int32_t)rcData
[axis
] - midrc
), 500);
417 void rcControlsInit(void)
419 analyzeModeActivationConditions();
420 isUsingSticksToArm
= !isModeActivationConditionPresent(BOXARM
) && systemConfig()->enableStickArming
;