Next Article in Journal
Electromyographic Validation of Spontaneous Facial Mimicry Detection Using Automated Facial Action Coding
Next Article in Special Issue
Lightweight Meter Pointer Recognition Method Based on Improved YOLOv5
Previous Article in Journal
Ultrasonic Thickness Measurement Method and System Implementation Based on Sampling Reconstruction and Phase Feature Extraction
Previous Article in Special Issue
PMIndoor: Pose Rectified Network and Multiple Loss Functions for Self-Supervised Monocular Indoor Depth Estimation
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Real-Time Optimal States Estimation with Inertial and Delayed Visual Measurements for Unmanned Aerial Vehicles

1
School of Artificial Intelligence and Big Data, Hefei University, Hefei 230601, China
2
School of Advanced Manufacturing Engineering, Hefei University, Hefei 230601, China
*
Author to whom correspondence should be addressed.
Sensors 2023, 23(22), 9074; https://doi.org/10.3390/s23229074
Submission received: 16 September 2023 / Revised: 5 November 2023 / Accepted: 7 November 2023 / Published: 9 November 2023

Abstract

:
Motion estimation is a major issue in applications of Unmanned Aerial Vehicles (UAVs). This paper proposes an entire solution to solve this issue using information from an Inertial Measurement Unit (IMU) and a monocular camera. The solution includes two steps: visual location and multisensory data fusion. In this paper, attitude information provided by the IMU is used as parameters in Kalman equations, which are different from pure visual location methods. Then, the location of the system is obtained, and it will be utilized as the observation in data fusion. Considering the multiple updating frequencies of sensors and the delay of visual observation, a multi-rate delay-compensated optimal estimator based on the Kalman filter is presented, which could fuse the information and obtain the estimation of 3D positions as well as translational speed. Additionally, the estimator was modified to minimize the computational burden, so that it could run onboard in real time. The performance of the overall solution was assessed using field experiments on a quadrotor system, compared with the estimation results of some other methods as well as the ground truth data. The results illustrate the effectiveness of the proposed method.

1. Introduction

There is a growing interest in autonomous aerial vehicles, which have a wide range of applications in mobile missions such as surveillance, exploration and recognition in different environments. Motion information of the vehicle, generally separated into rotation and translation, is needed to realize autonomous implementation of the system. The estimation of rotation has typically been well resolved using measurements from an onboard strap-down inertial navigation system [1]. The rotation information can be provided by a low-cost IMU [2], which is more accurate and less time consuming than pure visual algorithms. Therefore, we used the rotation information directly from the IMU and focused on the estimation of translation in this paper, including position and translational velocity.
Various kinds of sensors have been utilized in this field. The combination of GPS with gyroscopes, accelerometers, and magnetometers provided positional and velocity information as described in [3]. However, the downside is that GPS is susceptible to weather and terrain conditions, and it expends significant power. Laser range and visual-based sensors were used in [4] to obtain accurate position information, and in [5], a laser range sensor combined with visual-inertial odometry was proposed to help complete accurate positioning. However, laser range sensors also have some disadvantages, including their limited perception range and their excessive weight for UAVs. Doppler radars [6] and ultrasonic sensors [7] were chose onboard to solve this location issue. However, they are also constrained by factors such as accuracy, cost, weight, and environmental limitations. Vision sensors, due to their excellent performance in these areas, therefore have become a popular choice for obtaining motion information in the system [8].
Previous research obtaining motion information with the assistance of a visual input has been carried out in several ways. Dual cameras could reconstruct the captured environment and obtain the location of the system using a stereo computer vision algorithm. These methods were mentioned in [9,10]. However, in a micro aerial vehicle system, the weight of onboard equipment is usually hoped to be as light as possible, with the consideration of payload and cruise duration of the vehicle. Therefore, monocular cameras and related algorithms have been researched and implemented in a wide range of applications.
The optical flow method mentioned in [11,12,13] utilized pixel changes within the sequential image frames in the time domain and the correlation between adjacent frames to establish the corresponding relationship between previous and current frames, enabling the calculation of the object’s translation velocity. By integrating this velocity, the position information of the object could be obtained. The key advantage of this method is that it performs motion estimation without any requirement for knowledge about the scene. However, the position result will drift over time due to an unbounded accumulation of integration error, and the amount of computation required is enormous.
In [14,15,16], artificial landmarks with known information were laid on the ground, and image processing technology was used to detect and extract the feature point information of the artificial landmarks. Based on this, a coordinate system transformation model was established using coordinate system transformation and camera imaging models, thereby obtaining the position information of the UAVs. However, these methods only work in certain fixed environments.
In [17,18], the feature-based methods mentioned were designed to detect and match features points between the current video frame and the reference frame. The feature matching method mentioned in [17] was designed to detect and match features across multiple frames. In contrast, ref. [18] reported a feature tracking approach that specifically matched features between adjacent frames. Once corresponding points were identified, they were used to solve a visual equation to obtain information regarding relative rotation and translation. The semi-direct monocular visual odometry (SVO) proposed in [19] combines direct methods and feature-based methods for motion estimation. This method does not require feature points to be extracted from each frame, but rather transfers feature points of the current frame from the previous frame using an optical flow approach. Feature extraction is only necessary when inserting new key frames in the mapping thread. Therefore, improved robustness and real-time performance have been achieved. Direct Sparse Odometry (DSO) [20] combines the direct method with sparse reconstruction to extract the brightest pixel positions in image sequences. By monitoring sparse pixel groups, it takes into account image generation parameters and adopts indirect monitoring procedures. It should be pointed out that DSO only works perfectly when using photometric cameras for calibration, rather than conventional cameras, which do not provide high-precision results. Since the focus of this paper is on fusion of IMU data with pure visual sensor motion estimation information, the optimization of the pure visual motion estimation algorithms is not involved in this study.
Vision–inertial fusion methods were also studied by many researchers to estimate motion state. In [21], inertial data were used to establish motion estimation equations together with visual results, rotation and scale factor were also estimated with these equations, which was different from the method proposed in this paper.
Observing that the rotation information could also be provided by the IMU [2], there are redundant calculations here. More pairs of corresponded points are needed to solve the extra undetermined rotation variables, which could otherwise be directly obtained from the IMU. Besides extra computational complexity, another disadvantage is that wrong pairs of corresponded points will affect other correct ones when they are contained in one equation. A monocular vision algorithm alone is not able to obtain real scale but just the direction of translation; related solutions were mentioned in [22].
To obtain accurate, fast-updated and reliable states estimation of the system, position observation directly from a vision algorithm is usually fused with inertial information, normally based on expanded versions of the Kalman filter [11]. However, taking the multi-rate of the sensors and the delay of visual observation caused by hardware, wireless transmission and processing time of the vision algorithm into consideration, the classic Kalman filter model is not exactly the same as the model here and needs to be modified.
A single-rate Kalman filter with delayed measurement was researched in [23], and a solution was proposed by extrapolating the measurement. To reduce the computational burden, stable Kalman gain instead of real Kalman gain was used in the method, causing non-optimality. In [24], the residual was calculated using current measurements and past corresponding estimates, and it was then fused using normal Kalman filter update rules. However, due to the asynchronous nature between the estimate and the residual, it is not optimal.
In this article, a solution of motion estimation is introduced for an aerial vehicle with an onboard IMU and a downward-looking monocular camera fixed on it. The environment below the camera is assumed to be basically planar. The whole solution is separated into two steps.
First we presented a novel method to obtain the 3D local position from vision. Different from previous pure vision algorithms, the attitude information provided by the IMU was integrated in the vision equations as known parameters, rather than being treated as undetermined parameters.
With the assistance of a height sensor, this algorithm could obtain a measurement of the position just with a single pair of corresponded points, which makes the algorithm faster and more robust. Second, a multi-rate optimal filter is presented to fuse vision information and inertial information with consideration of the delayed measurement. Then a modification is made to control the computational complexity so that it could be implemented on an onboard micro controller.
The rest of the paper is organized as follows. Section 2 derives the state model from the dynamic model of the UAV. Section 3 presents the method obtaining location observation from measurements with a monocular camera, an IMU, and a height sensor. Section 4 describes the framework of the state estimation of the UAV. In Section 5, a real-time filter with consideration of multi-rate sensors and delayed vision observation is introduced. Experiment results are shown in Section 6 which verifies the feasibility and performance of the proposed method. Some conclusions are presented in Section 7.

2. Dynamic Model

Our system configuration is exhibited in Figure 1. An IMU and a monocular camera with its head down are the main sensors onboard. The IMU consists of an accelerometer, a magnetometer and a gyroscope.
Let w represent the world frame, where the x w , y w , and z w axes, respectively, correspond to the east, the north, and the vertical direction. Let b represent the body frame, where x b , y b , and z b axes adhere to the vehicle body, and the center of the body frame coincides with the system centroid.
Thus, one obtains the dynamic equation of the system motion:
p ˙ w = v w v ˙ w = a w
where p w = ( x w ,   y w ,   z w ) , v w and a w , respectively, represent the vehicle position, velocity, and acceleration in world frame.
Let R b w denote the rotation matrix from the body frame to the world frame. The vehicle acceleration in world frame could be given by:
a w = R b w a b a b = a m n a b a g
where a b represents the acceleration in body frame. a m denotes the acceleration value provided by the accelerometer adhering to the vehicle body. n a and b a denote the Gaussian noise and the bias of the accelerometer, respectively. g represents the gravity vector. b a could be calibrated either off-line or on-line [19]. It is not considered in this paper and the measured acceleration is regarded as non-bias. Note that because the body frame is a non-inertial frame, obtaining the complete relationship between a w and a b should take consideration of inertial acceleration, as shown in [25]. However, since the motion of the vehicle is not rigid during hovering flight, inertial acceleration is usually omitted to simplify the model in many papers, such as [22,26,27]. This simplification is adopted here and (2) is obtained.
Substituting (2) into (1), one obtains the dynamic model of the system:
p ˙ w = v w v ˙ w = R b w ( a m n a g )
which could be transformed into discrete form:
p k + 1 w = p k w + v k w Δ t v k + 1 w = v k w + R b w ( a k m n a g ) Δ t
where Δ t denotes the update cycle of the accelerometer. Let X = ( p w ,   v w ) denote the state vector in our system, then the state model of the system could be presented as:
p w v w k + 1 = 1 Δ t 0 1 p w v w k + 0 ( R b w a k m g ) Δ t + 0 R b w n a Δ t

3. Position Observation

3.1. Principle of Position Observation

Figure 2 shows the environment of visual observation. The camera looks downward and captures pictures at about 30 ms per frame. A sonar sensor is fixed on the vehicle pointing downward (a barometer is used when the sonar sensor is out of range), so the height of the vehicle could be obtained.
When the vehicle moves from one location to another, the two frames will be compared in order to obtain the 3D position of the system. The first step is to detect and match the feature points between the current frame and the reference frame. This part of the algorithm has been widely studied in computer vision and significant progress has been made. We choose the Speed Up Robust Feature (SURF) algorithm in this paper because of its good qualities as suggested in [18].
The algorithm was speeded up with a Graphic Processing Unit (GPU) to reduce the time cost. With the pairs of corresponded points obtained from the algorithm, a location observation method could be presented. In Figure 3, each pair of corresponded points is connected by a colored line. Additionally, during our hovering or small-area flight experiments, images were periodically compared with initial frames to avoid cumulative errors.
In Figure 2, the vehicle location and attitude both changed. Let b 1 and b 2 represent the body frames in two different locations, respectively. The reference video frame is captured where b 1 is located. Establish a world coordinate frame, where the center point is super positioned with one of the corresponding feature points p 0 w = ( x 0 w ,   y 0 w ,   z 0 w ) T . The camera frame is parallel to the body frame, with a small translation between the center points which could be obtained when the system was installed.
Transform the coordinate of p 0 w in the world frame into the image frame as below:
s 1 u 1 v 1 1 = M R 1 t 1 x 0 w y 0 w z 0 w 1  
where s 1 is a scale factor. ( u 1 ,   v 1 ) T represents a coordinate in the image frame. M could be known during calibration, which represents the intrinsic matrix of the monocular camera. R 1 indicates the rotation from the world frame to the camera frame, while t 1 denotes translation from the world frame to the camera frame. ( x 0 w ,   y 0 w ,   z 0 w ) T represents the coordinate of the feature point in the world frame, which is set as ( 0 ,   0 ,   0 ) T , since p 0 w is the center point in the world frame. Thus, the equation could be obtained as below:
t 1 = s 1 M 1 u 1 v 1 1  
Let h 1 indicate the measurement of the sonar sensor, and another equation could be listed to obtain the scale factor s 1 :
R 1 1 t 1 3 = h 1
where R 1 1 , the inverse of R 1 , represents the rotation from the body frame to the world frame. Therefore, R 1 1 t 1 represents the camera location in the world frame.
The camera location p c 1 w in location 1 could be obtained based on Equations (7) and (8):
p c 1 w = R 1 1 t 1  
And the camera location p c 2 w in location 2 could also be established with the same methods shown above. Furthermore, the 3D position from location 1 to location 2 could be obtained as below:
p = p c 2 w p c 1 w
Each pair of corresponded points provides a relative position vector between the current frame and the reference frame. These results are collected together for further processing to obtain the final position observation. Mean filter and median filter are often used here. The former is fast in computation and the latter is more robust to outliers but usually requires many computational resources. Mean filter is chosen herein, but we also added a simple step to remove outliers. The location result from one single pair of corresponded points will be removed if it is quite different from the location result we obtained from the last frame.
In the observation method presented above, the rotation matrix between the world frame and the camera frame is directly obtained from the IMU. The equations are simplified so a location result could be obtained from a single pair of corresponded points independently.
Only when the vehicle is moving in a small space can two frames of images be matched. The accumulated location results obtained above should be applied to the Simultaneous Localization and Mapping (SLAM) algorithm to obtain the location results in a large space. The main idea is to accumulate small displacement with large displacement, which is discussed in [18].

3.2. Measurements Synchronization

Notice that the measurements from the camera and the IMU must be synchronized when they are used in the same equation, which means the attitude measurement from the IMU used in the equation must be collected at the same time as when the image is captured.
In the system, images captured with the camera onboard are transmitted through a wireless link to the ground PC computer, and so are the attitude measurements from the IMU. Then, on the PC computer, after feature detecting and matching, attitude measurements are integrated to obtain location observation, as introduced above. Then, the result of observation is transmitted back to the micro controller onboard and further fusion with inertial information will be processed there. The flow of signals is shown in Figure 4. During this cycle of transmission and processing, measurements from different sensors must be synchronized whenever they are integrated together for calculation. The delay of visual measurement mainly consists of three parts: hardware, wireless transmission and computation. We assume the delay of hardware and transmission is basically static, which is supported by experiments, as will be mentioned in Section 6. The delay of computation, mainly including feature detecting and matching, is slightly different during each processing cycle, which is approximately 90 ms to 130 ms in our system. However, the cost of computation could be measured in software each time the computation is finished and could be transmitted back onboard together with the observation result. In summary, the total delay of a visual observation result could be obtained. A data buffer is set up, both on the onboard micro controller and on the PC computer, to store IMU information during a past period of time, and the corresponded data are picked up when the visual result with known delay arrives.
As discussed above, measurements from different sensors could be synchronized even with changing computational delay. In fact, this changing delay will not affect the observation method since the delay can be measured. However, when compensating the delay during state estimation onboard, which will be discussed in Section 5, the algorithm could be much more complex with a changing delay. Therefore, in this paper, a certain computational cycle is set in the software to make the delay fixed. It is set to longer than 130 ms to make sure it is enough for the processing of the visual algorithm most of the time in our experiment environments. The observation algorithm will return a signal of failure in case the computation is not finished during the set cycle, which has seldom happened.

4. Principle of State Estimation

A popular model to fuse information from multiple sensors is the Kalman filter model, which contains a state equation and an observation equation:
X k + 1 = A k X k + B k u k + Ψ k w k s t a t e e q u a t i o n Z k = C k X k + Φ k v k o b s e r v a t i o n e q u a t i o n
X denotes the state vector that needs to be estimated. u k denotes the input vector. Z k denotes the measurement vector. w k and v k denote the process noise and the measurement noise, respectively, which are usually considered as white Gaussian noise.
With the state model presented in Section 2 and the observation model presented in Section 3, the detailed Kalman filter model of our system could be established as:
p w v w k + 1 = 1 Δ t 0 1 p w v w k + 0 ( R b w a k m g ) Δ t + 0 R b w n a Δ t Z k = 1 0 p w v w k + v k
The statistical properties of n a are features of the accelerometer sensor, which could be found in a related hardware data sheet. Δ t in our system is set to 10 ms. As mentioned in the introduction, the rotation matrix R b w could be updated by the IMU independently. Observe that R b w is a direction cosine matrix (which is an identity matrix) and n a is symmetrical in the 3 axis of the sensor; it can be proved that the covariance matrix of R b w n a Δ t is static, which means the covariance matrix of the processing noise w k is static.
In (12), some of the parameters are time invariant, while the input signal is time variant. Let:
A = 1 Δ t 0 1 C = 1 0 P w k = Q P v k = R u k = 0 ( R b w a k m g ) Δ t B = Ψ = Φ = I
where P w k and P v k denote the covariance matrix of w k and v k , respectively. I denotes the identity matrix. B , Ψ and Φ will be substituted directly with the identity matrix in the equations below for simplification.
Now we have obtained a detailed Kalman filter model of the system. The entire framework of the state estimation solution in this paper is shown in Figure 5. Data from sensors are collected, organized and processed to establish the final estimation model of the system. Notice that the attitude estimation component is solved with the method suggested in [2], and we do not present the details of the attitude estimation algorithm in this paper.
The Kalman filter is an optimal linear filter. The estimation algorithm of the Kalman filter is a recursive update algorithm, which, typically for the model in Equation (12), could be divided into two steps:
Step 1 of the classic Kalman filter: (one-step optimal prediction) given the measurement vector Z k 1 = ( Z 1 ,   Z 2 ,   ,   Z k 1 ) T , one could obtain:
E ^ X k / Z k 1 = A E ^ X k 1 / Z k 1 + u k 1 P X k / Z k 1 = A P X k 1 / Z k 1 A T + Q
where E ^ X k / Z k 1 denotes the optimal estimation of X k with the measurement vector Z k 1 .
Step 2 of the classic Kalman filter: (optimal filtering) when a new observation Z k arrived:
E ^ X k / Z k = E ^ X k / Z k 1 + K k a l ( Z k C E ^ X k / Z k 1 )
where K k a l is called the Kalman gain and could be calculated with P [ X k / Z k 1 ] , Q and R .

5. Delay Compensation

5.1. Compensation Algorithm

The Kalman estimation model is established in Section 4. However, the real estimation model herein is different from the classic Kalman model because the observation delay and multiple updating frequencies of sensors need to be considered, as mentioned in Section 3.2. The signal sequence in the real estimation model is shown in Figure 6.
The update cycle of the inertial measurements as the same as the control cycle of the system is 10 ms, which will be used as a unit of time in the discrete analysis. Record the update cycle of the observation as T and the delay of the observation as D , which could be tested through experiments. T is mainly caused by software computation on the PC computer, while D is caused by hardware and wireless transmission, besides software computation. Imaging that every time a cycle of computation (which is T ) on the PC computer is finished and an observation result is obtained, the algorithms go on picking up the newest image just transmitted from onboard for the next cycle of computation, but the newest image already has a delay caused by hardware and wireless transmission (which is D T ). So, it could be understood that the delay of the observation is larger than the update cycle of the observation, and they need to be considered separately.
Assume that the first time we obtained an observation is at time T . Then, the observations are only obtained at the times multiple of T , and the real time at which they are measured is at time k T D , where k 1 . The subscript of times is allowed to be negative because it is just a mark of sequence.
Record Z k = { Z T D ,   ,   Z k T D } as the sequence of the first k observations we obtained.
The two steps (14) and (15) of the Kalman filter as well as a corollary of (14) will be used to obtain the optimal estimation of the state in the system with the delay of observation and the multiple updating frequency of sensors.
Corollary 1. 
multi-step optimal prediction
E ^ X s / Z k = A s ,   k T D E ^ X k T D / Z k + i = k T D s 1 A s ,   i + 1 u i P X s / Z k = A s ,   k T D P X k T D / Z k A s ,   k T D T + i = k T D s 1 A s ,   i + 1 Q A s ,   i + 1 T
where:
A s ,   k T D = i = k T D s 1 A i = A s k T D s > k T D
Equation (16) presents that the multi-step optimal prediction from time k T D to time s could be obtained given the optimal estimation at time k T D and the input information during the period from k T D to s . The corollary has been detailed, derived in [28] with the orthogonality principle. With (14), (15) and (16) presented above, the algorithm of the state estimation with the delay observation could be presented.
As shown in Figure 6, a new observation arrived at the time k T , which is actually measured at the time k T D . The whole sequence of observations we have obtained during the time k T + m ( 0 m < T ) does not change until a new observation arrives at the time ( k + 1 ) T . The optimal linear estimation of the state during the time k T + m ( 0 m < T ) could be expressed as:
E ^ [ X k T + m / Z k ] P [ X k T + m / Z k ] 0 m < T
where E ^ [ X k T + m / Z k ] denotes the optimal linear estimation of X with certain numbers of observation Z k . P [ X k T + m / Z k ] denotes the covariance matrix of the estimation.
Compensation algorithm:
Initial conditions: E ^ [ X k T D / Z k 1 ] and P [ X k T D / Z k 1 ]   are known.
Case 1: new observation arrived at t = k T ( m = 0 ), which is actually measured at t = k T D .
Step 1: optimal filtering at the time k T D with new observation Z k , using (15):
E ^ [ X k T D / Z k 1 ] P [ X k T D / Z k 1 ] ( 15 ) E ^ [ X k T D / Z k ] P [ X k T D / Z k ]
Step 2: Multi-step optimal prediction from the time k T D to ( k + 1 ) T D , using (16). This prediction result will be used as the initial conditions next time when a new observation arrives.
E ^ [ X k T D / Z k ] P [ X k T D / Z k ] ( 16 ) E ^ [ X ( k + 1 ) T D / Z k ] P [ X ( k + 1 ) T D / Z k ]
Step 3: Multi-step optimal prediction from the time k T D to k T , using (16). This prediction result will be used as the current optimal estimation result.
E ^ [ X k T D / Z k ] P [ X k T D / Z k ] ( 16 ) E ^ [ X k T / Z k ] P [ X k T / Z k ]
Case 2: no new observation arrived ( 0 < m < T )
Step 1: One-step optimal prediction from the time k T + m 1 to k T + m , using (14).
This prediction result will be used as the current optimal states estimation.
E ^ [ X k T + m 1 / Z k ] P [ X k T + m 1 / Z k ] ( 14 ) E ^ [ X k T + m / Z k ] P [ X k T + m / Z k ]
When a new observation arrives at time ( k + 1 ) T , the estimation algorithm could go on for the next cycle with the new initial conditions updated in Case 1 (Step 2) of the last cycle.
In every step of the update algorithm presented above, an optimal linear estimation result is given using all the observations obtained so far. Therefore, the update algorithm presented above is an optimal estimation algorithm.
In case of a dropout of the observation, as mentioned in Section 3.2, the observation algorithm will return a signal of failure. Therefore, in Case 1 (Step 1) a one-step prediction, the same as in Case 2 (Step 1), will be processed, instead of the filtering as usual. The effect of occasional dropouts could be reduced with the prediction, especially when the input signals are accurate.
The estimation result with dropouts of observation will be shown in Section 6.

5.2. Optimization of Compensation Algorithm

Because the estimation algorithm will be processed on the onboard micro controller, its computational complexity needs to be controlled. In the update algorithm presented above, Case 1 (Step 1) and Case 2 (Step 1) just use Equations (14) and (15) in the classic Kalman filter; thus the computational burden is acceptable. However, in Case 1 (Step 2) and Case 1 (Step 3), multi-step optimal prediction is processed. As shown in (16), there are two terms in the equation of the multi-step optimal prediction. The coefficient of the first term is static because A is static, so it is easy to calculate. However, the second term is a summary of the time-variant input signals, which will cause heavy computational burden if it is summarized in one control cycle when needed, e.g., at the time k T . In this paper, the computational burden is reduced with an iterative update method of this summary term. Let U k ( n ) denote this term which is defined as the “input compensation term”:
U k ( n ) = i = k n k 1 A k ,   i + 1 u i
With a buffer of the input signals, U k ( n ) could be updated in every control cycle and could be used whenever needed without complex computation.
U k + 1 ( n ) = U k ( n ) + u k A n 1 u k n
In Case 1 (Step 2) and Case 1 (Step 3), the input compensation term is U ( k + 1 ) T D ( T ) and U k T ( D ) , respectively. So the length of the buffer of the input signals is set to D (because D > T ), which means all the input signals during the last D period are stored in a buffer used for the updating of the input compensation term.
Optimization of compensation algorithm: in the update algorithm presented in Section 5.1, two extra initial conditions need to be added:
U ( k + 1 ) T D ( T ) U k T ( D )
And in every step of the algorithm, these two initial conditions should be updated using (25):
U ( k + 1 ) T + m D ( T ) = U ( k + 1 ) T + m 1 D ( T ) + u ( k + 1 ) T + m 1 D A T 1 u k T + m 1 D U k T + m ( D ) = U k T + m 1 ( D ) + u k T + m 1 A D 1 u k T + m 1 D
These two input compensation terms are updated every step to minimize the computational complexity. They will be used every time when a new observation arrives and the multi-step optimal prediction in (16) needs to be executed.

6. Experiment

Platform and Environment

A quadrotor vehicle is set up for the field experiment, with the necessary sensors mentioned above. An ATmega2560 micro controller (Atmel, SAN Jose, America) is used as the processor onboard. An MPU-6000 (TDK InvenSense, Sunnyvale, America) integrated 6-axis device which combines a 3-axis gyroscope and a 3-axis accelerometer is used to collect inertial information. Images captured with the downward-looking camera are transmitted through a wireless link to the ground PC computer for location and then observation results are transmitted back onboard for states estimation. Inertial information onboard is updated at 100 Hz. The cycle of the state estimation and control onboard is set to 100 Hz too.
The visual algorithm on the ground PC computer costs 90 ms to 130 ms, with a limit of the number of matching points utilized in our experiment, so the cycle of the algorithm, which is mentioned as T in Section 5, is set to 160 ms. An off-line method with an LED was used to test the delay caused by hardware and wireless transmission, which is mentioned as D T in Section 5. The micro controller onboard sends a signal to light up the LED, which is monitored with the camera and transmitted to the PC computer. Then an algorithm on the PC computer is used to test if the LED is light and sends a signal back onboard if so, which costs very little computational time. Through a comparison of the occurrence time of the two signals, the micro controller could obtain the delay through the whole cycle. With this test, the delay D could be measured accurately, which is measured as 200 ms in our experiment.
An independent, motion-tracking system consisting of several fixed cameras is installed to monitor the motion states of the system. The results of the motion estimation in this assistant system are more accurate than those of the onboard system because heavy HD cameras could be used here, and the cameras do not suffer the dynamic of the vehicle. After off-line processing, including low-pass filtering and outlier removal, the result was used as the ground truth data for the performance verification of the solution proposed in this paper.
The field experiment was carried out under the monitoring of the fixed motion-tracking system. The height of the vehicle was obtained with a downward-pointing sonar sensor, as mentioned in Section 3.1. The estimation results in the x-axis and y-axis, including position and velocity, are compared with the ground truth data. The estimation results from the two other online methods without compensation of the delay were given for comparison too.
Raw measurements of the acceleration in the world frame ( R b w a k m ) are shown in Figure 7, which will be used in the state model (5) for estimation.
Position observation in the x-axis and y-axis from the visual method are shown in Figure 8, with a comparison to the ground truth position data. Evidently, there is a delay between the observation and the ground truth data, which is approximately 200 ms. Ignoring the delay, the error of the observation position is not very big, which proves the feasibility of the visual observation methods in Section 3. However, if one directly differentiates the observation position data for velocity, the error will be enlarged, which is shown in Figure 9. The velocity is a very important state for the control of the UAV [16,22]; that is why multi-sensor data fusion is essential in state estimation of the UAV.
To illustrate the difference between ground truth and observation more clearly, we have subtracted the data of Figure 8 and Figure 9 (only in x-axis), and presented the error plot in Figure 10.
Three comparative experiments have been carried out to validate the performance of the proposed method. In the first comparative experiment, the delay of the observation was not considered, and a classic Kalman filter was directly implemented. In the second experiment, the delay of the observation was taken into consideration, so the observation data were fused with the corresponded inertial data in the data buffer, but there was no compensation in this method. In the third experiment, we compared our results with VINS-Mono (thanks to the author for open sourcing code).
Observe that in the method proposed in this paper, data aligning and delay compensation were both executed, so the second method actually realizes part of the function of the proposed method. Performance on the whole for methods as well as the ground truth data were shown in Figure 11 and Figure 12, where “direct fusion”, “aligning”, “vins-mono” and “aligning & compensation” denote the first comparative method, the second comparative method, VINS-Mono method and our method, respectively. Figure 11 presents the position estimation results and the latter picture presents the velocity estimation results.
For detailed performance analysis, we intercepted part of Figure 11 and Figure 12 (just in the x-axis) and enlarged the pictures, which are shown in Figure 13 and Figure 14.
As shown in Figure 13 and Figure 14, there is a big error between the “direct fusion” estimation and the ground truth data, especially in the peaks and valleys. The reason for this phenomenon is that the observation data (position) and the input data (inertial measurements) are not aligned, and their effects on the estimation near the extreme value could be sign opposite, so the estimation could not reach to the true extreme value. There is an obvious delay between the “aligning” estimation and the ground truth data, which is expected because no delay compensation step was executed. The results of the “aligning and compensation” estimation, compared to the former two methods, have good performance both in accuracy and delay compensation.
The experimental results also indicate that the proposed method of our paper obtains better accuracy results than the VINS-Mono methods. It is probably because we directly used inertial sensors to estimate attitude, which are more stable and accurate.
Observation from the visual method occasionally drops out because of either hardware or software problems. The estimator proposed herein is tolerant of dropouts within a period, which is one of the main advantages of multi-sensor data fusion. In the period when observations are faulty, the prediction step is repetitively executed with the state equation and inertial measurements, as mentioned in Section 5.1, which provides acceptable estimation results. The more accurate the inertial measurements are, the slower the estimation results will diverge. One part of estimation from Figure 11 and Figure 12 with dropouts of observation is shown in Figure 15 and Figure 16.
There are three continuous dropouts of observation between 20.11 s and 20.71 s, which means there are no observation data that could be used in 600 ms. However, as shown in Figure 15 and Figure 16, the results of the estimation were affected but remained in an acceptable range.
Table 1 shows the good performance of the proposed method (estimation with data aligning and delay compensation) in both position estimation and velocity estimation. The main disadvantage of the raw observation data is that there is a big error in velocity, as mentioned and shown in Figure 9. The “Aligning” estimation method outperformed the “direct fusion” estimation method, and the performance of the proposed “aligning and compensation” method improved observably compared to these two methods.
Table 1 also shows the root-mean-square error of the results of different methods (we have collected experimental data for 2 h under various lighting conditions and background environments), which presents the performance of these estimation methods.
We also calculated the standard deviations of the errors between our method and the true values, as well as the standard deviations of the errors between vins-mono and the true values, which are shown in Table 2. We added a significance test by comparing these standard deviations with the root-mean-square errors shown in Table 1. It is evident that the difference in root-mean-square errors between the two methods is greater than that in the standard deviations. This indicates that the difference between their mean errors is not simply due to fluctuations within the data, and our method has indeed improved the accuracy of motion estimation.
To investigate the relationship between experimental results and flight speed, we conducted error analysis on the experimental results, categorizing them into different speed ranges. The results are presented in Table 3. Also, to investigate the impact of latency on fusion results, we artificially adjusted the latency of the visual data during offline data processing and summarized the error statistics of the motion estimation results under different latencies in Table 4.
Table 3 shows that the statistical error of motion estimation results remains basically unchanged at different flight speeds. This is consistent with theoretical analysis as different flight speeds do not affect the accuracy of vision data and IMU data, as well as the frequency and delay of data fusion.
Table 4 shows that as the delay increases, the estimation errors of position and velocity rapidly increase. Evidently, this is due to the accumulation of errors that cannot be corrected in a timely manner as the observation data delay increases.

7. Conclusions

An entire solution for the estimation of the motion of a UAV is proposed in this paper, including a vision-aided observation method and a multi-rate delay-compensated data fusion method. The observation method utilized the inertial information from the IMU to simplify the computation. The data fusion method provided real-time optimal estimation results in the condition of visual delay and multiple update frequency of sensors. The performance of the observation method has been verified with a comparison with the ground truth data, and the performance of the estimation method has been verified with a comparison with the ground truth data as well as two other estimation methods.
Due to the requirement of image feature matching for visual localization in this method, it may fail when there are insufficient features in the background image, which can be caused by dark lighting or a smooth environment. The whole process including the visual algorithm will be put onboard in our future work. Additionally, since the visual noise in a practical environment is not static and could be affected by many factors, e.g., flight height, illumination and camera quality, another possible idea for future research is to take variant visual noise into consideration and provide adaptive estimation results.

Author Contributions

Conceptualization, L.Z. and S.L.; formal analysis, X.S., C.Z., L.Z. and S.L.; funding acquisition, X.S., L.Z. and S.L.; methodology, X.S. and S.L.; project administration, C.Z.; software, C.Z. and L.Z.; validation, X.S. and C.Z. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the Natural Science Foundation of Anhui Province, No.1808085QF195, the grant of Scientific Research and Talent Development Foundation of the Hefei University, No.21-22RC15, the Program for Scientific Research Innovation Team in Colleges and Universities of Anhui Province, No.2022AH010095, and the Educational Teaching Research Project of Anhui Province, No. 2022jyxm1328.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Data are contained within the article.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Jiang, W.; Li, Y.; Rizos, C. Optimal Data Fusion Algorithm for Navigation Using Triple Integration of PPP-GNSS, INS, and Terrestrial Ranging System. IEEE Sens. J. 2015, 15, 5634–5644. [Google Scholar] [CrossRef]
  2. Ahmed, H.; Tahir, M. Accurate Attitude Estimation of a Moving Land Vehicle Using Low-Cost MEMS IMU Sensors. J. Turbul. 2017, 18, 1723–1739. [Google Scholar]
  3. Gu, Y.; Gross, J.N.; Rhudy, M.B.; Lassak, K. A Fault-Tolerant Multiple Sensor Fusion Approach Applied to UAV Attitude Estimation. Int. J. Aerosp. Eng. 2016, 2016, 6217428. [Google Scholar] [CrossRef]
  4. Guerra, E.; Munguía, R.; Grau, A. UAV Visual and Laser Sensors Fusion for Detection and Positioning in Industrial Applications. Sensors 2018, 18, 2071. [Google Scholar] [CrossRef] [PubMed]
  5. Hao, Y.; He, M.; Liu, Y.; Liu, J.; Meng, Z. Range–Visual–Inertial Odometry with Coarse-to-Fine Image Registration Fusion for UAV Localization. Drones 2023, 7, 540. [Google Scholar] [CrossRef]
  6. Whitcomb, L.; Yoerger, D.; Singh, H. Advances in doppler-based navigation of underwater robotic vehicles. In Proceedings of the International Conference on Robotics and Automation, Detroit, MI, USA, 10–15 May 1999; IEEE: Piscataway, NJ, USA, 1999; Volume 1, pp. 399–406. [Google Scholar]
  7. Zhao, H.; Wang, Z.Y. Motion measurement using inertial sensors, ultrasonic sensors, and magnetometers with extended kalman filter for data fusion. IEEE Sens. J. 2012, 12, 943–953. [Google Scholar] [CrossRef]
  8. Stuckey, H.; Al-Radaideh, A.; Sun, L.; Tang, W. A Spatial Localization and Attitude Estimation System for Unmanned Aerial Vehicles Using a Single Dynamic Vision Sensor. IEEE Sens. J. 2022, 22, 15497–15507. [Google Scholar] [CrossRef]
  9. Moore, R.J.; Thurrowgood, S.; Bland, D.; Soccol, D.; Srinivasan, M.V. A stereo vision system for UAV guidance. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, St. Louis, MO, USA, 10–15 October 2009; IEEE: Piscataway, NJ, USA, 2009; pp. 3386–3391. [Google Scholar]
  10. Boucheloukh, A.; Boudjema, F.; Abdelkrim, N.; Demim, F.; Yacef, F. UAV navigation based on adaptive fuzzy backstepping controller using visual odometry. Int. J. Model. Simul. 2022, 42, 595–616. [Google Scholar] [CrossRef]
  11. Zou, Y.; Xia, K.; He, W. Adaptive Fault-Tolerant Distributed Formation Control of Clustered Vertical Takeoff and Landing UAVs. IEEE Trans. Aerosp. Electron. Syst. 2022, 58, 1069–1082. [Google Scholar] [CrossRef]
  12. Herisse, B.; Hamel, T.; Mahony, R. Landing a VTOL unmanned aerial vehicle on a movingplatform using optical flow. IEEE Trans. Robot. 2012, 28, 77–89. [Google Scholar] [CrossRef]
  13. Grabe, V.; Bülthoff, H.H.; Scaramuzza, D.; Giordano, P.R. Nonlinear ego-motion estimation from optical flow for online control of a quadrotor UAV. Int. J. Robot. Res. 2015, 34, 1114–1135. [Google Scholar] [CrossRef]
  14. Eberli, D.; Scaramuzza, D.; Weiss, S. Vision based position control for MAVs using onesingle circular landmark. J. Intell. Robot. Syst. 2011, 61, 495–512. [Google Scholar] [CrossRef]
  15. Bošnak, M.; Matko, D.; Blažič, S. Quadrocopter hovering using position-estimation information from inertial sensors and a high-delay video system. J. Intell. Robot. Syst. 2012, 67, 43–60. [Google Scholar] [CrossRef]
  16. Garcia, L.R.; Dzul, A.; Lozano, R. Hovering quad-rotor control: A comparison of nonlinearcontrollers using visual feedback. IEEE Trans. Aerosp. Electron. Syst. 2012, 48, 3159–3170. [Google Scholar]
  17. Klose, S.; Wang, J.; Achtelik, M. Markerless, vision-assisted flight control of a quadrocopter. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, Taipei, Taiwan, 18–22 October 2010; IEEE: Piscataway, NJ, USA, 2010; pp. 5712–5715. [Google Scholar]
  18. He, M.; Zhu, C.; Huang, Q.; Ren, B.; Liu, J. A review of monocular visual odometry. Vis. Comput. 2020, 36, 1053–1065. [Google Scholar] [CrossRef]
  19. Forster, C.; Pizzoli, M.; Scaramuzza, D. SVO: Fast semi-direct monocular visual odometry. In Proceedings of the IEEE International Conference on Robotics & Automation, Hong Kong, China, 31 May–7 June 2014; IEEE: Piscataway, NJ, USA, 2014. [Google Scholar]
  20. Engel, J.; Koltun, V.; Cremers, D. Direct sparse odometry. IEEE Trans. Pattern Anal. Mach. Intell. 2017, 40, 611–625. [Google Scholar] [CrossRef] [PubMed]
  21. Qin, T.; Li, P.; Shen, S. VINS-Mono: A Robust and Versatile Monocular Visual-Inertial State Estimator. IEEE Trans. Robot. 2017, 34, 1004–1020. [Google Scholar] [CrossRef]
  22. Zhang, B.; Xu, C. Research on UAV Attitude Data Fusion Algorithm Based on Quaternion Gradient Descent. In Proceedings of the International Conference on Communications, Information System and Computer Engineering Guilin University of Electronic Technology, Haikou, China, 5–7 July 2019; Guilin University of Electronic Technology: Guilin, China, 2019. [Google Scholar]
  23. Salahshoor, K.; Mosallaei, M. Process Fault Monitoring Using Data Fusion Based on Extended Kalman Filter Incorporated with Time-Delayed Measurements. IFAC Proc. Vol. 2008, 41, 8896–8901. [Google Scholar] [CrossRef]
  24. Bourgeois, F.; Kneip, L.; Weiss, S.; Siegwart, R. Delay and dropout tolerant state estimation for MAVs. In Proceedings of the 12th International Symposium on Experimental Robotics, New Delhi and Agra, India, 18–21 December 2010; IEEE: Piscataway, NJ, USA, 2010. [Google Scholar]
  25. Cheviron, T.; Hamel, T.; Mahony, R.; Baldwin, G. Robust nonlinear fusion of inertial and visual data for position, velocity and attitude estimation of UAV. In Proceedings of the IEEE International Conference on Robotics and Automation, Roma, Italy, 10–14 April 2007; IEEE: Piscataway, NJ, USA, 2007; pp. 10–14. [Google Scholar]
  26. Krznar, M.; Kotarski, D.; Pavković, D.; Piljek, P. Propeller speed estimation for unmanned aerial vehicles using Kalman filtering. Int. J. Autom. Control. 2020, 14, 284–303. [Google Scholar] [CrossRef]
  27. Chen, H.; He, X.; Qing, L.; Wu, Y.; Ren, C.; Sheriff, R.E.; Zhu, C. Real-world single image super-resolution: A brief review. Inf. Fusion 2022, 79, 124–145. [Google Scholar] [CrossRef]
  28. Fu, M.Y.; Deng, Z.H.; Yan, L.P. The Kalman Filter Theory and It’s Applicatioin in Navigation Systems; Science Press: Beijing, China, 2010; pp. 31–33. [Google Scholar]
Figure 1. System configuration.
Figure 1. System configuration.
Sensors 23 09074 g001
Figure 2. Location observation.
Figure 2. Location observation.
Sensors 23 09074 g002
Figure 3. Corresponded points.
Figure 3. Corresponded points.
Sensors 23 09074 g003
Figure 4. Signal transmission.
Figure 4. Signal transmission.
Sensors 23 09074 g004
Figure 5. Framework of estimation.
Figure 5. Framework of estimation.
Sensors 23 09074 g005
Figure 6. Signal sequence.
Figure 6. Signal sequence.
Sensors 23 09074 g006
Figure 7. Acceleration measurement.
Figure 7. Acceleration measurement.
Sensors 23 09074 g007
Figure 8. Position observation.
Figure 8. Position observation.
Sensors 23 09074 g008
Figure 9. Velocity differentiated by observation.
Figure 9. Velocity differentiated by observation.
Sensors 23 09074 g009
Figure 10. Difference between ground truth and observation (x-axis).
Figure 10. Difference between ground truth and observation (x-axis).
Sensors 23 09074 g010
Figure 11. Position estimation.
Figure 11. Position estimation.
Sensors 23 09074 g011
Figure 12. Velocity estimation.
Figure 12. Velocity estimation.
Sensors 23 09074 g012
Figure 13. Position estimation (part).
Figure 13. Position estimation (part).
Sensors 23 09074 g013
Figure 14. Velocity estimation (part).
Figure 14. Velocity estimation (part).
Sensors 23 09074 g014
Figure 15. Position estimation with dropout.
Figure 15. Position estimation with dropout.
Sensors 23 09074 g015
Figure 16. Velocity estimation with dropout.
Figure 16. Velocity estimation with dropout.
Sensors 23 09074 g016
Table 1. Root-mean-square error of the results of different methods.
Table 1. Root-mean-square error of the results of different methods.
Method P x (m) P y (m) V x (m/s) V y (m/s)
Raw observation0.08970.09920.37840.3488
Direct estimation0.10460.12070.23990.2530
Estimation with data Aligning0.08290.09850.18430.1951
Estimation with data Aligning and delay compensation0.03610.04340.13470.1452
VINS-Mono0.03890.04630.13980.1507
Table 2. Standard deviations of the results of different methods.
Table 2. Standard deviations of the results of different methods.
Method P x (m) P y (m) V x (m/s) V y (m/s)
Estimation with data Aligning and delay compensation0.00250.00230.00480.0046
VINS-Mono0.00240.00270.00420.0041
Table 3. Root-mean-square error of the results (aligning and delay compensation) of different velocity.
Table 3. Root-mean-square error of the results (aligning and delay compensation) of different velocity.
Velocity Range (m/s)[0, 0.2)[0.2, 0.4)[0.4, 0.6)[0.6, 0.8)[0.8, 1]
Error   of   P x (m)0.03560.03650.03690.03490.0371
Error   of   V x (m/s)0.13440.13530.13550.13320.1358
Table 4. Root-mean-square error of the results (aligning and delay compensation) of different delay.
Table 4. Root-mean-square error of the results (aligning and delay compensation) of different delay.
Velocity Range (m/s)150 ms200 ms250 ms300 ms400 ms
Error   of   P x (m)0.03610.04550.06890.09420.1468
Error   of   V x (m/s)0.13470.17130.23580.28770.3514
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Sun, X.; Zhang, C.; Zou, L.; Li, S. Real-Time Optimal States Estimation with Inertial and Delayed Visual Measurements for Unmanned Aerial Vehicles. Sensors 2023, 23, 9074. https://doi.org/10.3390/s23229074

AMA Style

Sun X, Zhang C, Zou L, Li S. Real-Time Optimal States Estimation with Inertial and Delayed Visual Measurements for Unmanned Aerial Vehicles. Sensors. 2023; 23(22):9074. https://doi.org/10.3390/s23229074

Chicago/Turabian Style

Sun, Xinxin, Chi Zhang, Le Zou, and Shanhong Li. 2023. "Real-Time Optimal States Estimation with Inertial and Delayed Visual Measurements for Unmanned Aerial Vehicles" Sensors 23, no. 22: 9074. https://doi.org/10.3390/s23229074

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop