Skip to content

Controller Diagrams

This section contains diagrams for the main PX4 controllers.

The diagrams use the standard PX4 notation (and each have an annotated legend).

Multicopter Control Architecture

MC Controller Diagram

  • This is a standard cascaded control architecture.
  • The controllers are a mix of P and PID controllers.
  • Estimates come from EKF2.
  • Depending on the mode, the outer (position) loop is bypassed (shown as a multiplexer after the outer loop). The position loop is only used when holding position or when the requested velocity in an axis is null.

Multicopter Angular Rate Controller

MC Rate Control Diagram

  • K-PID controller. See Rate Controller for more information.

  • The integral authority is limited to prevent wind up.

  • The outputs are limited (in the control allocation module), usually at -1 and 1.

  • A Low Pass Filter (LPF) is used on the derivative path to reduce noise (the gyro driver provides a filtered derivative to the controller).

    INFO

    The IMU pipeline is: gyro data > apply calibration parameters > remove estimated bias > notch filter (IMU_GYRO_NF0_BW and IMU_GYRO_NF0_FRQ) > low-pass filter (IMU_GYRO_CUTOFF) > vehicle_angular_velocity (filtered angular rate used by the P and I controllers) > derivative -> low-pass filter (IMU_DGYRO_CUTOFF) > vehicle_angular_acceleration (filtered angular acceleration used by the D controller)

    IMU pipeline

Multicopter Attitude Controller

MC Angle Control Diagram

  • The attitude controller makes use of quaternions.
  • The controller is implemented from this article.
  • When tuning this controller, the only parameter of concern is the P gain.
  • The rate command is saturated.

Multicopter Acceleration to Thrust and Attitude Setpoint Conversion

  • The acceleration setpoints generated by the velocity controller will be converted to thrust and attitude setpoints.
  • Converted acceleration setpoints will be saturated and prioritized in vertical and horizontal thrust.
  • Thrust saturation is done after computing the corresponding thrust:
    1. Compute required vertical thrust (thrust_z)
    2. Saturate thrust_z with MPC_THR_MAX
    3. Saturate thrust_xy with (MPC_THR_MAX^2 - thrust_z^2)^0.5

Implementation details can be found in PositionControl.cpp and ControlMath.cpp.

Multicopter Velocity Controller

MC Velocity Control Diagram

  • PID controller to stabilise velocity. Commands an acceleration.
  • The integrator includes an anti-reset windup (ARW) using a clamping method.
  • The commanded acceleration is NOT saturated - a saturation will be applied to the converted thrust setpoints in combination with the maximum tilt angle.
  • Horizontal gains set via parameter MPC_XY_VEL_P_ACC, MPC_XY_VEL_I_ACC and MPC_XY_VEL_D_ACC.
  • Vertical gains set via parameter MPC_Z_VEL_P_ACC, MPC_Z_VEL_I_ACC and MPC_Z_VEL_D_ACC.

Multicopter Position Controller

MC Position Control Diagram

  • Simple P controller that commands a velocity.
  • The commanded velocity is saturated to keep the velocity in certain limits. See parameter MPC_XY_VEL_MAX. This parameter sets the maximum possible horizontal velocity. This differs from the maximum desired speed MPC_XY_CRUISE (autonomous modes) and MPC_VEL_MANUAL (manual position control mode).
  • Horizontal P gain set via parameter MPC_XY_P.
  • Vertical P gain set via parameter MPC_Z_P.

Combined Position and Velocity Controller Diagram

MC Position Controller Diagram

  • Mode dependent feedforwards (ff) - e.g. Mission mode trajectory generator (jerk-limited trajectory) computes position, velocity and acceleration setpoints.
  • Acceleration setpoints (inertial frame) will be transformed (with yaw setpoint) into attitude setpoints (quaternion) and collective thrust setpoint.

Fixed-Wing Position Controller

Total Energy Control System (TECS)

The PX4 implementation of the Total Energy Control System (TECS) enables simultaneous control of true airspeed and altitude of a fixed-wing aircraft. The code is implemented as a library which is used in the fixed-wing position control module.

TECS

As seen in the diagram above, TECS receives as inputs airspeed and altitude setpoints and outputs a throttle and pitch angle setpoint. These two outputs are sent to the fixed-wing attitude controller which implements the attitude control solution. However, the throttle setpoint is passed through if it is finite and if no engine failure was detected. It's therefore important to understand that the performance of TECS is directly affected by the performance of the pitch control loop. A poor tracking of airspeed and altitude is often caused by a poor tracking of the aircraft pitch angle.

INFO

Make sure to tune the attitude controller before attempting to tune TECS.

Simultaneous control of true airspeed and height is not a trivial task. Increasing aircraft pitch angle will cause an increase in height but also a decrease in airspeed. Increasing the throttle will increase airspeed but also height will increase due to the increase in lift. Therefore, we have two inputs (pitch angle and throttle) which both affect the two outputs (airspeed and altitude) which makes the control problem challenging.

TECS offers a solution by respresenting the problem in terms of energies rather than the original setpoints. The total energy of an aircraft is the sum of kinetic and potential energy. Thrust (via throttle control) increases the total energy state of the aircraft. A given total energy state can be achieved by arbitrary combinations of potential and kinetic energies. In other words, flying at a high altitude but at a slow speed can be equivalent to flying at a low altitude but at a faster airspeed in a total energy sense. We refer to this as the specific energy balance and it is calculated from the current altitude and true airspeed setpoint. The specific energy balance is controlled via the aircraft pitch angle. An increase in pitch angle transfers kinetic to potential energy and a negative pitch angle vice versa. The control problem was therefore decoupled by transforming the initial setpoints into energy quantities which can be controlled independently. We use thrust to regulate the specific total energy of the vehicle and pitch maintain a specific balance between potential (height) and kinetic (speed) energy.

Total energy control loop

Energy loop

Total energy balance control loop

Energy balance loop

The total energy of an aircraft is the sum of kinetic and potential energy:

ET=12mVT2+mgh

Taking the derivative with respect to time leads to the total energy rate:

ET˙=mVTVT˙+mgh˙

From this, the specific energy rate can be formed as:

E˙=ET˙mgVT=VT˙g+h˙VT=VT˙g+sin(γ)

where γ is the flight plan angle. For small γ we can approximate this as:

E˙VT˙g+γ

From the dynamic equations of an aircraft we get the following relation:

TD=mg(VT˙g+sin(γ))mg(VT˙g+γ)

where T and D are the thrust and drag forces. In level flight, initial thrust is trimmed against the drag and a change in thrust results thus in:

ΔT=mg(VT˙g+γ)

As can be seen, ΔT is proportional to E˙, and thus the thrust setpoint should be used for total energy control.

Elevator control on the other hand is energy conservative, and is thus used for exchanging potentional energy for kinetic energy and vice versa. To this end, a specific energy balance rate is defined as:

B˙=γVT˙g

Fixed-Wing Attitude Controller

FW Attitude Controller Diagram

The attitude controller works using a cascaded loop method. The outer loop computes the error between the attitude setpoint and the estimated attitude that, multiplied by a gain (P controller), generates a rate setpoint. The inner loop then computes the error in rates and uses a PI (proportional + integral) controller to generate the desired angular acceleration.

The angular position of the control effectors (ailerons, elevators, rudders, ...) is then computed using this desired angular acceleration and a priori knowledge of the system through control allocation (also known as mixing). Furthermore, since the control surfaces are more effective at high speed and less effective at low speed, the controller - tuned for cruise speed - is scaled using the airspeed measurements (if such a sensor is used).

INFO

If no airspeed sensor is used then gain scheduling for the FW attitude controller is disabled (it's open loop); no correction is/can be made in TECS using airspeed feedback.

The feedforward gain is used to compensate for aerodynamic damping. Basically, the two main components of body-axis moments on an aircraft are produced by the control surfaces (ailerons, elevators, rudders, - producing the motion) and the aerodynamic damping (proportional to the body rates - counteracting the motion). In order to keep a constant rate, this damping can be compensated using feedforward in the rate loop.

Turn coordination

The roll and pitch controllers have the same structure and the longitudinal and lateral dynamics are assumed to be uncoupled enough to work independently. The yaw controller, however, generates its yaw rate setpoint using the turn coordination constraint in order to minimize lateral acceleration, generated when the aircraft is slipping. The turn coordination algorithm is based solely on coordinated turn geometry calculation.

Ψ˙sp=gVTtanϕspcosθsp

The yaw rate controller also helps to counteract adverse yaw effects and to damp the Dutch roll mode by providing extra directional damping.

VTOL Flight Controller

VTOL Attitude Controller Diagram

This section gives a short overview on the control structure of Vertical Take-off and Landing (VTOL) aircraft. The VTOL flight controller consists of both the multicopter and fixed-wing controllers, either running separately in the corresponding VTOL modes, or together during transitions. The diagram above presents a simplified control diagram. Note the VTOL attitude controller block, which mainly facilitates the necessary switching and blending logic for the different VTOL modes, as well as VTOL-type-specific control actions during transitions (e.g. ramping up the pusher motor of a standard VTOL during forward transition). The inputs into this block are called "virtual" as, depending on the current VTOL mode, some are ignored by the controller.

For a standard and tilt-rotor VTOL, during transition the fixed-wing attitude controller produces the rate setpoints, which are then fed into the separate rate controllers, resulting in torque commands for the multicopter and fixed-wing actuators. For tailsitters, during transition the multicopter attitude controller is running.

The outputs of the VTOL attitude block are separate torque and force commands for the multicopter and fixed-wing actuators (two instances for vehicle_torque_setpoint and vehicle_thrust_setpoint). These are handled in an airframe-specific control allocation class.

For more information on the tuning of the transition logic inside the VTOL block, see VTOL Configuration.

Airspeed Scaling

The objective of this section is to explain with the help of equations why and how the output of the rate PI and feedforward (FF) controllers can be scaled with airspeed to improve the control performance. We will first present the simplified linear dimensional moment equation on the roll axis, then show the influence of airspeed on the direct moment generation and finally, the influence of airspeed during a constant roll.

As shown in the fixed-wing attitude controller above, the rate controllers produce angular acceleration setpoints for the control allocator (here named "mixer"). In order to generate these desired angular accelerations, the mixer produces torques using available aerodynamic control surfaces (e.g.: a standard airplane typically has two ailerons, two elevators and a rudder). The torques generated by those control surfaces is highly influenced by the relative airspeed and the air density, or more precisely, by the dynamic pressure. If no airspeed scaling is made, a controller tightly tuned for a certain cruise airspeed will make the aircraft oscillate at higher airspeed or will give bad tracking performance at low airspeed.

The reader should be aware of the difference between the true airspeed (TAS) and the indicated airspeed (IAS) as their values are significantly different when not flying at sea level.

The definition of the dynamic pressure is

q¯=12ρVT2

where ρ is the air density and VT the true airspeed (TAS).

Taking the roll axis for the rest of this section as an example, the dimensional roll moment can be written

=12ρVT2SbC=q¯SbC

where is the roll moment, b the wing span and S the reference surface.

The nondimensional roll moment derivative C can be modeled using the aileron effectiveness derivative Cδa, the roll damping derivative Cp and the dihedral derivative Cβ

C=C0+Cββ+Cpb2VTp+Cδaδa

where β is the sideslip angle, p the body roll rate and δa the aileron deflection.

Assuming a symmetric (C0=0) and coordinated (β=0) aircraft, the equation can be simplified using only the rollrate damping and the roll moment produced by the ailerons

=12ρVT2Sb[Cδaδa+Cpb2VTp]

This final equation is then taken as a baseline for the two next subsections to determine the airspeed scaling expression required for the PI and the FF controllers.

Static torque (PI) scaling

At a zero rates condition (p=0), the damping term vanishes and a constant - instantaneous - torque can be generated using:

=12ρVT2SbCδaδa=q¯SbCδaδa

Extracting δa gives

δa=2bSCδa1ρVT2=bSCδa1q¯

where the first fraction is constant and the second one depends on the air density and the true airspeed squared.

Furthermore, instead of scaling with the air density and the TAS, it can be shown that the indicated airspeed (IAS, VI) is inherently adjusted by the air density since at low altitude and speed, IAS can be converted to TAS using a simple density error factor

VT=VIρ0ρ

, where ρo is the air density as sea level, 15°C.

Squaring, rearranging and adding a 1/2 factor to both sides makes the dynamic pressure q¯ expression appear

q¯=12ρVT2=12VI2ρ0

We can now easily see that the dynamic pressure is proportional to the IAS squared:

q¯VI2

The scaler previously containing TAS and the air density can finally be written using IAS only

δa=2bSCδaρ01VI2

Rate (FF) scaling

The main use of the feedforward of the rate controller is to compensate for the natural rate damping. Starting again from the baseline dimensional equation but this time, during a roll at constant speed, the torque produced by the ailerons should exactly compensate for the damping such as

Cδaδa=Cpb2VTp

Rearranging to extract the ideal ailerons deflection gives

δa=bCp2Cδa1VTp

The first fraction gives the value of the ideal feedforward and we can see that the scaling is linear to the TAS. Note that the negative sign is then absorbed by the roll damping derivative which is also negative.

Conclusion

The output of the rate PI controller has to be scaled with the indicated airspeed (IAS) squared and the output of the rate feedforward (FF) has to be scaled with the true airspeed (TAS)

δa=VI02VI2δaPI+VT0VTδaFF

where VI0 and VT0 are the IAS and TAS at trim conditions.

Finally, since the actuator outputs are normalized and that the mixer and the servo blocks are assumed to be linear, we can rewrite this last equation as follows:

ω˙spb=VI02VI2ω˙spPIb+VT0VTω˙spFFb

and implement it directly in the rollrate, pitchrate and yawrate controllers.

In the case of airframes with controls performance that is not dependent directly on airspeed e.g. a rotorcraft like autogyro. There is possibility to disable airspeed scaling feature by FW_ARSP_SCALE_EN parameter.

Tuning recommendations

The beauty of this airspeed scaling algorithm is that it does not require any specific tuning. However, the quality of the airspeed measurements directly influences its performance.

Furthermore, to get the largest stable flight envelope, one should tune the attitude controllers at an airspeed value centered between the stall speed and the maximum airspeed of the vehicle (e.g.: an airplane that can fly between 15 and 25m/s should be tuned at 20m/s). This "tuning" airspeed should be set in the FW_AIRSPD_TRIM parameter.