Skip to content

Default values for different type of aircrafts

Pawel Spychalski (DzikuVx) edited this page Sep 21, 2022 · 12 revisions

This is outdated, INAV 1.6 is out and is using PRESET. Values here are old and variable names have changed by adding "mc" and "fw" to differentiate between multicopter and fixed wing.

Values written here must be based on 1.2 or later!

This is not a replacement for tuning your PIDs, this is only a starting point from you to tune from. There are various tutorials on the internet on how to tune your PIDs.

Worth reading regards to deciding to use asynchronous mode. https://quadmeup.com/inav-how-to-setup-asynchronous-gyro/

History: PLEASE WRITE HERE IF YOU CHANGE ANYTHING AND WHY.

05.01.3017 oleøst: Changed some settings in 250 class.
21.11.2016 oleoat: Removed disabling of baro because fixed in INAV 1.4
21.11.2016 oleoat: Changed recommend gyro_lpf on flying wing, should probably be changed on acrobatic airplanes aswell
17.11.2016 oleost: Added disabled baro for fixedwing until [543](https://github.com/iNavFlight/inav/pull/543) is fixed
17.11.2016 oleost: Added values for fixed wing.
03.10.2016 artekw: Added default settings for F450
01.10.2016 oleost: Removed old PIDs based on pre 1.2
10.07.2016 oleost: Added disabling mag on flying wing aswell
24.06.2016 oleost: Created first version of this wiki
24.06.2016 oleost: Changed default to "mag_hardware = 1" on regular regular airplane because airplanes flies better with gps heading instead of mag heading.
24.06.2016 oleost: removed looptime 1000, to low for f1 targets.
2016-11-21 stronnag Added Quad 250 settings for F3/ INAV 1.4
2016-11-21 stronnag Added Tri 600 settings for F3/ INAV 1.4

Change to default INAV settings

Changes you think that should be done to INAV globally:

24.06.2016 oleost: Change default to velned on because it generally looks like a better solution. (use_gps_velned = 1)

Multirotor

150 Size:

PIDs:


Navigation PIDs:


Other Values:


250 Size:

PIDs:

set p_pitch = 55
set i_pitch = 40
set d_pitch = 15
set p_roll = 55
set i_roll = 40
set d_roll = 15
set p_yaw = 90
set i_yaw = 45
set d_yaw = 20
set p_level = 20
set i_level = 15
set d_level = 75

Navigation PIDs:


Other Values:

set gyro_lpf = 256hz
set tpa_rate = 10
set tpa_breakpoint = 1650

Also reduce looptime if your FC is capable of it.
set looptime = 1000
set gyro_sync = on
set gyro_sync_denom = 8

450 Size:

Weight: ~1200g (with battery)
Props: 10x4.5
Battery: 3s 5200mAh

PIDs:

set p_pitch = 90
set i_pitch = 34
set d_pitch = 54
set p_roll = 90
set i_roll = 34
set d_roll = 54
set p_yaw = 70
set i_yaw = 20
set d_yaw = 0
set p_level = 22
set i_level = 15
set d_level = 75

Navigation PIDs:

set nav_alt_p = 50
set nav_alt_i = 0
set nav_alt_d = 0
set nav_vel_p = 100
set nav_vel_i = 50
set nav_vel_d = 10
set nav_pos_p = 65
set nav_pos_i = 120
set nav_pos_d = 10
set nav_posr_p = 180
set nav_posr_i = 15
set nav_posr_d = 100
set nav_navr_p = 10
set nav_navr_i = 5
set nav_navr_d = 8

Other Values:

set imu_dcm_ki = 0
set gyro_sync = ON
set gyro_sync_denom = 2
set gyro_lpf = 42HZ

600 Tricopter:

Home design 600mm tricopter. Same amateur pilot who only ever flies in horizon /LOS.

3S, 4200mAh (Graphene), 10x5 HQ Thin Electic props, 1000kv. c. 900grams all up.
INAV 1.4 for the rockin' async_gyro. 
Gets about 18 minutes gentle / nav modes, maybe 16 mins for aggressive manual flying.

F3 (SPEVO). Enjoys the relatively high PIDs.

PIDs:

set p_pitch = 110
set i_pitch = 20
set d_pitch = 52
set p_roll = 110
set i_roll = 20
set d_roll = 52
set p_yaw = 75
set i_yaw = 20
set d_yaw = 0
set p_level = 20
set i_level = 20
set d_level = 75

Navigation PIDs:

set nav_alt_p = 50
set nav_alt_i = 0
set nav_alt_d = 0
set nav_vel_p = 100
set nav_vel_i = 50
set nav_vel_d = 10
set nav_pos_p = 65
set nav_pos_i = 120
set nav_pos_d = 0
set nav_posr_p = 180
set nav_posr_i = 15
set nav_posr_d = 100
set nav_navr_p = 10
set nav_navr_i = 5
set nav_navr_d = 8

Other Values:

smix reverse 5 2 r # for the tail servo :)
set looptime = 1000
set gyro_sync = ON
set gyro_sync_denom = 8
set async_mode = GYRO
set gyro_lpf = 256HZ
set motor_pwm_rate = 2000
set motor_pwm_protocol = ONESHOT125
set servo_pwm_rate = 160

set gps_provider = UBLOX
set gps_sbas_mode = EGNOS
set gps_dyn_model = AIR_1G

set rc_expo = 70
set rc_yaw_expo = 20
set thr_mid = 50
set thr_expo = 0
set roll_rate = 55
set pitch_rate = 48
set yaw_rate = 20
set tpa_rate = 20
set tpa_breakpoint = 1650

600 Size:

PIDs:


Navigation PIDs:


Other Values:


Fixedwing

Regular plane

PIDs:


Navigation PIDs:

set nav_alt_p = 50
set nav_alt_i = 0
set nav_alt_d = 0
set nav_vel_p = 100
set nav_vel_i = 50
set nav_vel_d = 10
set nav_pos_p = 65
set nav_pos_i = 120
set nav_pos_d = 10
set nav_posr_p = 180
set nav_posr_i = 150
set nav_posr_d = 100
set nav_navr_p = 200
set nav_navr_i = 10
set nav_navr_d = 0

Other Values:

set mag_hardware = 1
set auto_disarm_delay = 0
set small_angle= 70

Flying wing

PIDs:

set p_pitch = 20
set i_pitch = 30
set d_pitch = 15
set p_roll = 25
set i_roll = 30
set d_roll = 15
set p_yaw = 0
set i_yaw = 0
set d_yaw = 0
set p_level = 20
set i_level = 5
set d_level = 75

Navigation PIDs:


Other Values:

set mag_hardware = none
set gyro_sync = ON
set gyro_sync_denom = 1
set gyro_lpf = 98HZ
set gyro_soft_lpf_hz = 40
set acc_soft_lpf_hz = 15
set dterm_lpf_hz = 30
set nav_fw_launch_accel = 1500
set nav_fw_launch_detect_time = 40
set nav_fw_launch_thr = 1600
set nav_fw_launch_motor_delay = 150
set naw_fw_launch_timeout = 5000
set naw_fw_launch_climb_angle = 13
set max_angle_inclination_rll = 600
set max_angle_inclination_pit = 450

set rc_expo = 40
set tpa_rate = 33
set tpa_breakpoint = 1300

set auto_disarm_delay = 0
set small_angle= 70

WIKI TOPICS

Wiki Home Page

INAV Version Release Notes

7.1.0 Release Notes
7.0.0 Release Notes
6.0.0 Release Notes
5.1 Release notes
5.0.0 Release Notes
4.1.0 Release Notes
4.0.0 Release Notes
3.0.0 Release Notes
2.6.0 Release Notes
2.5.1 Release notes
2.5.0 Release Notes
2.4.0 Release Notes
2.3.0 Release Notes
2.2.1 Release Notes
2.2.0 Release Notes
2.1.0 Release Notes
2.0.0 Release Notes
1.9.1 Release notes
1.9.0 Release notes
1.8.0 Release notes
1.7.3 Release notes
Older Release Notes

QUICK START GUIDES

Getting started with iNav
Fixed Wing Guide
Howto: CC3D flight controller, minimOSD , telemetry and GPS for fixed wing
Howto: CC3D flight controller, minimOSD, GPS and LTM telemetry for fixed wing
INAV for BetaFlight users
launch mode
Multirotor guide
YouTube video guides
DevDocs Getting Started.md
DevDocs INAV_Fixed_Wing_Setup_Guide.pdf
DevDocs Safety.md

Connecting to INAV

Bluetooth setup to configure your flight controller
DevDocs Wireless Connections (BLE, TCP and UDP).md\

Flashing and Upgrading

Boards, Targets and PWM allocations
Upgrading from an older version of INAV to the current version
DevDocs Installation.md
DevDocs USB Flashing.md

Setup Tab
Live 3D Graphic & Pre-Arming Checks

Calibration Tab
Accelerometer, Compass, & Optic Flow Calibration

Alignment Tool Tab
Adjust mount angle of FC & Compass

Ports Tab
Map Devices to UART Serial Ports

Receiver Tab
Set protocol and channel mapping

Mixer

Mixer Tab
Custom mixes for exotic setups
DevDocs Mixer.md

Outputs

DevDocs ESC and servo outputs.md
DevDocs Servo.md

Modes

Modes
Navigation modes
Navigation Mode: Return to Home
DevDocs Controls.md
DevDocs INAV_Modes.pdf
DevDocs Navigation.md

Configuration

Sensor auto detect and hardware failure detection

Failsafe

Failsafe
DevDocs Failsafe.md

PID Tuning

PID Attenuation and scaling
Fixed Wing Tuning for INAV 3.0
Tune INAV PIFF controller for fixedwing
DevDocs Autotune - fixedwing.md
DevDocs INAV PID Controller.md
DevDocs INAV_Wing_Tuning_Masterclass.pdf
DevDocs PID tuning.md
DevDocs Profiles.md

GPS

GPS and Compass setup
GPS Failsafe and Glitch Protection

OSD and VTx

DevDocs Betaflight 4.3 compatible OSD.md
OSD custom messages
OSD Hud and ESP32 radars
DevDocs OSD.md
DevDocs VTx.md

LED Strip

DevDocs LedStrip.md

ADVANCED

Advanced Tuning

Fixed Wing Autolaunch
DevDocs INAV_Autolaunch.pdf

Programming

DevDocs Programming Framework.md

Adjustments

DevDocs Inflight Adjustments.md

Mission Control

iNavFlight Missions
DevDocs Safehomes.md

Tethered Logging

Log when FC is connected via USB

Blackbox

DevDocs Blackbox.md
INAV blackbox variables
DevDocs USB_Mass_Storage_(MSC)_mode.md

CLI

iNav CLI variables
DevDocs Cli.md
DevDocs Settings.md

VTOL

DevDocs MixerProfile.md
DevDocs VTOL.md

TROUBLESHOOTING

"Something" is disabled Reasons
Blinkenlights
Pixel OSD FAQs
TROUBLESHOOTING
Why do I have limited servo throw in my airplane

ADTL TOPICS, FEATURES, DEV INFO

AAT Automatic Antenna Tracker
Building custom firmware
Default values for different type of aircrafts
Features safe to add and remove to fit your needs.
Developer info
INAV MSP frames changelog
INAV Remote Management, Control and Telemetry
Lightweight Telemetry (LTM)
Making a new Virtualbox to make your own INAV
MSP Navigation Messages
MSP V2
OrangeRX LRS RX and OMNIBUS F4
Rate Dynamics
Target and Sensor support
UAV Interconnect Bus
Ublox 3.01 firmware and Galileo
DevDocs 1wire.md
DevDocs ADSB.md
DevDocs Battery.md
DevDocs Buzzer.md
DevDocs Channel forwarding.md
DevDocs Display.md
DevDocs Fixed Wing Landing.md
DevDocs GPS_fix_estimation.md
DevDocs LED pin PWM.md
DevDocs Lights.md
DevDocs OSD Joystick.md
DevDocs Servo Gimbal.md
DevDocs Temperature sensors.md

OLD LEGACY INFO

Supported boards
DevDocs Boards.md
Legacy Mixers
Legacy target ChebuzzF3
Legacy target Colibri RACE
Legacy target Motolab
Legacy target Omnibus F3
Legacy target Paris Air Hero 32
Legacy target Paris Air Hero 32 F3
Legacy target Sparky
Legacy target SPRacingF3
Legacy target SPRacingF3EVO
Legacy target SPRacingF3EVO_1SS
DevDocs Configuration.md
Request form new PRESET
DevDocs Introduction.md
Welcome to INAV, useful links and products
iNav Telemetry
DevDocs Rangefinder.md
DevDocs Rssi.md
DevDocs Runcam device.md
DevDocs Serial.md
DevDocs Telemetry.md
DevDocs Rx.md
DevDocs Spektrum bind.md

Clone this wiki locally