Paparazzi UAS v7.0_unstable
Paparazzi is a free software Unmanned Aircraft System.
All Data Structures Namespaces Files Functions Variables Typedefs Enumerations Enumerator Macros Modules Pages
guidance_indi_hybrid.c
Go to the documentation of this file.
1/*
2 * Copyright (C) 2015 Ewoud Smeur <ewoud.smeur@gmail.com>
3 *
4 * This file is part of paparazzi.
5 *
6 * paparazzi is free software; you can redistribute it and/or modify
7 * it under the terms of the GNU General Public License as published by
8 * the Free Software Foundation; either version 2, or (at your option)
9 * any later version.
10 *
11 * paparazzi is distributed in the hope that it will be useful,
12 * but WITHOUT ANY WARRANTY; without even the implied warranty of
13 * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
14 * GNU General Public License for more details.
15 *
16 * You should have received a copy of the GNU General Public License
17 * along with paparazzi; see the file COPYING. If not, write to
18 * the Free Software Foundation, 59 Temple Place - Suite 330,
19 * Boston, MA 02111-1307, USA.
20 */
21
30#include "generated/airframe.h"
34#include "state.h"
35#include "mcu_periph/sys_time.h"
36#include "autopilot.h"
37#include "stdio.h"
39#include "modules/core/abi.h"
41
42
43// The acceleration reference is calculated with these gains. If you use GPS,
44// they are probably limited by the update rate of your GPS. The default
45// values are tuned for 4 Hz GPS updates. If you have high speed position updates, the
46// gains can be higher, depending on the speed of the inner loop.
47#ifndef GUIDANCE_INDI_SPEED_GAIN
48#define GUIDANCE_INDI_SPEED_GAIN 1.8
49#define GUIDANCE_INDI_SPEED_GAINZ 1.8
50#endif
51
52#ifndef GUIDANCE_INDI_POS_GAIN
53#define GUIDANCE_INDI_POS_GAIN 0.5
54#define GUIDANCE_INDI_POS_GAINZ 0.5
55#endif
56
57#ifndef GUIDANCE_INDI_LIFTD_ASQ
58#define GUIDANCE_INDI_LIFTD_ASQ 0.20
59#endif
60
61#ifndef GUIDANCE_INDI_MAX_PUSHER_INCREMENT
62#define GUIDANCE_INDI_MAX_PUSHER_INCREMENT MAX_PPRZ
63#endif
64
65/* If lift effectiveness at low airspeed not defined,
66 * just make one interpolation segment that connects to
67 * the quadratic part from 12 m/s onward
68 */
69#ifndef GUIDANCE_INDI_LIFTD_P50
70#define GUIDANCE_INDI_LIFTD_P80 (GUIDANCE_INDI_LIFTD_ASQ*12*12)
71#define GUIDANCE_INDI_LIFTD_P50 (GUIDANCE_INDI_LIFTD_P80/2)
72#endif
73
74#ifndef GUIDANCE_INDI_MAX_AIRSPEED
75#error "You must have an airspeed sensor to use this guidance"
76#endif
77
78#ifndef GUIDANCE_INDI_MIN_AIRSPEED
79#define GUIDANCE_INDI_MIN_AIRSPEED -10.f
80#endif
81
85#ifndef GUIDANCE_INDI_FWD_CLIMB_SPEED
86#define GUIDANCE_INDI_FWD_CLIMB_SPEED 4.0
87#endif
88
92#ifndef GUIDANCE_INDI_FWD_DESCEND_SPEED
93#define GUIDANCE_INDI_FWD_DESCEND_SPEED -4.0
94#endif
95
99#ifndef GUIDANCE_INDI_QUAD_CLIMB_SPEED
100#define GUIDANCE_INDI_QUAD_CLIMB_SPEED 2.0
101#endif
102
106#ifndef GUIDANCE_INDI_QUAD_DESCEND_SPEED
107#define GUIDANCE_INDI_QUAD_DESCEND_SPEED -2.0
108#endif
109
112 .pos_gainz = GUIDANCE_INDI_POS_GAINZ,
113
114 .speed_gain = GUIDANCE_INDI_SPEED_GAIN,
115 .speed_gainz = GUIDANCE_INDI_SPEED_GAINZ,
116
117 .heading_bank_gain = GUIDANCE_INDI_HEADING_BANK_GAIN,
118 .liftd_asq = GUIDANCE_INDI_LIFTD_ASQ, // coefficient of airspeed squared
119 .liftd_p80 = GUIDANCE_INDI_LIFTD_P80,
120 .liftd_p50 = GUIDANCE_INDI_LIFTD_P50,
121 .min_airspeed = GUIDANCE_INDI_MIN_AIRSPEED,
122 .max_airspeed = GUIDANCE_INDI_MAX_AIRSPEED,
123 .stall_protect_gain = 1.5, // m/s^2 downward acceleration per m/s airspeed loss
124 .climb_vspeed_fwd = GUIDANCE_INDI_FWD_CLIMB_SPEED,
125 .descend_vspeed_fwd = GUIDANCE_INDI_FWD_DESCEND_SPEED,
126 .climb_vspeed_quad = GUIDANCE_INDI_QUAD_CLIMB_SPEED,
127 .descend_vspeed_quad = GUIDANCE_INDI_QUAD_DESCEND_SPEED,
128};
129
130// Quadplanes can hover at various pref pitch
132
133
134// If using WLS, check that the matrix size is sufficient
135#if GUIDANCE_INDI_HYBRID_USE_WLS
136#if GUIDANCE_INDI_HYBRID_U > WLS_N_U_MAX
137#error Matrix-WLS_N_U_MAX too small: increase WLS_N_U_MAX in airframe file
138#endif
139
140#if GUIDANCE_INDI_HYBRID_V > WLS_N_V_MAX
141#error Matrix-WLS_N_V_MAX too small: increase WLS_N_V_MAX in airframe file
142#endif
143#endif
144
145
146// Tell the guidance that the airspeed needs to be zeroed.
147// Recomended to also put GUIDANCE_INDI_NAV_SPEED_MARGIN low in this case.
148#ifndef GUIDANCE_INDI_ZERO_AIRSPEED
149#define GUIDANCE_INDI_ZERO_AIRSPEED FALSE
150#endif
151
152/*Airspeed threshold where making a turn is "worth it"*/
153#ifndef TURN_AIRSPEED_TH
154#define TURN_AIRSPEED_TH 13.0
155#endif
156
157/*Boolean to force the heading to a static value (only use for specific experiments)*/
159
160bool force_forward = false;
161
163
164
165struct FloatVect3 sp_accel = {0.0,0.0,0.0};
166#ifdef GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
168static void guidance_indi_filter_thrust(void);
169
170#ifdef GUIDANCE_INDI_THRUST_DYNAMICS
171#warning GUIDANCE_INDI_THRUST_DYNAMICS is deprecated, use GUIDANCE_INDI_THRUST_DYNAMICS_FREQ instead.
172#warning "The thrust dynamics are now specified in continuous time with the corner frequency of the first order model!"
173#warning "define GUIDANCE_INDI_THRUST_DYNAMICS_FREQ in rad/s"
174#warning "Use -ln(1 - old_number) * PERIODIC_FREQUENCY to compute it from the old value."
175#endif
176
177#ifndef GUIDANCE_INDI_THRUST_DYNAMICS_FREQ
178#ifndef STABILIZATION_INDI_ACT_FREQ_P
179#error "You need to define GUIDANCE_INDI_THRUST_DYNAMICS_FREQ to be able to use indi vertical control"
180#else // assume that the same actuators are used for thrust as for roll (e.g. quadrotor)
181#define GUIDANCE_INDI_THRUST_DYNAMICS_FREQ STABILIZATION_INDI_ACT_FREQ_P
182#endif
183#endif //GUIDANCE_INDI_THRUST_DYNAMICS_FREQ
184
185#endif //GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
186
187#ifndef GUIDANCE_INDI_FILTER_CUTOFF
188#ifdef STABILIZATION_INDI_FILT_CUTOFF
189#define GUIDANCE_INDI_FILTER_CUTOFF STABILIZATION_INDI_FILT_CUTOFF
190#else
191#define GUIDANCE_INDI_FILTER_CUTOFF 3.0
192#endif
193#endif
194
195#ifndef GUIDANCE_INDI_AIRSPEED_FILT_CUTOFF
196#define GUIDANCE_INDI_AIRSPEED_FILT_CUTOFF 0.5
197#endif
198
199#ifndef GUIDANCE_INDI_MAX_LAT_ACCEL
200#define GUIDANCE_INDI_MAX_LAT_ACCEL 9.81
201#endif
202
203#ifndef GUIDANCE_INDI_COORDINATED_TURN_MIN_AIRSPEED
204#define GUIDANCE_INDI_COORDINATED_TURN_MIN_AIRSPEED 10.0
205#endif
206
207#ifndef GUIDANCE_INDI_COORDINATED_TURN_MAX_AIRSPEED
208#define GUIDANCE_INDI_COORDINATED_TURN_MAX_AIRSPEED 30.0
209#endif
210
211#ifndef GUIDANCE_INDI_COORDINATED_TURN_AIRSPEED_MARGIN
212#define GUIDANCE_INDI_COORDINATED_TURN_AIRSPEED_MARGIN 0.0
213#endif
214
215float inv_eff[4];
216
217// Max bank angle in radians
220
221#if defined(ROTWING_STATE_FW_MAX_AIRSPEED) && defined(ROTWING_STATE_QUAD_MAX_AIRSPEED)
224#else
227#endif
228
230
233
234float thrust_dyn = 0.f;
235float thrust_act = 0.f;
242
245
248
249float du_gih[GUIDANCE_INDI_HYBRID_U]; // = {0.0f, 0.0f, 0.0f};
250
251#if GUIDANCE_INDI_HYBRID_USE_WLS
252#include "math/wls/wls_alloc.h"
254struct WLS_t wls_guid_p = {
257 .gamma_sq = 100000.0,
258 .v = {0.0},
259#ifdef GUIDANCE_INDI_WLS_PRIORITIES
261#else // X,Y accel, Z accel
262 .Wv = { 100.f, 100.f, 1.f },
263#endif
264#ifdef GUIDANCE_INDI_WLS_WU
266#else
267 .Wu = {[0 ... GUIDANCE_INDI_HYBRID_U - 1] = 1.0},
268#endif
269 .u_pref = {0.0},
270 .u_min = {0.0},
271 .u_max = {0.0},
272 .PC = 0.0,
273 .SC = 0.0,
274 .iter = 0
275};
276#endif
277// The control objective
278float v_gih[3];
279
280// Filters
283
288
289struct FloatVect3 gi_speed_sp = {0.0, 0.0, 0.0};
290
291#ifndef GUIDANCE_INDI_VEL_SP_ID
292#define GUIDANCE_INDI_VEL_SP_ID ABI_BROADCAST
293#endif
295static void vel_sp_cb(uint8_t sender_id, struct FloatVect3 *vel_sp);
296struct FloatVect3 indi_vel_sp = {0.0, 0.0, 0.0};
297float time_of_vel_sp = 0.0;
298
300
301#if PERIODIC_TELEMETRY
310static void send_guidance_indi_hybrid(struct transport_tx *trans, struct link_device *dev)
311{
313 &sp_accel.x,
314 &sp_accel.y,
315 &sp_accel.z,
316 &euler_cmd.x,
317 &euler_cmd.y,
318 &euler_cmd.z,
319 &filt_accel_ned[0].o[0],
320 &filt_accel_ned[1].o[0],
321 &filt_accel_ned[2].o[0],
322 &gi_speed_sp.x,
323 &gi_speed_sp.y,
324 &gi_speed_sp.z);
325}
326
327#if GUIDANCE_INDI_HYBRID_USE_WLS
328static void send_wls_v_guid(struct transport_tx *trans, struct link_device *dev)
329{
330 send_wls_v("guid", &wls_guid_p, trans, dev);
331}
332static void send_wls_u_guid(struct transport_tx *trans, struct link_device *dev)
333{
334 send_wls_u("guid", &wls_guid_p, trans, dev);
335}
336#endif // GUIDANCE_INDI_HYBRID_USE_WLS
337
338#endif // PERIODIC_TELEMETRY
339
344{
345 /*AbiBindMsgACCEL_SP(GUIDANCE_INDI_ACCEL_SP_ID, &accel_sp_ev, accel_sp_cb);*/
347
348#ifdef GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
349#ifdef GUIDANCE_INDI_THRUST_DYNAMICS
351#else
353#endif
354#endif
355
356 float tau = 1.0/(2.0*M_PI*filter_cutoff);
358 for(int8_t i=0; i<3; i++) {
360 }
365
368
369#if GUIDANCE_INDI_HYBRID_USE_WLS
370 for (int8_t i = 0; i < GUIDANCE_INDI_HYBRID_V; i++) {
371 Bwls_gih[i] = Ga[i];
372 }
373#endif
374
375#if PERIODIC_TELEMETRY
378#if GUIDANCE_INDI_HYBRID_USE_WLS
381#endif
382#endif
383}
384
413
414void guidance_set_min_max_airspeed(float min_airspeed, float max_airspeed) {
415 gih_params.min_airspeed = min_airspeed;
417}
418
422
427
432
441{
442 // set global accel sp variable FIXME clean this
444
445 /* Obtain eulers with zxy rotation order */
447
448 /* Calculate the transition ratio so that the ctrl_effecitveness scheduling works */
451
452 // filter accel to get rid of noise and filter attitude to synchronize with accel
454
455#if GUIDANCE_INDI_RC_DEBUG
456#warning "GUIDANCE_INDI_RC_DEBUG lets you control the accelerations via RC, but disables autonomous flight!"
457 // for rc control horizontal, rotate from body axes to NED
458 float psi = eulers_zxy.psi;
459 float rc_x = -(radio_control.values[RADIO_PITCH]/9600.0)*8.0;
460 float rc_y = (radio_control.values[RADIO_ROLL]/9600.0)*8.0;
461 sp_accel.x = cosf(psi) * rc_x - sinf(psi) * rc_y;
462 sp_accel.y = sinf(psi) * rc_x + cosf(psi) * rc_y;
463
464 // for rc vertical control
465 sp_accel.z = -(radio_control.values[RADIO_THROTTLE]-4500)*8.0/9600.0;
466#endif
467
468 struct FloatVect3 accel_filt;
469 accel_filt.x = filt_accel_ned[0].o[0];
470 accel_filt.y = filt_accel_ned[1].o[0];
471 accel_filt.z = filt_accel_ned[2].o[0];
472
473 struct FloatVect3 a_diff;
474 VECT3_DIFF(a_diff, sp_accel, accel_filt);
475
476 // Bound the acceleration error so that the linearization still holds
477 Bound(a_diff.x, -6.0, 6.0);
478 Bound(a_diff.y, -6.0, 6.0);
479 Bound(a_diff.z, -9.0, 9.0);
480
481 // If the thrust to specific force ratio has been defined, include vertical control
482 // else ignore the vertical acceleration error
483#ifndef GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
484#ifndef STABILIZATION_ATTITUDE_INDI_FULL
485 a_diff.z = 0.0;
486#endif
487#endif
488
489 // Calculate matrix of partial derivatives and control objective
491
492#if GUIDANCE_INDI_HYBRID_USE_WLS
493
494 // Calculate the maximum deflections
496
497 float du_gih[GUIDANCE_INDI_HYBRID_U]; // = {0.0f, 0.0f, 0.0f};
498
499 for (int i = 0; i < GUIDANCE_INDI_HYBRID_V; i++) {
500 wls_guid_p.v[i] = v_gih[i];
501 }
502 wls_alloc(&wls_guid_p, Bwls_gih, 0, 0, 10);
503 for (int i = 0; i < GUIDANCE_INDI_HYBRID_U; i++) {
504 du_gih[i] = wls_guid_p.u[i];
505 }
506 euler_cmd.x = du_gih[0];
507 euler_cmd.y = du_gih[1];
508 euler_cmd.z = du_gih[2];
509
510#else
511 // compute inverse matrix of Ga
512 float Ga_inv[3][3] = {};
514 // Calculate roll,pitch and thrust command
516#endif
517
518 // Coordinated turn
519 // feedforward estimate angular rotation omega = g*tan(phi)/v
520 float omega;
521 const float max_phi = RadOfDeg(60.0f);
522#if GUIDANCE_INDI_ZERO_AIRSPEED
523 float airspeed_turn = 0.f;
524#else
526#endif
527 // We are dividing by the airspeed, so a lower bound is important
529
532
533 //Bound euler angles to prevent flipping
536
537 // Use the current roll angle to determine the corresponding heading rate of change.
539
540 // When tilting backwards (e.g. waypoint behind the drone), we have to yaw around to face the direction
541 // of flight even when the drone is not rolling much (yet). Determine the shortest direction in which to yaw by
542 // looking at the roll angle.
543 if( (eulers_zxy.theta > 0.0f) && ( fabs(eulers_zxy.phi) < eulers_zxy.theta)) {
544 if (eulers_zxy.phi > 0.0f) {
546 } else {
548 }
549 }
550
552 omega = 9.81f / airspeed_turn * tanf(coordinated_turn_roll);
553 } else { //max 60 degrees roll
554 omega = 9.81f / airspeed_turn * 1.72305f * ((coordinated_turn_roll > 0.0f) - (coordinated_turn_roll < 0.0f));
555 }
556
557#ifdef FWD_SIDESLIP_GAIN
558 // Add sideslip correction
559 omega -= accely_filt.o[0]*FWD_SIDESLIP_GAIN;
560#endif
561
562 // We can pre-compute the required rates to achieve this turn rate:
563 // NOTE: there *should* not be any problems possible with Euler singularities here
565
566 struct FloatRates ff_rates;
567
568 ff_rates.p = -sinf(euler_zyx->theta) * omega;
569 ff_rates.q = cosf(euler_zyx->theta) * sinf(euler_zyx->phi) * omega;
570 ff_rates.r = cosf(euler_zyx->theta) * cosf(euler_zyx->phi) * omega;
571
572 // For a hybrid it is important to reduce the sideslip, which is done by changing the heading.
573 // For experiments, it is possible to fix the heading to a different value.
575 // heading is fixed by nav
577 }
578 else {
579 // heading is free and controlled by guidance
582 // limit heading setpoint to be within bounds of current heading
583#ifdef STABILIZATION_ATTITUDE_SP_PSI_DELTA_LIMIT
588 if (delta_psi > delta_limit) {
590 } else if (delta_psi < -delta_limit) {
592 }
594#endif
596 }
597
598 // compute required thrust setpoint
599#ifdef GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
601 // Add the increment in specific force * specific_force_to_thrust_gain to the filtered thrust
604#if GUIDANCE_INDI_RC_DEBUG
606 thrust_in = 0;
607 }
608#endif
609 // return required thrust
611
612#else
613 float thrust_vect[3];
614#if GUIDANCE_INDI_HYBRID_U > 3
615 thrust_vect[0] = du_gih[3];
618 }
619#else
620 thrust_vect[0] = 0;
621#endif
622 thrust_vect[1] = 0;
624 // specific force not defined, return required increment
626#endif
627
628 // Set the quaternion setpoint from eulers_zxy
629 struct FloatQuat sp_quat;
632
634}
635
636// compute accel setpoint from speed setpoint (use global variables ! FIXME)
638{
639 struct FloatVect3 accel_sp = { 0.f, 0.f, 0.f };
640
642
643 //for rc control horizontal, rotate from body axes to NED
644 float psi = eulers_zxy.psi;
645 float cpsi = cosf(psi);
646 float spsi = sinf(psi);
647 float speed_sp_b_x = cpsi * gi_speed_sp.x + spsi * gi_speed_sp.y;
648 float speed_sp_b_y = -spsi * gi_speed_sp.x + cpsi * gi_speed_sp.y;
649
650 // Get airspeed or zero it
651#if GUIDANCE_INDI_ZERO_AIRSPEED
652 float airspeed = 0.f;
653#else
654 float airspeed = stateGetAirspeed_f();
655 Bound(airspeed, 0.0f, 100.0f);
657 airspeed = guidance_indi_airspeed_filt.o[0];
658 }
659#endif
661 struct FloatVect2 airspeed_v = { cpsi * airspeed, spsi * airspeed };
662 struct FloatVect2 windspeed;
664
665 VECT2_DIFF(desired_airspeed, gi_speed_sp, windspeed); // Use 2d part of gi_speed_sp
667
669
670 // Check if some minimum airspeed is desired (e.g. to prevent stall)
673 }
674
676
677 // Make turn instead of straight line, control airspeed
678 if ((airspeed > TURN_AIRSPEED_TH) && (norm_des_as > (TURN_AIRSPEED_TH+2.0f))) {
679
680 // Give the wind cancellation priority.
682 float groundspeed_factor = 0.0f;
683
684 // if the wind is faster than we can fly, just fly in the wind direction
687 float bv = -2.f * (windspeed.x * gi_speed_sp.x + windspeed.y * gi_speed_sp.y);
689
690 float dv = bv * bv - 4.0f * av * cv;
691
692 // dv can only be positive, but just in case
693 if (dv < 0.0f) {
694 dv = fabsf(dv);
695 }
696 float d_sqrt = sqrtf(dv);
697
698 groundspeed_factor = (-bv + d_sqrt) / (2.0f * av);
699 }
700
703
705 }
706
707 if (force_forward) {
709 }
710
711 // Calculate accel sp in body axes, because we need to regulate airspeed
712 struct FloatVect2 sp_accel_b;
713 // In turn acceleration proportional to heading diff
717
719
720 // Control the airspeed
722
723 accel_sp.x = cpsi * sp_accel_b.x - spsi * sp_accel_b.y;
724 accel_sp.y = spsi * sp_accel_b.x + cpsi * sp_accel_b.y;
726 }
727 else { // Go somewhere in the shortest way
728
729 if (airspeed > 10.f) {
730 // Groundspeed vector in body frame
731 float groundspeed_x = cpsi * stateGetSpeedNed_f()->x + spsi * stateGetSpeedNed_f()->y;
733
734 // limit groundspeed setpoint to max_airspeed + (diff gs and airspeed)
735 if ((speed_increment + airspeed) > gih_params.max_airspeed) {
737 }
738 }
739
740 gi_speed_sp.x = cpsi * speed_sp_b_x - spsi * speed_sp_b_y;
741 gi_speed_sp.y = spsi * speed_sp_b_x + cpsi * speed_sp_b_y;
742
746 }
747
748 // Bound the acceleration setpoint
749 float accelbound = 3.0f + airspeed / gih_params.max_airspeed * 5.0f; // FIXME remove hard coded values
751 BoundAbs(accel_sp.z, 3.0);
752
753#ifdef ROTWING_FW_MIN_AIRSPEED
756 BoundAbs(accel_sp.z, 5.0);
757 }
758#endif
759
760 return accel_sp;
761}
762
763static float bound_vz_sp(float vz_sp)
764{
765 // Bound vertical speed setpoint
768 } else {
770 }
771 return vz_sp;
772}
773
775{
776 struct FloatVect3 pos_err = { 0 };
777 struct FloatVect3 accel_sp = { 0 };
778
779 // First check for velocity setpoint from module // FIXME should be called like this
780 float dt = get_sys_time_float() - time_of_vel_sp;
781 // If the input command is not updated after a timeout, switch back to flight plan control
782 if (dt < 0.5) {
786 accel_sp = compute_accel_from_speed_sp(); // compute accel sp
787 return guidance_indi_run(&accel_sp, gh->sp.heading);
788 }
789
791 //Linear controller to find the acceleration setpoint from position and velocity
799 } else if (v_mode == GUIDANCE_INDI_HYBRID_V_SPEED) {
801 } else {
802 gi_speed_sp.z = 0.f;
803 }
804 accel_sp = compute_accel_from_speed_sp(); // compute accel sp
806 accel_sp.z = (gi_speed_sp.z - stateGetSpeedNed_f()->z) * gih_params.speed_gainz + ACCEL_FLOAT_OF_BFP(gv->zdd_ref); // overwrite accel
807 }
808 return guidance_indi_run(&accel_sp, gh->sp.heading);
809 }
811 gi_speed_sp.x = SPEED_FLOAT_OF_BFP(gh->ref.speed.x);
812 gi_speed_sp.y = SPEED_FLOAT_OF_BFP(gh->ref.speed.y);
816 } else if (v_mode == GUIDANCE_INDI_HYBRID_V_SPEED) {
818 } else {
819 gi_speed_sp.z = 0.f;
820 }
821 accel_sp = compute_accel_from_speed_sp(); // compute accel sp
823 accel_sp.z = (gi_speed_sp.z - stateGetSpeedNed_f()->z) * gih_params.speed_gainz + ACCEL_FLOAT_OF_BFP(gv->zdd_ref); // overwrite accel
824 }
825 return guidance_indi_run(&accel_sp, gh->sp.heading);
826 }
827 else { // H_ACCEL
828 gi_speed_sp.x = 0.f;
829 gi_speed_sp.y = 0.f;
833 } else if (v_mode == GUIDANCE_INDI_HYBRID_V_SPEED) {
835 } else {
836 gi_speed_sp.z = 0.f;
837 }
838 accel_sp = compute_accel_from_speed_sp(); // compute accel sp in case z control is required
839 // overwrite accel X and Y
843 accel_sp.z = (gi_speed_sp.z - stateGetSpeedNed_f()->z) * gih_params.speed_gainz + ACCEL_FLOAT_OF_BFP(gv->zdd_ref); // overwrite accel
844 }
845 return guidance_indi_run(&accel_sp, gh->sp.heading);
846 }
847}
848
849#ifdef GUIDANCE_INDI_SPECIFIC_FORCE_GAIN
854{
855 // Actuator dynamics
857
858 // same filter as for the acceleration
860}
861
862#endif
863
888
889
897float WEAK guidance_indi_get_liftd(float airspeed, float theta) {
898 float liftd = 0.0f;
899
900 if (airspeed < 12.f) {
901 /* Assume the airspeed is too low to be measured accurately
902 * Use scheduling based on pitch angle instead.
903 * You can define two interpolation segments
904 */
905 float pitch_interp = DegOfRad(theta);
906 const float min_pitch = -80.0f;
907 const float middle_pitch = -50.0f;
908 const float max_pitch = -20.0f;
909
912 float ratio = (pitch_interp - max_pitch)/(middle_pitch - max_pitch);
913 liftd = -gih_params.liftd_p50*ratio;
914 } else {
915 float ratio = (pitch_interp - middle_pitch)/(min_pitch - middle_pitch);
917 }
918 } else {
919 liftd = -gih_params.liftd_asq*airspeed*airspeed;
920 }
921
922 //TODO: bound liftd
923 return liftd;
924}
925
930{
931 indi_vel_sp.x = vel_sp->x;
932 indi_vel_sp.y = vel_sp->y;
933 indi_vel_sp.z = vel_sp->z;
935}
936
937
938#if GUIDANCE_INDI_HYBRID_USE_AS_DEFAULT
939// guidance indi control function is implementing the default functions of guidance
940
941void guidance_h_run_enter(void)
942{
944}
945
946void guidance_v_run_enter(void)
947{
948 // nothing to do
949}
950
951static struct VerticalGuidance *_gv = &guidance_v;
953
955{
957}
958
960{
962}
963
965{
967}
968
970{
971 _gv = gv;
973 return thrust_sp;
974}
975
977{
978 _gv = gv;
980 return thrust_sp;
981}
982
984{
985 _gv = gv;
987 return thrust_sp;
988}
989
990#endif
991
Main include for ABI (AirBorneInterface).
Event structure to store callbacks in a linked list.
Definition abi_common.h:67
Core autopilot interface common to all firmwares.
#define UNUSED(x)
float phi
in radians
float p
in rad/s
float theta
in radians
float psi
in radians
static void float_quat_normalize(struct FloatQuat *q)
#define FLOAT_ANGLE_NORMALIZE(_a)
void float_mat3_mult(struct FloatVect3 *vect_out, float mat[3][3], struct FloatVect3 vect_in)
Multiply 3D matrix with vector.
void float_vect3_bound_in_2d(struct FloatVect3 *vect3, float bound)
void float_quat_of_eulers_zxy(struct FloatQuat *q, struct FloatEulers *e)
quat from euler rotation 'ZXY' This rotation order is useful if you need 90 deg pitch
void float_eulers_of_quat_zxy(struct FloatEulers *e, struct FloatQuat *q)
euler rotation 'ZXY' This rotation order is useful if you need 90 deg pitch
bool float_mat_inv_3d(float inv_out[3][3], float mat_in[3][3])
3x3 matrix inverse
#define FLOAT_VECT2_NORM(_v)
euler angles
Roation quaternion.
angular rates
#define VECT2_DIFF(_c, _a, _b)
#define VECT3_DIFF(_c, _a, _b)
#define POS_FLOAT_OF_BFP(_ai)
#define SPEED_FLOAT_OF_BFP(_ai)
#define ACCEL_FLOAT_OF_BFP(_ai)
static struct NedCoor_f * stateGetAccelNed_f(void)
Get acceleration in NED coordinates (float).
Definition state.h:1195
static struct FloatEulers * stateGetNedToBodyEulers_f(void)
Get vehicle body attitude euler angles (float).
Definition state.h:1306
static struct FloatQuat * stateGetNedToBodyQuat_f(void)
Get vehicle body attitude quaternion (float).
Definition state.h:1294
static struct NedCoor_f * stateGetPositionNed_f(void)
Get position in local NED coordinates (float).
Definition state.h:839
static struct NedCoor_f * stateGetSpeedNed_f(void)
Get ground speed in local NED coordinates (float).
Definition state.h:1049
static struct Int32Vect3 * stateGetAccelBody_i(void)
Get acceleration in Body coordinates (int).
Definition state.h:1094
static float stateGetAirspeed_f(void)
Get airspeed (float).
Definition state.h:1590
int32_t max_airspeed
struct FloatMat33 Ga_inv
float guidance_indi_specific_force_gain
struct FloatVect3 indi_vel_sp
bool force_forward
forward flight for hybrid nav
#define GUIDANCE_INDI_COORDINATED_TURN_AIRSPEED_MARGIN
Butterworth2LowPass accely_filt
static void vel_sp_cb(uint8_t sender_id, struct FloatVect3 *vel_sp)
ABI callback that obtains the velocity setpoint from a module.
float time_of_vel_sp
Butterworth2LowPass roll_filt
#define GUIDANCE_INDI_QUAD_DESCEND_SPEED
Descend speed when navigation is doing direct lines.
#define GUIDANCE_INDI_SPEED_GAINZ
#define GUIDANCE_INDI_COORDINATED_TURN_MIN_AIRSPEED
struct guidance_indi_hybrid_params gih_params
float thrust_in
#define GUIDANCE_INDI_MAX_LAT_ACCEL
struct FloatVect3 gi_speed_sp
float guidance_indi_min_pitch
float guidance_indi_max_bank
#define GUIDANCE_INDI_MIN_AIRSPEED
float gih_coordinated_turn_min_airspeed
struct StabilizationSetpoint guidance_indi_run_mode(bool in_flight UNUSED, struct HorizontalGuidance *gh, struct VerticalGuidance *gv, enum GuidanceIndiHybrid_HMode h_mode, enum GuidanceIndiHybrid_VMode v_mode)
void guidance_set_max_bank_angle(float max_bank)
float inv_eff[4]
#define GUIDANCE_INDI_FWD_DESCEND_SPEED
Descend speed when navigation is making turns instead of direct lines.
void guidance_set_max_climb_speed(float max_climb_speed_quad, float max_climb_speed_fwd)
float gih_coordinated_turn_max_airspeed
struct FloatVect3 sp_accel
struct FloatEulers guidance_euler_cmd
float guidance_indi_pitch_pref_deg
#define GUIDANCE_INDI_LIFTD_ASQ
#define GUIDANCE_INDI_QUAD_CLIMB_SPEED
Climb speed when navigation is doing direct lines.
float guidance_indi_airspeed_filt_cutoff
float thrust_act
void guidance_indi_enter(void)
Call upon entering indi guidance.
Butterworth2LowPass guidance_indi_airspeed_filt
Butterworth2LowPass pitch_filt
#define GUIDANCE_INDI_POS_GAIN
#define GUIDANCE_INDI_COORDINATED_TURN_MAX_AIRSPEED
#define GUIDANCE_INDI_FWD_CLIMB_SPEED
Climb speed when navigation is making turns instead of direct lines.
bool take_heading_control
void guidance_set_min_max_airspeed(float min_airspeed, float max_airspeed)
float guidance_indi_hybrid_heading_sp
float WEAK guidance_indi_get_liftd(float airspeed, float theta)
Get the derivative of lift w.r.t.
struct ThrustSetpoint thrust_sp
#define GUIDANCE_INDI_LIFTD_P50
static void send_guidance_indi_hybrid(struct transport_tx *trans, struct link_device *dev)
void guidance_indi_init(void)
Init function.
float filter_cutoff
#define GUIDANCE_INDI_FILTER_CUTOFF
void guidance_set_max_descend_speed(float max_descend_speed_quad, float max_descend_speed_fwd)
#define GUIDANCE_INDI_MAX_PUSHER_INCREMENT
float Ga[GUIDANCE_INDI_HYBRID_V][GUIDANCE_INDI_HYBRID_U]
struct FloatVect3 euler_cmd
static float bound_vz_sp(float vz_sp)
struct FloatEulers eulers_zxy
state eulers in zxy order
Butterworth2LowPass filt_accel_ned[3]
float gi_unbounded_airspeed_sp
#define GUIDANCE_INDI_AIRSPEED_FILT_CUTOFF
#define GUIDANCE_INDI_POS_GAINZ
#define TURN_AIRSPEED_TH
float thrust_dyn
static void send_eff_mat_guid_indi_hybrid(struct transport_tx *trans, struct link_device *dev)
static struct FloatVect3 compute_accel_from_speed_sp(void)
#define GUIDANCE_INDI_VEL_SP_ID
struct StabilizationSetpoint guidance_indi_run(struct FloatVect3 *accel_sp, float heading_sp)
bool coordinated_turn_use_accel
float v_gih[3]
void guidance_indi_propagate_filters(void)
Low pass the accelerometer measurements to remove noise from vibrations.
bool guidance_indi_airspeed_filtering
#define GUIDANCE_INDI_LIFTD_P80
abi_event vel_sp_ev
Butterworth2LowPass thrust_filt
#define GUIDANCE_INDI_SPEED_GAIN
float du_gih[GUIDANCE_INDI_HYBRID_U]
struct FloatVect2 desired_airspeed
A guidance mode based on Incremental Nonlinear Dynamic Inversion Come to ICRA2016 to learn more!
void guidance_indi_calcg_wing(float Gmat[GUIDANCE_INDI_HYBRID_V][GUIDANCE_INDI_HYBRID_U], struct FloatVect3 a_diff, float v_body[GUIDANCE_INDI_HYBRID_V])
Perform WLS.
GuidanceIndiHybrid_VMode
@ GUIDANCE_INDI_HYBRID_V_POS
@ GUIDANCE_INDI_HYBRID_V_SPEED
@ GUIDANCE_INDI_HYBRID_V_ACCEL
GuidanceIndiHybrid_HMode
@ GUIDANCE_INDI_HYBRID_H_SPEED
@ GUIDANCE_INDI_HYBRID_H_ACCEL
@ GUIDANCE_INDI_HYBRID_H_POS
void WEAK guidance_indi_hybrid_set_wls_settings(float body_v[3], float roll_angle, float pitch_angle)
#define GUIDANCE_INDI_MAX_PITCH
#define GUIDANCE_INDI_MIN_PITCH
static enum GuidanceOneloop_VMode _v_mode
void guidance_v_run_enter(void)
static struct VerticalGuidance * _gv
struct ThrustSetpoint guidance_v_run_pos(bool in_flight UNUSED, struct VerticalGuidance *gv)
struct ThrustSetpoint guidance_v_run_speed(bool in_flight UNUSED, struct VerticalGuidance *gv)
struct ThrustSetpoint guidance_v_run_accel(bool in_flight UNUSED, struct VerticalGuidance *gv)
Simple first order low pass filter with bilinear transform.
float o[2]
output history
static void init_butterworth_2_low_pass(Butterworth2LowPass *filter, float tau, float sample_time, float value)
Init a second order Butterworth filter.
static float update_butterworth_2_low_pass(Butterworth2LowPass *filter, float value)
Update second order Butterworth low pass filter state with a new value.
Second order low pass filter structure.
uint16_t foo
Definition main_demo5.c:58
float z
in meters
float x
in meters
float y
in meters
vector in North East Down coordinates Units: meters
struct RadioControl radio_control
Generic interface for radio control modules.
pprz_t values[RADIO_CONTROL_NB_CHANNEL]
Some helper functions to check RC sticks.
void guidance_h_run_enter(void)
struct StabilizationSetpoint guidance_h_run_pos(bool in_flight, struct HorizontalGuidance *gh)
struct StabilizationSetpoint guidance_h_run_speed(bool in_flight, struct HorizontalGuidance *gh)
struct StabilizationSetpoint guidance_h_run_accel(bool in_flight, struct HorizontalGuidance *gh)
#define GUIDANCE_H_MAX_BANK
Max bank controlled by guidance.
Definition guidance_h.h:64
struct VerticalGuidance guidance_v
Definition guidance_v.c:60
struct RotorcraftNavigation nav
Definition navigation.c:51
Rotorcraft navigation functions.
float heading
heading setpoint (in radians)
Definition navigation.h:133
bool rotwing_state_pusher_motor_running(void)
bool rotwing_state_hover_motors_running(void)
struct Stabilization stabilization
struct ThrustSetpoint th_sp_from_incr_vect_f(float th_increment[3])
struct StabilizationSetpoint stab_sp_from_quat_ff_rates_f(struct FloatQuat *quat, struct FloatRates *rates)
struct ThrustSetpoint th_sp_from_thrust_i(int32_t thrust, uint8_t axis)
#define THRUST_AXIS_Z
float transition_ratio
transition percentage for hybrids (0.: hover; 1.: forward)
int32_t cmd[COMMANDS_NB]
output command vector, range from [-MAX_PPRZ:MAX_PPRZ] (store for messages)
float stabilization_attitude_get_heading_f(void)
Get attitude heading as float (avoiding jumps)
float g1g2[INDI_OUTPUTS][INDI_NUM_ACT]
API to get/set the generic vehicle states.
static const struct usb_device_descriptor dev
Definition usb_ser_hw.c:74
Stabilization setpoint.
Thrust setpoint // TODO to a setpoint header Structure to store the desired thrust vector with differ...
Architecture independent timing functions.
static float get_sys_time_float(void)
Get the time in seconds since startup.
Definition sys_time.h:138
int8_t register_periodic_telemetry(struct periodic_telemetry *_pt, uint8_t _id, telemetry_cb _cb)
Register a telemetry callback function.
Definition telemetry.c:51
Periodic telemetry system header (includes downlink utility and generated code).
#define DefaultPeriodic
Set default periodic telemetry.
Definition telemetry.h:66
unsigned char uint8_t
Typedef defining 8 bit unsigned char type.
signed char int8_t
Typedef defining 8 bit char type.
float heading
Definition wedgebug.c:258
void send_wls_v(char *name, struct WLS_t *WLS_p, struct transport_tx *trans, struct link_device *dev)
Definition wls_alloc.c:61
void wls_alloc(struct WLS_t *WLS_p, float **B, float *u_guess, float *W_init, int imax)
active set algorithm for control allocation
Definition wls_alloc.c:119
void send_wls_u(char *name, struct WLS_t *WLS_p, struct transport_tx *trans, struct link_device *dev)
Definition wls_alloc.c:71
int nu
Definition wls_alloc.h:67