Volltext
1. Introduction
In recent years, advances in constructions, electronics, sensors and control algorithms have fueled a growth in the development of unmanned aerial vehicles (UAVs) [1]. The automatic applications of UAVs rely on the continuous control of the position, attitude, speed and other high level commands [2,3]. Specifically, the attitude and height (the clearance from the ground) controllers allow terrain-following of an autonomous quadrotor, which is useful for topography prediction, navigation and obstacle avoidance [4,5,6]. An integrated navigation framework is an autonomous system used for determining the position, attitude and velocity of UAVs using multi-sensors [7,8], i.e., a global positioning system (GPS), an inertial measurement unit ((IMU) e.g., an accelerometer, a gyroscope and a magnetometer) [9] and radar or distance sensors [10,11,12,13]. To achieve a more reliable travel in real environments, fruitful research efforts have focused on the height control problem [14].
The height control of common UAVs applies a proportional-integral-derivative (PID) control structure for the altitude that handles high impact and changed mass [15,16,17]. These controllers compare the behavior of the UAVs with a model and adapt the output of the controller to minimize the error between the model and the system. The design, implementation, simulation and evaluation of this controller will be presented in this paper divided into algorithms based on a classic control theory and a modern control theory. Control algorithms based on a modern control theory include a dynamic inverse control [18], a linear-quadratic regulator (LQR) control [19], an intelligent control (such as a neural network control [20,21]) and an adaptive control [22,23]. Ngo used the dynamic inversion based adaptive control method to control the height of the UAVs in the climbing stage and verified that the method had good effects through simulation [24]. However, the long-term flight of UAVs is a time-varying nonlinear system [25,26] whose external environment, speed, load and other parameters change continuously. For dynamic inverse control strategies, the control effect is often not satisfactory because there is no effective method to obtain the precise parameters of the model. Due to the requirement of the rapidity of response, the intelligent control algorithm, which needs complex calculations, is less used in practical engineering applications though it has a strong environmental adaptability [16]. Thus, in engineering practice, methods based on a classic control (such as the PID control) are mostly used because of the uncertainty of system parameters and the requirement of real-time control. The PID control is an effective and reliable flight control strategy that has been studied for some time and has a mature design strategy. For the UAVs’ terrain-following system, the problem to be solved is that the traditional single-stage PID control cannot meet the requirements in terms of response speed and stability [27]. In order to improve the quality of control, Idres used the cascade PID control method to control the UAVs and verified the efficiency of the cascade PID controlled UAVs in tracking slopes, circles and sinusoidal trajectories through a simulation [28]. Ren analyzed the system based on the classical control theory and proved that the cascade PID was better than the traditional single-stage PID control from an amplitude margin and a phase angle margin [29]. A cascade PID is one of the effective methods used to improve the quality of traditional PID control and it has been widely used in the field of process control [30,31,32]. For the cascade PID control of terrain-following UAVs, how to set the control feedback state quantity and how to adjust its parameters are important issues. The Ziegler–Nichols method [33], the critical proportionality method [34] and the attenuation curve method [35] are commonly used in engineering for tuning. Choosing a suitable method for PID tuning can also help improve the quality of control [36,37].
The main goal of this study is to improve the autonomous terrain-following and navigation performance of a quadrotor system. We address the detailed mathematical modeling of the quadrotor’s kinematics and dynamics of the quadrotor. The autonomous controller comprises of an integrated control for the quadrotor’s position, attitude and height control with the multi-sensor based control loops for terrain-following depicted in Figure 1. The control methodologies are conducted in MATLAB Simulink and the experiments on a quadrotor test-bed where interference such as wind conditions and sensor noise are incorporated in both the simulation and real-world experiments. A quadcopter measures its altitude relatively to the ground by using a range-finder. However, when the surface of the ground is fluctuating, a traditional PID control algorithm cannot meet the requirements of accurate terrain-following. Work in this innovation is the adaptive control function using the integration of a Global Navigation Satellite System (GNSS) (GPS) and a BeiDou Navigation Satellite System (BDS) [38], an inertial navigation system (INS) [39], a barometer [40] and a Lidar-lite sensor [41], especially the combination of an extended Kalman filter (EKF) and the cascade PID controller. In this paper, a dynamic model of the quadcopter is built and then linearized for simplification. The cascade PID is modeled and simulated in Simulink based on a tuning method according to the transfer function. Finally, an experiment is performed based on an open-source flight controller Pixhawk. Both the simulation and the real flight show improvements with this controller.
The rest of this paper is organized as follows. In II, dynamic models of the quadrotor are described. In III, we design the integration of the position and height control based on the combination of an extended Kalman filter and a cascade PID. IV verifies the reliability of the proposed models by MATLAB Simulink and real-world quadrotor flying avoiding a box above the ground. Conclusions are given in V. 2. Quadrotor System Models 2.1. Quadrotor Dynamic Models
The quadrotor changes its position and attitude by modifying the speed of the four motors [42,43]. The movements of back and forth and left and right are produced by pitch and roll, respectively, and the movements of up and down are achieved by the four motors increasing or decreasing the speed at the same time.
In order to study the kinematic law of aircraft, two coordinate systems [44] depicted in Figure 2 are defined as follows:
-
The geographic coordinate system (OE XE YE ZE) is used to study the motion state of aircraft relative to the earth and the space position coordinates in whichYE-XE-ZEpoint to East-North-Up, respectively.
-
The airframe coordinate system (Ob Xb Yb Zb) is used to study the rotational motion of aircraft relative to the center of gravity in whichYb-Xb-Zbpoint to Right-Front-Up, respectively.
According to the conversion relationship between the Euler angle and the attitude matrix, the attitude transfer matrixREbfrom the geographic coordinate system to the airframe coordinate system can be obtained:
REb=[cosθsinψsinψcosθ−sinθsinϕsinθcosψ−cosϕsinψsinϕsinθsinψ+cosϕcosψsinϕcosθcosϕsinθcosψ+sinϕsinψcosϕsinψsinθ−sinϕcosψcosϕcosθ]
The vector of[xyzϕθψ]Trepresents the position and angle of the quadrotor in the geographic coordinate system and the vector of[uvwpqr]Trepresents the linear velocity and angular velocity of the quadrotor in the airframe coordinate system. The conversion relationship of these twelve-dimensional variables in the two coordinate systems is:
{vE=RbE vbω=Tωb.
In Equation (2),vE=[x˙y˙z˙]T∈R3,ω=[ϕ˙θ˙ψ˙]T∈R3,vb=[uvw ]T∈R3,ωb=[pqr ]T∈R3, theRbEis the direction cosine matrix from the airframe coordinate system to the geographic coordinate system andTis the conversion matrix between the airframe rotation angular velocity and the attitude angle change rate. The dynamic model of the quadrotor is:
{x˙=w(sinϕsinψ+cosϕcosψsinθ)−v(cosϕsinψ−cosψsinϕ)y˙=v(cosϕcosψ+sinϕsinψsinθ)−w(cosψsinϕ−cosϕsinψ)z˙=w(cosϕcosθ)−u(sinθ)+v(cosθsinϕ)ϕ˙=p+r(cosϕtanθ)+q(sinϕtanθ)θ˙=q(cosϕ)−r(sinϕ)ψ˙=rcosϕcosθ+qsinϕcosθ.
According to Newton’s law of motion, the total force acting on the quadrotor is:
m(ωb⊗vb+v˙b)=fb,
wheremis the mass of the quadcopter,⊗represents the cross product operation andfb=[fxfyfz]∈R3is the total force acting on the quadrotor. According to Euler’s equation, the total torque produced by the four motors is:
I⋅ω˙b+ωb⊗(I⋅ωb)=mb.
In (5),τb=[τxτyτz]∈R3represents the total torque,Iis the inertia matrix of the quadrotor, which can be simplified as follows according to the symmetry of the quadrotor:
I=[Ixx000Iyy000Izz],
whereIxx, Iyy, Izzare called the central principal moments of inertia and can be measured through experiments. Therefore, the dynamic model of the quadrotor in the airframe coordinate system is:
{fx=m(u˙+qw−rv)fy=m(v˙−pw+ru)fz=m(w˙+pv−qu)τx=p˙Ixx−qrIyy+qrIzzτy=q˙Iyy+prIxx−prIzzτz=r˙Izz−pqIxx+pqIyy.
The above equation is established under the condition that the origin and axis of the airframe coordinate system coincide with the centroid and main axis of the quadrotor.
The total external force received by the quadrotor in the airframe coordinate system is:
fb=mgRT⋅e^z−ft e^3+fw,
wheree^zis the unit vector of the z-axis of the geographic coordinate system,e^3is the unit vector of the z-axis of the airframe coordinate system,gis the acceleration of gravity,ftis the total pulling force generated by motors andfwis the force generated by the wind acting on the quadrotor.
Ignoring the rotational torque in the control equation, the total external torqueΤbin the airframe coordinate system can be expressed as:
Τb=τb+τw,
whereτb=[τxτyτz]T∈R3,τw=[τwxτwyτwz]T∈R3are the control torques generated by the difference in motor speed and the movement generated by the wind acting on the quadrotor.
Substituting Equations (8) and (9) into Equation (7), the complete dynamic model of the quadrotor in the airframe coordinate system is obtained as:
{−mg(sinθ)+fwx=m(u˙+qw−rv)mg(cosθsinϕ)+fwy=m(v˙−pw+ru)mg(cosθcosϕ)+fwz−ft=m(w˙+pv−qu)τx+τwx=p˙Ixx−qrIyy+qrIzzτy+τwy=q˙Iyy+prIxx−prIzzτz+τwz=r˙Izz−pqIxx+pqIyy
Considering that the force and torque input by the control system are proportional to the square of the motor speed, the parameters in (10) are as follows:
{ft=cT(Ω12+Ω22+Ω32+Ω42)τx=22cTl(−Ω12+Ω22+Ω32−Ω42)τy=22cTl(−Ω12−Ω22+Ω32+Ω42)τz=cM(−Ω12+Ω22−Ω32+Ω42),
wherelis the distance between the center of the motor and the center of the airframe,cTis the tensile coefficient of the motor, andcMis the torque coefficient. All of the above parameters can be measured through experiments. Substituting (11) into (10), the complete dynamic model of the quadrotor in the airframe coordinate system can be further expressed as:
{m(u˙+qw−rv)=−mg(sinθ)+fwxm(v˙−pw+ru)=mg(cosθsinϕ)+fwym(w˙+pv−qu)=mg(cosθcosϕ)+fwz−cT(Ω12+Ω22+Ω32+Ω42)p˙Ixx−qrIyy+qrIzz=22cTl(−Ω12+Ω22+Ω32−Ω42)+τwxq˙Iyy+prIxx−prIzz=22cTl(−Ω12−Ω22+Ω32+Ω42)+τwyr˙Izz−pqIxx+pqIyy=cM(−Ω12+Ω22−Ω32+Ω42)+τwz.
The parameter setting of the quadrotor models is listed in Table 1.
The state vector is expressed as follows:
x=[ϕθψpqruvwxyz]T.
According to Equations (3) and (10), the dynamic equation of the quadrotor can be rewritten as:
{ϕ˙=p+r(cosϕtanθ)+q(sinϕtanθ)θ˙=q(cosϕ)−r(sinϕ)ψ˙=rcosϕcosθ+qsinϕcosθp˙=Iyy−IzzIxxrq+τx+τwxIxxq˙=Izz−IxxIyypr+τy+τwyIyyr˙=Ixx−IyyIzzpq+τz+τwzIzzu˙=rv−qw−g(sinθ)+fwxmv˙=pw−ru+g(sinϕcosθ)+fwymw˙=qu−pv+g(cosθcosϕ)+fwz−ftmx˙=w(sinϕsinψ+cosϕcosψsinθ)−v(cosϕsinψ−cosψsinϕsinθ)+u(cosψcosθ)y˙=v(cosϕcosψ+sinϕsinψsinθ)−w(cosψsinϕ−cosϕsinψinθ)+u(cosθsinψ)z˙=w(cosϕcosθ)−u(sinθ)+v(cosθsinϕ)
In hovering mode, the attitude of the aircraft changes very little. It can be made thatcosα=1, sinα=tanα=0and the state Equation (14) can be approximately expressed as:
{ϕ˙≈p+rθ+qϕθθ˙≈q−rϕψ˙≈r+qϕp˙≈Iyy−IzzIxxrq+τx+τwxIxxq˙≈Izz−IxxIyypr+τy+τwyIyyr˙≈Ixx−IyyIzzpq+τz+τwzIzzu˙≈rv−qw−gθ+fwxmv˙≈pw−ru+gϕ+fwymw˙≈qu−pv+g+fwz−ftmx˙≈w(ϕψ+θ)−v(ψ−ϕθ)+uy˙≈v(1+ϕψθ)−w(ϕ−ψθ)+uψz˙≈w−uθ+vϕ.
The above equation can be written in the form of a differential equation:
x˙=f(x,u).
In Equation (16),u=[ftτxτyτz]T∈R4,x=[ϕθψpqruvwxyz]T∈R12.
The balance point of the system can be set as follows:
x¯=[000000000x¯y¯z¯]T∈R12.
When the system is in equilibrium, the input of the system is:
u¯=[mg000]T∈R4.
The state equation is further written as:
{ϕ˙=pθ˙=qψ˙=rp˙=τx+τwxIxxq˙=τy+τwylyyr˙=τz+τwzIzzu˙=−gθ+fwxmv˙=gϕ+fwymw˙=fwz−ftmx˙=uy˙=vz˙=w.
Ignoring the influence of wind, it can be written as:
{ϕ˙=pθ˙=qψ=rp˙=τxIxxq˙=τylyyr˙=τzIzzu˙=−gθv˙=gϕw˙=−ftmx˙=uy˙=vz˙=w.
That is, the linearized model of the hovering state equation can be written as:
x˙=A⋅x+B⋅u,
where A and B can be expressed as follows:
A=∂f(x,u)∂x|x=x¯u=u¯=[0001000000000000100000000000010000000000000000000000000000000000000000000−g0000000000g00000000000000000000000000000100000000000010000000000001000],
B=∂f(x,u)∂x|x=x¯u=u¯=[00000000000001Ixx00001Iyy00001Izz000000001m000000000000000].
2.2. Quadrotor State Estimations When the laser-range-finder is used for distance measurement in terrain-following flight, the large vertical drop of the terrain will cause the delay of altitude control and the decrease of the stability of the quadrotor. Therefore, it is necessary to ameliorate the altitude control channel of the quadrotor to improve the stability and real-time performance of the quadrotor in a large maneuvering and large overload terrain-following flight.
Combined with the linearized dynamics model of the quadrotor in the hovering state in Section 2.2, the state equation of the height channel control model can be written as:
{x˙=A⋅x+B⋅uw=C⋅x,
whereA, B, xanduare the same as those defined in section A,C=[000000001000]. Using a Laplace transform on both sides of Equation (24), the transfer function of the vertical speed control can be obtained as:
GI(s)=1sm.
According to the voltage balance equation of the motor armature circuit, the motor model can be approximated as a first-order inertia link and the transfer function of the motor torque is:
GΠ(s)=KTms+1,
where Tm is the inertia time constant and K is the open loop gain. Multiplying Equation (25) by Equation (26), the final transfer function of vertical velocity is:
Gv(s)=K/ms(Tms+1).
Adding the integral link to Equation (27) to obtain the transfer function of the UAVs’ height control channel gives:
Gh(s)=K/ms2(Tms+1).
Using the parameter measurement method proposed in the literature [45], the inertial time constantTm=0.153and the open-loop gainK=1542of the 2212KV910 brushless motor were measured by experiment. SubstitutingTmandKKinto Equations (27) and (28), Equation (29) can be obtained:
{Gv(s)=8398.7s(s+6.5)Gh(s)=8398.7s2(s+6.5).
3. Quadrotor Integrated Control 3.1. Height and Vertical Velocity Estimations
As the error of the accelerometer will accumulate with the integration, it is not reliable to obtain the vertical velocity by using the accelerometer integration alone. Therefore, the optimal vertical velocity is estimated by integrating the differential data of the range-finder and the integral data of the accelerometer. The sampling period is set as T = 1 and the block diagram of the discretized fusion speed measurement system is shown in Figure 3.
In Figure 3,akis the speed increment from timetk−1to timetk,v^(k−1)is the optimal estimation of vertical velocity.Zkis the observations of multi-sensor increment from timetk−1to timetk, which are used as the estimated value of the observation correction of the speed measurement system.
Assuming that both the system and the measurement noise are Gaussian white noise with an expectation of zero, the discretized extended Kalman filter equation of the velocity measurement system [46,47] is:
{Xk=X^k−1+akPk=ΦP^k−1 ΦT+Qk−1Kk=Pk HkT (Hk Pk HkT+Rk)−1X^k=Xk+Kk(Zk−Hk Xk)P^k=(I−Kk Hk)Pk,
whereXkis the estimated value before correction attk,X^k−1is the best estimate attk−1,Pkis the mean square error before correction,Kkis the Kalman gain,Hkis the observation matrix,Qk−1andRk are the noise variance of the system and the measurement process, respectively [48].
3.2. Height and Vertical Velocity Based on a PID Controller The multi-sensor control method is a classic control method mainly designed by the PID control principle. The differential equation of the PID controller is as follows:
-
Continuous form
u(t)=kpe(t)+ki∫0te(τ)dτ+kdde(t)dt,
whereu(t)is the output of the control system,kp,kiandkdis the proportional, integral and the differential gain. Andeis the error between the set point and the feedback value,trepresents the current time, andτis an integral variable of which the value is from 0 to the current time.
-
Discrete form
u(t)=kpe(t)+ki∑i=0ke(i)+kd[e(k)−e(k−1)].
The PID control system of the quadrotor is based on a hierarchical control of inner and outer loops [49,50] and it can be further subdivided into four levels including position control, attitude control, control distribution and power distribution as shown in Figure 4.
As the height control of the quadrotor has nothing to do with the attitude of the body, there is an independent feedback input z in the height control system and the height correction is output after the height PID controller. Due to the balance between gravity and lift when the quadrotor is hovering, it is necessary to add gravity compensation to the height controller. When there is no error in the height, the controller can still output a stable value to control the motor rotation to maintain the hovering state. The simulation structure of the height controller is shown in Figure 5.
3.3. Height and Vertical Velocity Based on a Cascade PID Controller The cascade control system is one of the effective methods to improve the control quality and it has been widely used in process controls. The cascade PID controller is composed of a single loop PID regulator (as the main regulator) and an external set regulator (as a secondary regulator) connected in series to form a dual loop regulation system. The control output of the main regulator is used as the external set regulator and the control output of the external set regulator is sent to the control regulation structure.
In order to improve the quality of height control effectively, a cascade PID based height controller system is designed as follows. The error between the expected height and the height measured by the range-finder is set as the outer loop feedback of the cascade PID controller, the expected vertical speed is obtained after the outer loop PID controller and then the difference between the expected vertical velocity and the actual vertical speed is set as the inner loop feedback input to accomplish the adjustment of the vertical speed, which finally realizes the dual loop control of the height and vertical speed. The control structure and Simulink are shown in Figure 6 and Figure 7.
4. Simulation and Experiment Evaluations 4.1. Simulink Parameter Tuning by Attenuation Curve
In order to obtain the optimal control effect, the parameters of the PID regulator need to be tuned. There are three common methods for PID parameter tuning in engineering: the Ziegler–Nichols tuning method, the critical proportionality method and the attenuation curve method. These three methods have their own characteristics: the Ziegler–Nichols tuning method is suitable for systems with a delay link in their open loop transfer function while the critical proportionality method requires the order of the system to be third-order or above and the attenuation curve method adjusts controller parameters by attenuation frequency characteristics [28]. If we suppose that the initial state of the quadrotor isx=[0000000000010]TandΩi=[4100410041004100]T , this means that the drone hovers at a height of 10 m and the simulation duration is set to 15 s. After 2 s, a position control command is given to make the aircraft rise to a height of 20 m and remain hovering. The simulation results are shown in Figure 8.
The rising speed shown in the left picture (a) first increases and then decreases after 2 s and then oscillates and stabilizes at about 0 m/s. The right picture shows that the height overshoots after reaching 20 m and finally stabilizes at 20 m.
According to the previously derived open loop transfer function Equation (31) of the height control system, the attenuation curve method is selected to tune the PID controller parameters and build the single-stage/cascade PID controller simulation block in Figure 8.
After setting up the control system structure in Simulink, first set the regulator parameters in the control system to a pure proportional action (Ti = ∞, τ = 0) put the system into operation and then gradually adjust the proportionality δ from large to small until the ratio of the amplitude of the two adjacent periodic curves is 4:1 attenuation.
At this time, the ratio is 4:1, the attenuation ratio is δs, the rise time is tr and the time interval between two adjacent peaks is Ts. According to δs, tr or Ts, use the empirical formula in Table 2 to calculate each parameter value of the regulator [28].
The sequence of the PID controller parameter tuning is a proportional link first, then an integral link and then a derivative link. The parameters after tuning are:
Kp=0.009267,Ti=12.5,τ=2.7398.
In addition to the former requirements, the cascade PID controller must follow the inner first and then the outer setting rule. The parameters after tuning are:
Inner loop:
Kp1=0.037975,Ti1=0.117,τ1=0.039.
Outer loop:
Kp2=3.8235,Ti2=5.1282,τ2=0.04875.
Set the expected value of the height to 3 m and then input the tuned parameters into the simulation system. After the system has run, the response curves of the single-stage PID controller and the cascade PID controller are shown in Figure 9.
It can be analyzed from Figure 9 that after the parameters are set by the attenuation curve method, the time it takes for the cascade PID controller to reach the expected height is reduced by 70% compared with the PID controller. The comparison of specific indicators is shown in Table 3 below.
4.2. Carton Box Avoidance Experiment
To simulate the drastic changes of relative height to the ground, we carried out a carton box avoidance experiment to validate the proposed control algorithm. The assembled quadrotor as the experimental platform used a core controller stm32f427 cortex M4 and output inertial data with an mpu9250 nine axis IMU. Lidar-lite V3, a high-precision laser-range-finder, was used in the ranging sensor. Its data update frequency can reach 400 Hz, which can meet the requirements of high dynamic ranging. The cascade PID control algorithm was transplanted to flight control. The laser-range-finder height was taken as the output of the outer loop and the change rate of the measured altitude with time was taken as the input of the inner loop. The control performance test was carried out in an open outdoor field in Southeast University, China. The wheelbase of our quadrotor was 400 mm and the parameters of its brushless motor are shown in Table 4.
In order to simulate the height mutation of ground obstacles, a 0.48 m high carton was placed on flat ground as shown in Figure 10. Considering the great influence of high winds before take-off, the expected height of the UAV was set as 1.9 m, the horizontal flight speed was set as 0.5 m/s and the UAV was manipulated to fly over the carton repeatedly for 10 times. The controlled variables and experimental scenarios in the experiment are shown in Table 5 and Figure 10, respectively. When the quadrotor was holding its altitude, the proposed controller should have detected the edge of the box and manipulated it to fly over the box.
The resulting height data of the multi-sensor based controller can be seen in Figure 11 with the target height of 10 m above flat terrain. The difference in the performance of the height control clearly illustrates a better stability and sensitivity of the multi-sensor control. Therefore, the multi-sensor based control can react quickly especially with a reliable position and the velocity control in the z-axis.
For the height control of the quadrotor, we implemented with a PID and a cascade PID controller, respectively. The laser-range-finder measurements for the two controllers and the target height (1.9 m) are shown in Figure 12.
From the comparison of the fixed height flight results in Figure 12a,b, it can be seen that the adjustment time of the cascade PID controller was much less than that of the PID controller in the case of sudden changes of the ground altitude. In addition, the stability of the cascade PID control was better than that of the PID. After considering the statistics of all of the height measurement data, the shortest time from detecting a height change to reaching the desired height was 1.13 s and the longest time was 1.66 s when using the PID controller; when using the cascade PID controller, the shortest time was 0.43 s and the longest time was 0.75 s. The adjustment time of the cascade PID controller improved over 50% than that of the PID controller.
5. Conclusions This study investigated the position, attitude, velocity and height estimators based on GPS, accelerometers, gyroscopes and Lidar-lite onboard sensors, which were operated on a quadrotor of the Pixhawk open-source autopilot. For the terrain-following of the quadrotor, we have presented real-time height control, navigation and obstacle avoidance above outdoor undulant ground. In our system, GNSS and INS information were used to verify the position, velocity and attitude estimates with a constant height control for autonomous flights. The navigation and estimations depended on an available multi-sensor fusion. Apart from the absolute altitude estimation, the terrain-following required relative distance measurements from the Lidar-lite sensor. The proposed control algorithm was tested extensively in MATLAB Simulink simulations and then implemented on the real-world quadrotor vehicle. The results confirmed that the proposed combination of the multi-sensor fusion and cascade PID controller could ensure autonomous navigation, obstacle avoidance and height control, achieving better accuracy, response time and sensitivity. Future developments will fuse trajectory and velocity smoothing that enable the balance between control efficiency and terrain-following criteria.
Parameter | Unit | Measurements |
---|---|---|
g | m/s2 | 9.81 |
m | kg | 1.12 |
l | m | 0.225 |
cT | N s2/rad2 | 1.394 × 10−7 |
cM | N m s2/rad2 | 2.857 × 10−9 |
Ixx | kg m2 | 0.0093 |
Iyy | kg m2 | 0.0088 |
Izz | kg m2 | 0.0189 |
Controller | Proportional Bandδ | Integration TimeTi | Derivative Timeτ |
---|---|---|---|
P | δs | ∞ | 0 |
PI | 1.2δs | 2tr/0.5Ts | 0 |
PID | 0.8δs | 1.2tr/0.3Ts | 0.4tr/0.1Ts |
Dynamic Performance Index | PID | Cascade PID |
---|---|---|
OvershootMp | 12.6% | 4.6% |
Settling timets(s) | 4.427 | 1.352 |
Rise timetr(s) | 0.807 | 0.540 |
Peak timetp(s) | 1.338 | 0.190 |
Parameter | Value |
---|---|
m/kg | 1.2 |
K | 1542 |
Tm | 0.153 |
Variables | Values/m |
---|---|
Height of the obstacle (the box) | 0.48 |
Width of the obstacle (the box) | 1.2 |
Travel speed of the quadrotor (m/s) | 0.5 |
Author Contributions
Conceptualization, Y.Y. and X.L.; Data curation, Y.H.; Formal analysis, Y.Y.; Funding acquisition, H.Y.; Methodology, Y.Y.; Resources, H.Y., Z.W. and X.L.; Software, T.Z.; Supervision, H.Y. and T.Z.; Validation, Y.H.; Visualization, T.Z. and Z.W.; Writing-original draft, Y.Y., Y.H. and T.Z.; Writing-review and editing, X.L. All authors have read and agreed to the published version of the manuscript.
Funding
This work was funded by the projects of the National Natural Science Foundation of China (Grant Number: 51979041, 61973079 and 61802428) and Zhishan Youth Scholar Program of Southeast University 2242020R40136.
Institutional Review Board Statement
Not applicable.
Informed Consent Statement
Informed consent was obtained from all subjects involved in the study.
Data Availability Statement
The following are available online at https://github.com/yangyuancsi/Altitude-control: PID: code for the PID controllers, Altitude estimation: code for the Kalman filter, Video: video for carton box avoidance experiment. The data used to support the findings of this study are available from the corresponding author upon request.
Conflicts of Interest
The authors declare no conflict of interest.
Sie haben eine maschinelle Übersetzung des ausgewählten Inhalts unserer Datenbank angefordert. Diese Funktion steht ausschließlich zu Ihrer Information zur Verfügung und kann Humanübersetzungen in keiner Weise ersetzen. Vollständigen Haftungsausschluss einblenden
Weder ProQuest noch seine Lizenzgeber erteilen hinsichtlich dieser Übersetzungen irgendwelche Gewährleistungen oder Zusicherungen. Die Übersetzungen werden automatisch generiert und nicht in unserem System gespeichert. PROQUEST UND SEINE LIZENZGEBER WEISEN BESONDERS SÄMTLICHE AUSDRÜCKLICHEN ODER STILLSCHWEIGENDEN ZUSICHERUNGEN ZURÜCK, EINSCHLIESSLICH UND OHNE BEGRENZUNGEN JEDWEDE ZUSICHERUNGEN HINSICHTLICH DER VERFÜGBARKEIT, GENAUIGKEIT, PÜNKTLICHKEIT, VOLLSTÄNDIGKEIT, NICHTVERLETZUNG DER RECHTE DRITTER, VERKEHRSFÄHIGKEIT ODER EIGNUNG FÜR EINEN SPEZIFISCHEN ZWECK. Ihre Nutzung der Übersetzungen unterliegt sämtlichen Nutzungsbegrenzungen, die in Ihrer Elektronischen Lizenzvereinbarung niedergelegt sind. Mit Ihrer Nutzung der Übersetzungseinrichtung erklären Sie Ihren Verzicht auf alle und jedwede Ansprüche gegen ProQuest oder seine Lizenzgeber in Bezug auf Ihre Nutzung der Übersetzungsfunktion und hinsichtlich jedweder daraus resultierenden Ausgabe. Vollständigen Haftungsausschluss ausblenden
© 2021. This work is licensed under http://creativecommons.org/licenses/by/3.0/ (the “License”). Notwithstanding the ProQuest Terms and Conditions, you may use this content in accordance with the terms of the License.
Kurzfassung
For the application of the autonomous guidance of a quadrotor from confined undulant ground, terrain-following is the major issue for flying at a low altitude. This study has modified the open-source autopilot based on the integration of a multi-sensor receiver (a Global Navigation Satellite System (GNSS)), a Lidar-lite (a laser-range-finder device), a barometer and a low-cost inertial navigation system (INS)). These automatically control the position, attitude and height (a constant clearance above the ground) to allow terrain-following and avoid obstacles based on multi-sensors that maintain a constant height above flat ground or with obstacles. The INS/Lidar-lite integration is applied for the attitude and the height stabilization, respectively. The height control is made by the combination of an extended Kalman filter (EKF) estimator and a cascade proportional-integral-derivative (PID) controller that is designed appropriately for the noise characteristics of low accuracy sensors. The proposed terrain-following is tested by both simulations and real-world experiments. The results indicate that the quadrotor can continuously navigate and avoid obstacles at a real-time response of reliable height control with the adjustment time of the cascade PID controller improving over 50% than that of the PID controller.
Sie haben eine maschinelle Übersetzung des ausgewählten Inhalts unserer Datenbank angefordert. Diese Funktion steht ausschließlich zu Ihrer Information zur Verfügung und kann Humanübersetzungen in keiner Weise ersetzen. Vollständigen Haftungsausschluss einblenden
Weder ProQuest noch seine Lizenzgeber erteilen hinsichtlich dieser Übersetzungen irgendwelche Gewährleistungen oder Zusicherungen. Die Übersetzungen werden automatisch generiert und nicht in unserem System gespeichert. PROQUEST UND SEINE LIZENZGEBER WEISEN BESONDERS SÄMTLICHE AUSDRÜCKLICHEN ODER STILLSCHWEIGENDEN ZUSICHERUNGEN ZURÜCK, EINSCHLIESSLICH UND OHNE BEGRENZUNGEN JEDWEDE ZUSICHERUNGEN HINSICHTLICH DER VERFÜGBARKEIT, GENAUIGKEIT, PÜNKTLICHKEIT, VOLLSTÄNDIGKEIT, NICHTVERLETZUNG DER RECHTE DRITTER, VERKEHRSFÄHIGKEIT ODER EIGNUNG FÜR EINEN SPEZIFISCHEN ZWECK. Ihre Nutzung der Übersetzungen unterliegt sämtlichen Nutzungsbegrenzungen, die in Ihrer Elektronischen Lizenzvereinbarung niedergelegt sind. Mit Ihrer Nutzung der Übersetzungseinrichtung erklären Sie Ihren Verzicht auf alle und jedwede Ansprüche gegen ProQuest oder seine Lizenzgeber in Bezug auf Ihre Nutzung der Übersetzungsfunktion und hinsichtlich jedweder daraus resultierenden Ausgabe. Vollständigen Haftungsausschluss ausblenden