Skip to content

控制器图解

本节包括PX4主要控制器的图解。

下面的图解使用标准 PX4 注释 (附有详细图例注解)。

多旋翼的控制架构

多旋翼位置控制器图解

  • 这是一个标准的级联控制架构。
  • 控制器采用P和PID控制的组合方式。
  • 状态估计来自EKF2模块。
  • 在某些模式下,外环(位置回路) 可能会被绕过 (在图中表示为外环之后增加一个多路开关)。 只有在位置保持模式或某轴无速度请求时,位置回路才会发挥作用。

多旋翼角速率控制器

固定翼姿态控制器图解

  • 采用K-PID控制器。 详情请参阅 Rate Controller 文件。

  • 为了防止积分饱和,积分环节的权重是受限的,

  • 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).

    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

:::

多旋翼姿态控制器

MC Angle Control Diagram

  • 姿态控制器使用 四元数
  • 姿态控制器是以这篇 文章为基础实现的
  • 当你调整这个控制器时,唯一需要考虑的参数是增益 P。
  • 输出的角速率命令是饱和的。

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.

多旋翼速度控制器

MC Velocity Control Diagram

  • 采用PID控制器来稳定速度。 该控制器输出的命令是加速度。
  • 积分器包括了一个采用钳制方法的反复位饱和措施。
  • 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.

多旋翼位置控制器

MC Position Control Diagram

  • 采用简单的P控制器来控制速度。
  • 输出的速度命令是饱和的,目的是保持一定的速度限制。 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.

静态力矩 (PI) 缩放补偿

多旋翼位置控制器图解

  • 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.

固定翼位置控制器

总能量控制系统(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 接受空速和高度需求量,然后输出油门和俯仰角控制量。 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.

在试图调试总能量控制系统 TECS 前,请一定要调试好姿态控制器。 增加飞行器的俯仰角度不仅会导致高度上升还会导致空速下降。

同时控制飞机的空速和高度不是一件简单的事。 增加飞行器的俯仰角会导致高度上升,同时也会导致空速下降。 推力(通过油门控制)增加整个飞机的总能量。 因此,俯仰角和油门两个输入量都会对空速和高度产生影响,从而使控制问题变得难了。

TECS 提供了一种解决方案,即根据能量而不是初始设定值来反映问题。 一架飞行器的总能量是飞行器动能和势能之和。 推力(通过油门控制)可以增加飞机的总能量。 一个给定的总能量状态可以通过势能和动能的任意组合来实现。 换句话说,飞行器在高海拔以低空速飞行和在低海拔以高空速飞行时的总能量是等价的。 我们称这种情况叫做比能量平衡,它是根据当前高度和真实空速设定值计算的。 可以通过控制俯仰角来控制飞行器的比能量平衡。 俯仰角增加将动能转变为势能,俯仰角减少则情况相反。 这样,通过将初始空速和海拔设定值转化为能量大小(空速和海拔存在耦合,而能量大小可以独立控制),就可以把控制问题解耦。 我们利用油门调节飞行器的特定总能量,利用俯仰角来维持势能(高度)和动能(真空速)的特定平衡点。

总能量控制回路

能量平衡回路

比能量控制回路

Energy balance loop

一架飞行器的总能量包括动能和势能。

ET=12mVT2+mgh

对时间求微分,就可以得到能量的变化率:

ET˙=mVTVT˙+mgh˙

通过上式,我们可以定义能量变化率:

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

其中γ是飞行器纵平面的速度角。 当γ很小时,我们可以近似认为sin(γ)=γ,所以可以得到下式:

E˙VT˙g+γ

列出飞行器的动力学方程,我们可以得到下式:

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

这里面的 T 和 D 分别是飞行器的推力和受到的阻力。 在水平飞行中,推力和阻力应该相等,所以推力的变化会导致下面式子:

ΔT=mg(VT˙g+γ)

正如可以看到的,ΔT 成正比 E˙,因此推力设置值应该用于控制总能量。

另一方面,对升降舵的控制是能量守恒的,因此用来交换动力能源,反之亦然。控制升降舵可以将势能转换为动能,反之亦然。 为此,特定的能量平衡变化率定义为:

B˙=γVT˙g

固定翼姿态控制器

FW Attitude Controller Diagram

姿态控制器采用级联环路的方法工作。 外环计算姿态设定值和估计值的误差,并将误差乘上一个增益(比例控制器),产生角速率设定值。 内环计算角速率误差,并采用(比例+积分)控制器产生一个所需要的角加速度。

然后可以根据期望的角加速度和系统先验信息,通过控制分配 (又叫混控),计算出执行机构 (副翼,水平尾翼,垂直尾翼,等) 的角偏移量。 此外,由于控制面在高速时更有效,而在低速时效率较低,因此根据巡航速度调整的控制器使用空速测量值进行缩放(如果使用这样的传感器)。

如果没有安装空速传感器,固定翼姿态控制的增益调整将被禁用 (它是开环的);您将无法在总能量控制系统中使用空速反馈。 但是,为了将飞机侧滑产生的侧向加速度最小化,偏航控制器利用转向协调约束产生偏航速率设定值。

前馈增益用于补偿空气动力阻尼。 基本上,绕机体轴的两个主要力矩分量分别来自:控制翼面 (副翼,水平尾翼,垂直尾翼 - 驱动机体转动) 和 空气动力阻尼 (与机体角速率成正比 - 阻止机体转动) 。 为了保持恒定的角速率, 可以在角速率回路中使用前馈来补偿这种气动阻尼。

Turn coordination

滚转和俯仰控制器具有相同的结构,并且假设纵向和横向动力学足够解耦,可以独立工作。 但是,为了将飞机侧滑产生的侧向加速度最小化,偏航控制器利用转向协调约束产生偏航速率设定值。 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 飞行控制器

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.

静态力矩 (PI) 缩放补偿

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

角速率回路 (FF) 缩放补偿

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.

总结

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.