Updated 3.0.0 Release Notes (markdown)
[inav.wiki.git] / Navigation-modes.md
blob477388d46627fb255d54389d891d8ee07749fb15
1 **This Wiki page needs updating in regards to renamed CLI variables.**
3 This page will list and explain all the different navigational flight modes of iNav:
5 - [NAV ALTHOLD - Altitude hold](#althold---altitude-hold)
6 - [NAV POSHOLD - Horizontal position hold](#nav-poshold---Position-hold)
7 - [NAV CRUISE - Fixed Wing Heading Hold](#nav-cruise---fixed-wing-heading-hold)
8 - [NAV RTH - Return to home](#rth---return-to-home)
9 - [NAV WP - Autonomous waypoint mission](#wp---autonomous-waypoint-mission)
10 - [GCS NAV - Ground control station](#gcs_nav---ground-control-station)
13 For safety reasons, iNAV’s navigation modes can be activated only if  
14 - ACC and MAG are [calibrated](https://github.com/iNavFlight/inav/wiki/Sensor-calibration) properly,  
15 - you have a valid 3D GPS fix,   
16 - the FC is armed.  
18 This applies to enabling the navigation modes in the Configurator as well as at the flying field.   
19 (For bench tests without(!) propellers you may change “set nav_extra_arming_safety = ON” to “OFF” in CLI.)  
21 - Flightmodes are self contained. For example: with RTH and WP (Waypoints) it's not necessary to enable angle, althold or mag, it enables what it needs. Read more below in POSHOLD section.  
22 - On fixed wing aircraft, enabling CRUISE, RTH, WP or POSHOLD also enables TURN ASSIST. TURN ASSIST applies elevator and rudder input when the airplane is banked to obtain a coordinated turn. 
24 |           | POSHOLD   | WAYPOINT  | RTH       | ALTHOLD   |
25 | ----      | ----      | ----      | ----      | ----      |
26 | ANGLE     | X         | X         | X         |           |
27 | ALTHOLD   | X         | X         | X         |           |
28 | TURN ASSIST | X         | X         | X         |           |
29 | MAG       |           | X         | X         |           |
30 | BARO      |           | X         | X         | X         |
32 **Prior to version 2.6 on a fixed wing the motor will stop in all Nav modes except Nav RTH and Nav WP if the throttle is reduced below the Min_Check setting. From version 2.6 this behaviour is controlled using the nav_overrides_motor_stop setting which by default keeps the motor running in all Nav modes.**
33   
34 - There is a companion [[wiki page further describing way point missions, tools and telemetry options|iNavFlight Missions]].
36 Note: All iNAV parameters for distance, velocity, and acceleration are input in cm, cm/s and cm/s^2. 
38 Let's have a look at each mode of operation in detail.
40 ## ALTHOLD - Altitude hold
41 When activated, the aircraft maintains its actual altitude unless changed by manual throttle input.
42 Throttle input indicates climb or sink up to a predetermined maximum rate (see CLI variables). Using ALTHOLD with a multicopter, you need a barometer.  
43 SONAR: Altitude hold code will use sonar automatically on low altitudes (< 3m) if hardware is available.  
44 Using ALTHOLD with a plane (fixed wing: fw) with GPS: Since iNAV 1.5 it's recommended to keep baro enabled, and for iNav 1.6 the plan is to rely even less on GPS altitude when baro is enabled.  
45   
46 In general you shouldn't mix up ALTHOLD and ACRO/HORIZON: ALTHOLD doesn't account for extreme acro maneuvers. 
47   
48 Activate ALTHOLD by **ALTHOLD** flight mode.  
49 Altitude, as calculated by iNAV's position estimator, is recorded to BLACKBOX as navPos[2].
50   
51 ### a) Using ALTHOLD with a multicopter (mc):  
52 Activate AIRMODE to keep the copter stable in fast descent - now you can do the whole flight in altitude hold - from take-off to landing.  
53   
54 Climb rate in ALTHOLD mode:  
55 "set nav_max_climb_rate = 500" and "set nav_manual_climb_rate = 200" define the maximum climb and decent rate in autonomous/manual flight modes.   
56 The neutral position of the throttle stick to hold current altitude is defined by   
57 - “set nav_use_midthr_for_althold=ON”: use mid position of throttle stick as neutral. By default the mid position value is typically 1500us as set in the "Receiver" tab.
58 - “set nav_use_midthr_for_althold =OFF”: use current stick position (i.e. when activating ALTHOLD) as neutral. [Yet, if "nav_use_midthr_for_althold=OFF”, and you enable ALTHOLD with throttle stick too low (like on the ground) iNAV will take “thr_mid” as a safe default for neutral. “thr_mid” is defined in the “Receiver” tab and should be set to hover throttle.]   
59   
60 In the moment you engage ALTHOLD, iNAV always sends “nav_mc_hover_thr” to the motors as the starting value of the altitude control loop. You should configure this to your copter's hover setting, if your copter doesn't hover close to the default value of 1500us. Otherwise your copter will begin ALTHOLD with a jump or drop.  
61   
62 Example: Let's assume "nav_mc_hover_thr” is already set correctly to your copter's hover throttle and “set nav_use_midthr_for_althold =OFF”. Let's say you have your throttle stick at 30%, and you enter ALTHOLD, your copter will maintain hover at this 30%. If throttle is increased up to 40% it will start to climb. (Even if your copter needs 60% throttle to actually climb up in normal flight without ALTHOLD.)
64 It's important to note that when the battery is full, "nav_mc_hover_thr” could be a lower value than when the battery is weaker. With a weaker battery more throttle will be needed to maintain a hover. A practical way to establish an approximate valid value is to use the iNav OSD screen to test values real-time when in the field. Once an approximate "nav_mc_hover_thr” has been established, then adjust the PIDs as described in the "PIDs for altitude hold" section below.
65     
66 "set alt_hold_deadband = 50": You have to change throttle command (e.g. move throttle stick) by at least this amount to make the copter climb or descend and change target altitude for ALTHOLD.  
67 If ALTHOLD is activated at zero throttle iNAV will account for deadband and move the neutral "zero climb rate" position a little bit up to make sure you are able to descend.  
68   
69   
70 PIDs for altitude hold:  
71 _**The following values can be accessed using iNav OSD when configured for FPV from the "ALT MAG" screen within the "PIDS" section. Alternatively, the comparable variable, in parenthesis (), can be entered in the CLI of iNav Configurator.**_  
72 - ALT P (nav_mc_pos_z_p) - defines how fast copter will attempt to compensate for altitude error (converts alt error to desired climb rate)  
73 - ALT I (nav_auto_climb_rate) - defines how fast copter will accelerate to reach desired climb rate  
74 - VEL P (nav_mc_vel_z_p) - defines how much throttle copter will add to achieve desired acceleration  
75 - VEL I  (nav_mc_vel_z_i)- controls compensation for hover throttle (and vertical air movement, thermals). This can essentially be zero if hover throttle is precisely 1500us. Too much "VEL I" will lead to vertical oscillations, too low "VEL I" will cause drops or jumps when ALTHOLD is switched on.  
76 - VEL D (nav_mc_vel_z_d)- acts as a dampener for VEL P and VEL I, will slower the response and reduce oscillations from too high VEL P and VEL I  
77 - If ALT P (nav_mc_pos_z_p) and ALT I (nav_auto_climb_rate) have been set to zero (0) during the PID adjustments, setting ALT P (nav_mc_pos_z_p) to a non-zero value (100?), will have the effect of changing the ALTHOLD altitude using the throttle. Once again, the easiest trial and error testing is done through the iNav OSD while in the field.
79 Inability to maintain altitude can be caused by a number of reasons:  
80 1. insufficient ALT_P and/or ALT_I  
81 2. non-functional baro (please go to "Sensors" tab in Configurator and verify that baro graph changes as you move the quad up and down  
82 3. seriously underpowered quad (ALTHOLD is able to compensate only to some degree. If your quad hovers at 1700 linear throttle without any expo, ALTHOLD might fail to compensate)  
83 4. Gaining altitude during fast flight is likely due to increased air pressure and that is treated as going down in altitude - try covering your baro with (more) foam.
85 ALT+VEL PID Tuning  
86 Let's make a small experiment: Make sure baro is well isolated. You may also want to reduce baro weight: 
87 - "set  inav_w_z_baro_p = 0.5" and "set ALT P(nav_mc_pos_z_p) = 0" and try flying. This way the controller will attempt to keep zero climb rate without any reference to altitude. The quad should slowly drift either up or down. If it would be jumping up and down, your "VEL * (nav_mc_vel_z_*)" gains are too high.
88   
89 - As a second step you can try zeroing out "VEL P (nav_mc_vel_z_p)" and "VEL I (nav_mc_vel_z_i)" and "set VEL D (nav_mc_vel_z_d) = 100". Now the quad should be drifting up/down even slower. Raise "VEL D (nav_mc_vel_z_d)" to the edge of oscillations.  
91 - Now raise "VEL P (nav_mc_vel_z_p)" to the edge of oscillations. Now ALTHOLD should be almost perfect.  
93 - And finally "set nav_mc_hover_thr" slightly (50-100) higher/lower than your actual hover throttle and tune "VEL I (nav_mc_vel_z_i)" until the quad is able to compensate.  
95 Keep in mind that no tuning can fix bad baro isolation issue.    
96   
97 If quad is buzzing while ALTHOLD is activated try lowering "VEL P (nav_mc_vel_z_p)" a bit.  
99 What is the trick with "VEL I (nav_mc_vel_z_i)"?   
100 "VEL I (nav_mc_vel_z_i)" is used to compensate for "nav_mc_hover_thr" (hover throttle) being set to a slightly incorrect value. You can't set hover throttle to an exact value, there is always influence from thermals, battery charge level etc. Too much "VEL I (nav_mc_vel_z_i)" will lead to vertical oscillations, too low "VEL I (nav_mc_vel_z_i)" will cause drops or jumps when ALTHOLD is enabled, very low "VEL I (nav_mc_vel_z_i)" can result in total inability to maintain altitude.
101   
102 To deal with oscillations you can try lowering your "ALT P (nav_mc_alt_p)", "VEL P (nav_mc_vel_p)", "ALT I (nav_auto_climb_rate)", and "nav_manual_climb_rate".    
103   
104 Climb rate is calculated from the readings of the accelerometer, barometer and – if available – from GPS (“set inav_use_gps_velned = ON”). How strongly the averages of these noisy signals are taken into account in the estimation of altitude change by iNAV is controlled by  
105 - set inav_w_z_baro_p = 0.350  
106 - set inav_w_z_gps_p = 0.200    
107 for vertical position (z) and     
108 - set inav_w_z_gps_v = 0.500    
109 for vertical velocity. Too high “inav_w_z_baro_p” will make ALTHOLD nervous, and too low will make it drift so you risk running into the ground when cruising around. Using GPS readings for vertical velocity allows for a lower weight for baro to make ALTHOLD smoother without making it less accurate. 
110   
112 // TODO: explain remaining relevant settings
113   
114 ### b) Using ALTHOLD with an airplane (fixed wing, fw):  
115 With Fixed Wing models, iNAV is not intended to use ALTHOLD controller in anything but ANGLE or CRUISE modes.  
116 iNAV controls pitch angle and throttle. It assumes that altitude is held (roughly) when pitch angle is zero. If plane has to climb, iNAV will also increase throttle. If plane has to dive, iNAV will reduce throttle and glide. The strength of this mixing is controlled by “nav_fw_pitch2thr”.  
117 Set board alignment in such a way that your plane is flying level both in "MANUAL" and in "ANGLE", when you don't touch the sticks.   
119 iNAV’s parameters for fixed wing:  
120 - set nav_fw_cruise_thr = 1400  # cruise throttle  
121 - set nav_fw_min_thr = 1200  # minimum throttle  
122 - set nav_fw_max_thr = 1700  # maximum throttle  
123 - set nav_fw_bank_angle = 20  
124 - set nav_fw_climb_angle = 20  
125 - set nav_fw_dive_angle = 15  
126 - set nav_fw_pitch2thr = 10  # pitch to throttle  
127 - set nav_fw_loiter_radius = 5000  
128   
129   
130   
131 ## NAV POSHOLD - Position hold
133 For multirotor it will hold 3D position, throttle is automatic (AH).
134 You can use your roll and pitch stick to move around. The position hold will be resumed when you center the roll/pitch stick again. You can also enable HEADING HOLD at the same time to lock the heading.     
136 For fixed wing it will loiter in circles which radius is defined by the `nav_fw_loiter_radius` variable. The throttle is automatic. The altitude is controlled with the pitch stick (AH).
138 Always check POSHOLD working correctly, before you use RTH or start a WP mission.
140 Hints for safe operation:
141 - Activate without props installed to check for reasonable operation.
142 - When misconfigured, this mode can result in dramatic failure to hold position. Attitude (yaw & motion) inputs can/will result in rapid and unexpected motion.
144 ## NAV CRUISE - Fixed Wing Heading Hold
146 When enabled the machine will try to maintain the current heading and compensate for any external disturbances (2D CRUISE). User can adjust the flight direction directly with ROLL stick or with the YAW stick ( `nav_fw_cruise_yaw_rate` set the yawing rate at full stick deflection ). The latter will offer a smoother way to adjust the flight direction. If the mode is enabled in conjunction with NAV ALTHOLD also the current altitude will be maintained (3D CRUISE). Altitude can be adjusted, as usual, via the pitch stick. Both 2D/3D CRUISE modes forces ANGLE mode to be active so the plane will auto level.
148 ## RTH - Return to home
149 RTH will attempt to bring copter/plane to launch position. Launch position is defined as a point where aircraft was armed. RTH will control both position and altitude. You will have to manually control altitude if your aircraft does not have an altitude sensor (barometer). 
151 With default settings RTH will land immediately if you are closer than 5 meters from launch position. If further away it will make sure to have at least 10 meters of altitude, then start going home at 3m/s, and land. It will disarm itself if so configured, otherwise you will have to manually disarm once on the ground.
154 There are many different modes for Altitude, see [further down on this page](https://github.com/iNavFlight/inav/wiki/Navigation-modes#rth-altitude-control-modes)
156 Activated by **RTH** flight mode.
159 ## WP - Autonomous waypoint mission
160 Autonomous waypoints are used to let the quad/plane autonomous fly a predefined mission. The mission is defined with waypoints, which have the information about latitude, longitude, height and speed between the waypoints. GUIs such as EZ-GUI, Mission Planner for iNav, Mobile Flight and [mwp](https://github.com/stronnag/mwptools) can be used to set the waypoints and upload the mission as well as store missions locally for reuse (exgui, mp4iNav, mwp at least). The iNav configurator has limited capability to create waypoint missions. Uploaded missions are saved in the FC until a reboot or a new uploaded mission erases the old one. Missions may also be saved to EEPROM, which survives reboot.
161   
162 Once the waypoint mode is activated (NAV WP has to be set previously in the mode tabs to a specific switch/value), the quad/plane will start to fly the waypoint mission based upon the waypoints in numerical order. Waypoint missions can be restarted by switching NAV WP off/on; interruption during the mission is also possible with switching NAV WP off. 
164 Currently up to 30 waypoints can be set on F1 boards, and 60 on F3 and better.
166 There is an additional [[wiki page further describing way point missions, tools and telemetry options|iNavFlight Missions]].
168 // TODO: Explain better.
169 // TODO: explain what happens when you are in WP mode and GPS fails.
171 ## GCS_NAV - Ground control station
172 This mode is just an permission for GCS to change position hold coordinates and the altitude.
173 So it's not a flight mode itself, and needs to be combined with other flight modes.
175 In order to let the GCS have full control over the aircraft the following modes must be activated: `NAV POSHOLD` `NAV ALTHOLD` `MAG` TOGETHER with `GCS_NAV`.
177 This can be combined in whichever way you want to permit, e.g manual yawing or altitude control.
179 Keep in mind that if `NAV POSHOLD` is not combined with this mode you must combine `ANGLE` as the other modes are best combined with `ANGLE` mode.
182 // TODO: explain what happens when you are in GSC NAV mode and GPS fails.  
184 right (roll/pitch) stick
187 ## Mode switch diagram
189 A diagram to indicate flight modes relation to navigation modes and illustrate sensor requirements:
191 ![](images/nav_modes_diagram.jpg)
193 # RTH Altitude control modes
195 RTH sequence can control altitude in several different ways, controlled by **nav_rth_alt_mode** and **nav_rth_altitude** (the altitude in centimeters) parameters.
197 Default setting is NAV_RTH_AT_LEAST_ALT - climb to preconfigured altitude if below, stay at current altitude if above.
199 ## Maintain current altitude (NAV_RTH_NO_ALT)
200 nav_rth_alt_mode = CURRENT
202 nav_rth_altitude is ignored
204 ![](images/NAV_RTH_NO_ALT.jpg)
206 ## Maintain current altitude + predefined safety margin (NAV_RTH_EXTRA_ALT)
207 nav_rth_alt_mode = EXTRA
209 nav_rth_altitude defines extra altitude margin
211 ![](images/NAX_RTH_EXTRA_ALT.jpg)
213 ## Predefined altitude (NAV_RTH_CONST_ALT)
214 nav_rth_alt_mode = FIXED
216 nav_rth_altitude defines exact RTH altitude above launch point.
218 If the multirotor is below nav_rth_altitude it will enter position hold and climb to desired altitude prior to flying back home. If the machine is above the desired altitude, it will turn and fly home and descend on the way.
220 ![](images/NAV_RTH_CONST_ALT.jpg)
222 ## Predefined altitude linear descent (AT_LEAST_LINEAR_DESCENT)
223 nav_rth_alt_mode = AT_LEAST_LINEAR_DESCENT
225 `nav_rth_altitude` defines exact RTH altitude above launch point. Aircraft will descend in a way that it'll reach the `nav_rth_altitude` altitude only when it reaches the home point. So aircraft can save energy by doing an easy descend on it's way back home.
227 If the aircraft is below `nav_rth_altitude` it will climb to desired altitude prior to flying back home. If the machine is above the desired altitude, it will turn and fly home, and descend on the way (on a linear straight line).
229 ![](https://i.imgur.com/CPgKb4w.png)
231 ## Maximum altitude since launch (NAV_RTH_MAX_ALT)
232 nav_rth_alt_mode = MAX
234 nav_rth_altitude is ignored
236 ![](images/NAV_RTH_MAX_ALT.jpg)
238 ## At least predefined altitude above launch point (NAV_RTH_AT_LEAST_ALT)
239 nav_rth_alt_mode = AT_LEAST
241 nav_rth_altitude defines exact RTH altitude above launch point
243 ![](images/NAV_RTH_AT_LEAST_ALT.jpg)