Next Article in Journal
Pilot Study of the EncephaLog Smartphone Application for Gait Analysis
Previous Article in Journal
Tracking Control for Wheeled Mobile Robot Based on Delayed Sensor Measurements
 
 
Correction published on 20 February 2020, see Sensors 2020, 20(4), 1162.
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Novel Online Approach for Drift Covariance Estimation of Odometries Used in Intelligent Vehicle Localization †

1
Mechanical and Mechatronics Engineering, University of Waterloo, Waterloo, ON N2L 3G1, Canada
2
Intelligent Driving Function Department, IAV GmbH, 10587 Berlin, Germany
3
Intelligent Systems Lab (LSI), Universidad Carlos III de Madrid (UC3M), 28911 Leganes, Spain
4
Waterloo Cognitive Autonomous Driving (CogDrive) Lab, University of Waterloo, Waterloo, ON N2L 3G1, Canada
*
Author to whom correspondence should be addressed.
This paper is an extended version of our paper published in Osman, M., Hussein, A., Al-Kaff, A.,García, F., Armingol, J.M. Online adaptive covariance estimation approach for multiple odometry sensors fusion. In Proceedings of the 2018 IEEE Intelligent Vehicles Symposium (IV), Changshu, China, 26–30 June 2018.
Sensors 2019, 19(23), 5178; https://doi.org/10.3390/s19235178
Submission received: 26 September 2019 / Revised: 19 November 2019 / Accepted: 23 November 2019 / Published: 26 November 2019
(This article belongs to the Section Intelligent Sensors)

Abstract

:
Localization is the fundamental problem of intelligent vehicles. For a vehicle to autonomously operate, it first needs to locate itself in the environment. A lot of different odometries (visual, inertial, wheel encoders) have been introduced through the past few years for autonomous vehicle localization. However, such odometries suffers from drift due to their reliance on integration of sensor measurements. In this paper, the drift error in an odometry is modeled and a Drift Covariance Estimation (DCE) algorithm is introduced. The DCE algorithm estimates the covariance of an odometry using the readings of another on-board sensor which does not suffer from drift. To validate the proposed algorithm, several real-world experiments in different conditions as well as sequences from Oxford RobotCar Dataset and EU long-term driving dataset are used. The effect of the covariance estimation on three different fusion-based localization algorithms (EKF, UKF and EH-infinity) is studied in comparison with the use of constant covariance, which were calculated based on the true variance of the sensors being used. The obtained results show the efficacy of the estimation algorithm compared to constant covariances in terms of improving the accuracy of localization.

1. Introduction

Over the past few years, the focus of several research entities as well as many industrial companies on building fully autonomous vehicles has increased drastically. One of the main aspects of building such vehicles is the localization problem, i.e., how the vehicle can determine its position relative to its environment. To address this aspect, the use of highly accurate sensors is needed such as LiDARs or differential global positioning systems. However, the use of such sensors can be very costly. Another solution is to use different sensors of lower accuracy and then apply a sensor fusion technique to the readings of all sensors in order to get a better estimate of the vehicle’s pose (position and orientation) using multiple low cost sensors [1,2,3,4,5,6].
Multisensor fusion localization can be divided into two techniques; filtering techniques, and smoothing techniques. Filtering techniques are probabilistic techniques which stem from the Bayesian estimation theory [7] and can be divided into two major directions. On one hand, there are the Gaussian filters family, and among them are the nonlinear Kalman filters such as the Extended Kalman Filter (EKF) [8], Unscented Kalman Filter (UKF) [9] and Ensemble Kalman Filter (EnKF) [10] as well as the Extended Information Filter (EIF) and the Iterative Sparse Extended Information Filter (ESIF) [11]. On the other hand, there are the nonparametric family and on top of them is the particle filter (PF) and its different versions [12].
As for smoothing techniques, these are optimization-based techniques which emerges from the need to maximize the posterior probability distribution of the vehicles pose. In other words, smoothing techniques is a Maximum a Posteriori (MAP) estimation method which comes in the form of minimizing the negative log-posterior of the vehicle pose distribution as discussed in [13]. Among such techniques are the Moving Horizon Estimation [14] as well as the factor graph method which is widely used in Simultaneous Localization and Mapping algorithms such as [15,16].
In both cases, to be able to accurately estimate the vehicle pose, the amount of noise in each of the sensors needs to be known. In almost all the cases mentioned above, the amount of noise is quantified using the covariance matrix. Either in its direct form as in the Kalman filter, as the importance factor in the particle filter as mentioned in [7], or as the information matrix in case of the information filter or the smoothing techniques.
Unfortunately, the determination of such covariance matrices is not straightforward and in most cases infeasible. To determine the covariance matrix of a sensor, the ground truth needs to be available which is generally very difficult and costly to be acquired. Furthermore, even if the ground truth is available, the localization of a vehicle in most cases depends on odometries (wheel odometry, visual odometry, inertial odometry, and so on). Such odometries relies on integration to provide the localization measurement and therefore, tend to suffer from accumulation of error. This accumulation of error has a random nature and its amount depends on the environmental conditions as well as the nature of the sensor. This in turn results in the increase of the covariance values during operation [17,18].
In this paper, we propose an online algorithm for estimating the covariance of such odometries using another on-board sensor which does not suffer from drift and with known covariance. Such a sensor only suffers from random noise and is immune to accumulation of error since it does not rely on integration. The proposed algorithm updates the drift covariance estimate with each new sensor measurement. The fact that the proposed DCE algorithm is online facilitate the estimation of the changing covariance of the odometries instantaneously during the operation of the autonomous vehicle. This makes the use of such algorithm convenient since no pre-tuning of the covariances is required.
This paper extends on the authors’ published work in [19]. In [19], the authors introduced the drift error model for wheel encoders and showed the feasibility of using an exteroceptive sensor to determine the covariance of a proprioceptive sensor such as wheel encoders. In this paper, the authors generalize the methodology and the ideas adopted in [19] to any odometry regardless of the type of sensor being used. The drift error model for any arbitrary odometry and the drift covariance formula are more rigorously derived. Furthermore, the estimation methodology introduced in [19] is generalized and more formally presented as the DCE algorithm. The generalized estimation methodology can work with any localization or SLAM techniques irrespective of its theory of action. To validate the derived error model and the proposed algorithm, a comparative study is conducted using multiple real-world experiments in different conditions as well as sequences from Oxford RobotCar Dataset [20]. To further show the benefit of using the DCE algorithm alongside with popular open source odometry algorithms, we use the open source EU long-term dataset [21] along with the LiDAR Odometry and Mapping algorithm (LOAM) [22]. We report the results of the DCE-UKF compared with the results of LOAM algorithm.
This paper’s main contributions are the following:
  • The mathematical modeling of the random accumulation of error in the different odometries used in autonomous vehicle localization.
  • A general online algorithmic methodology for estimating the covariance of such drift suffering odometries using another sensor which is drift-free. This methodology is generic and suits any kind of odometry as well as any localization or SLAM algorithm either being filtering-based or smoothing-based.
  • The detailed implementation of an algorithm which follows this algorithmic methodology, the algorithm is available online for the benefit of the community.
To the authors knowledge, there is no previous work in the literature which addresses the problem of the covariance estimation of drift suffering odometries. Although several previous works attempt to reduce the drift in such odometries (as mentioned in Section 2), they still always suffer from drift due to their reliance on integration. The proposed work can be integrated with such drift reduction methods in order to estimate the covariance and consequently, increase the accuracy of the localization module. To show the benefit of integrating the DCE algorithm with odometries which suffer from drift, we use the LOAM algorithm alongside with the DCE-UKF and show the effect of using the DCE algorithm on the accuracy of the pose estimation compared to only relying on the LOAM algorithm for localization.
The remainder of the paper is organized as follows; Section 2 reviews the related work followed by the drift error modeling in Section 3. Section 4 describes the proposed algorithm as well as some implementation details. Then, in Section 5 the experimental setup, the localization algorithms, selected scenarios including the Oxford RobotCar Dataset and EU long-term dataset sequences as well as the evaluation metrics used for validating the algorithm are introduced. Section 6 shows the experimental results and the discussion and finally in Section 7 the conclusion is summarized.

2. Related Work

Ever since Rudolf Kalman proposed the Kalman filter in 1960 [23] and the continuous Kalman and Bucy filter in 1961 [24], the search for the covariances of the sensors being used in the filtering started [25]. Quantifying the noise covariance for a sensor in a multisensor fusion scheme has been the subject of several works in the literature. The difficulty in quantifying such covariances resulted in the emergence of adaptive filtering techniques [26,27].
In [28], a combination of a fuzzy logic controller and a conventional Kalman filter for an INS/GPS is proposed for the correction of both the process noise covariance and the measurement noise covariance. The algorithm was validated using a simulation with an EKF, UKF and an Iterated EKF. However, in using such algorithm, the design of the membership function for each sensor to estimate the covariance might be challenging. Especially since each sensor differs in nature and can suffer from errors in a different way. Furthermore, in case of odometries, the behavior of drift is unpredictable and designing a membership function to describe it is impractical.
Other works use adaptive Kalman filters to estimate the covariance matrices [29]. In [30], a Kalman filter with recursive estimation has been presented; to estimate the noise covariance matrix from the measurement sequence of linear time-invariant systems. Additionally, in [31], a stability analysis has been performed to verify the estimator’s stability. However, this work was introduced to linear systems and assuming that the sensors are not suffering from drift.
Beside the adaptive filtering approach which deals with the covariance of a Gaussian white noises, the fact that some sensors suffers from systematic drift errors due to aging and mis-calibration was also studied. In [32], a blind calibration algorithm is proposed to calibrate the sensor drift using signal space projection and Kalman filtering. However, in such case, the drift being addressed is the systematic drift which can be eliminated through calibration. Also, in [33], a deep learning approach is proposed to address the same issue.
In [34,35], a method based on Bayesian Maximum Entropy and Interacting Multiple Model is proposed to detect and correct the drift in sensors used in Internet of things (IoT) technologies. However, still in this case the drift error being addressed is the systematic drift of the sensors over time due to temperature conditions, vibrations and aging which can be calibrated and eliminated.
In [36,37], an online method to quantify and eliminate the random drift error in a Fiber optic gyro (FOG) is proposed through adaptive Kalman filtering. Such works only addresses the random drift noise in FOG and not in general odometries or general sensors suffering from random drift.
Most of the literature deals with drift as a systematic error which occurs due to the loss of calibration, temperature conditions, aging of the sensors or other environmental conditions. In such cases, this kind of error can be eliminated through calibration or compensation [38,39,40].
However, an odometry uses a sensor in which its measurements is being integrated over time to obtain the vehicle’s pose measurements. For example, dead-reckoning (wheel odometry) is done using a wheel encoder by integrating the output of the encoder through the kinematic model to get the pose of the vehicle. In such cases, the errors in the encoders are accumulated in the calculated pose. Another example can be a visual odometry algorithm which integrates the incremental motion of the vehicle between frames to calculate the overall pose of the vehicle.
There are several works in the literature which deals with drift in odometry. However, in these works, the methodology adopted by the authors was mainly based on reducing the error in the odometries. In [41], a visual odometry algorithm which uses a newly developed feature descriptor is introduced to reduce the drift in such visual odometry. Similarly, in [42], a convolutional neural network was used to infer the sun direction which in turn is used to reduce the drift error in the visual odometry.
In [43], a fusion scheme of monocular vision and radio-based ranging is introduced to reduce the drift error in a SLAM algorithm. In [44], a learning approach was used to solve for the drift of a LiDAR-only motion estimation. In all these works, dealing with drift was through trying to reduce it; however, drift cannot be completely eliminated, and it would be significantly useful to quantify the amount of drift in a given odometry during operation.
As already mentioned, such odometries uses sensors which suffers from various types of errors due to ground conditions (slippage), temperature changes, driving behavior or lighting conditions. As a results of integration, the error in the pose calculation will accumulate while the vehicle is operating. Furthermore, due to the change of operational conditions, the drift itself cannot be predicted and the rate at which error accumulates in the measurements of an odometry will change with time.

3. Drift Modeling in Odometries

A good start to model the drift in an odometry is through a proper definition of an odometry as well as drift error in odometry as seen throughout this paper.
Definition (Odometry): Odometry is measuring a vehicle’s pose x R n or a subset of it z R m through integrating the readings of a sensor after mapping it to the state (output) space,
Cx k z k = Cx k 1 z k 1 + g ( q ) Δ z k ,
where C R m × n is the binary output matrix and for C = I n × n , the odometry measures the overall state vector x , q R p is the raw measurement of the sensor used in the odometry, g : R p R m is the odometry mapping (maps the sensor measurements to the odometry output increments), and k N is the timestep where t = k T and T R 0 is the sampling time and t R 0 is the time in seconds.
Notice that an odometry measures the position of a vehicle or a robot, consequently, the state vector can be defined as
x : = x y z α β γ T ,
where x, y and z are the three Cartesian coordinates of the vehicle and α , β and γ are pitch, roll and yaw angles of the vehicle, respectively. Some odometries also provide the accelerations or the velocities, in such cases, these states can also be added to the state vector.
Definition (Drift Error): The drift error δ ( z , k ) R m is the unbounded accumulation of error in the odometry measurements due to the integration of the noisy readings, where for the drift error, the following is true.
δ ( 0 m × 1 , 0 ) = 0 m × 1 ,
lim z δ ( z , · ) = , and lim k δ ( · , k ) = .
Now consider the raw measurement of a sensor q used in an odometry, where the readings of the sensor is related to the states of the vehicle through the sensor model mapping h : R n R p .
q k = h ( x k )
Equation (4) can be written more precisely as a function of the observable states by the sensor h : R m R m as follows,
q k = h ( Cx k ) = h ( z k ) ,
since the measurements of the sensor is only a function of the related states which in this case is the z output vector.
Consequently, the ideal odometry equation will be
z k = z k 1 + g ( q k ) = z k 1 + g ( h ( z k ) ) .
Although the sensor measurement h ( z k ) is a function of the output vector z k , this is an implicit representation and the only way to measure the actual output vector z k is through the odometry.
In reality, the readings of the sensors q suffers from noises which can be represented as
q ^ = h ( z ) + ϵ ,
where q ^ is the noisy readings of the sensors and ϵ R p is a random variable representing the additive noise on the sensors.
Using Equation (7) in (6), the noisy odometry output can be written as follows:
z ^ k = z ^ k 1 + g ( q k + ϵ k )
Using the Taylor expansion assuming that g h q is a C smooth function, Equation (8) can be expanded as follows:
z ^ k = z ^ k 1 + g h ( z k ) + g q k ϵ k + ϵ k T 2 g q k 2 ϵ k 1 + ,
where
g q k = : J k R m × n , 2 g q k 2 = : H k R n × m ,
are the Jacobian matrix and the Hessian matrix and so on.
Equation (9) can also be rewritten as follows:
z ^ k = z k + i = 0 k J i ϵ i + ϵ i T H i ϵ i + δ ( z , ϵ , k ) ,
where δ R m is the random drift error in the odometry. The reason that the drift is random is the fact that it depends on the random noise in the sensor measurement ϵ .
Now assume a change Δ z occurred in the pose of the vehicle over a one timestep. Once again, through using the Taylor expansion, the drift error can then be written as follows:
δ ( z + Δ z , ϵ , k ) = δ ( z , ϵ , k 1 ) + δ z Δ z + Δ z T 2 δ z 2 Δ z +
and the increment of the random drift error Δ δ can be written as:
Δ δ = δ z K 1 Δ z + Δ z T 2 δ z 2 K 2 Δ z +
where K 1 R m × m and K 2 R m × m are the so-called drift coefficient matrices and are random matrices which depend on the sensor random noise ϵ . This in turn makes Δ δ and δ random variables.
Assumption: Since normally the sampling time T is small, Δ z is small and the higher order terms can be neglected.
Δ δ K 1 Δ z
Furthermore, we assume that the drift in each of the output states is independent from other states, in other words,
K 1 = d i a g { k 11 , k 22 , , k m m } .
Using Equation (13) in (11), the drift error at timestep k can then be written as:
δ k = δ k 1 + Δ δ k δ k 1 + K 1 Δ z
The covariance of the drift increment Q δ R m × m can then be derived through the definition of covariance as follows:
Q δ : = E [ ( K 1 Δ z μ δ ) ( K 1 Δ z μ δ ) T ] = E [ K 1 Δ z Δ z T K 1 2 μ δ K 1 Δ z T + μ δ μ δ T ] = E [ K 1 Δ z Δ z T K 1 ] μ δ μ δ T ,
where μ δ : = μ k Δ z R m is the mean (first moment) of the drift increment and μ k R m × m is the mean of the drift coefficient.
Assumption: The drift increment is a small value due to the small timestep and therefore the square of its mean μ δ is also small and can be neglected. Therefore, the drift covariance Q δ can be written as follows:
Q δ k = E [ K 1 Δ z Δ z T K 1 ] ,
where Q R m × m is the drift coefficient covariance matrix.
Using Equation (13), the drift covariance matrix Σ δ R m × m can be calculated as
Σ δ k = Σ δ k 1 + Q δ k .
Using the drift model stated in Equation (17), the drift covariance matrix Σ δ k can be estimated using a sensor which does not suffer from drift as will be shown in the following section.

4. Drift Covariance Estimation

Using the model developed in the previous section, the drift covariance Σ δ can be estimated using a sensor which does not suffer from drift. Throughout the rest of the paper, we call a sensor not suffering from sensor a drift-less sensor.
A good example for a drift-less sensor is a GPS which does not rely on integration for measuring the pose of the vehicle. On the other hand, an odometry can be an encoders odometry or a visual odometry. Other examples of drift-less sensors could be a camera for detecting landmarks or apriltags, a magnetometer, and so on.

4.1. Drift Covariance Estimation Algorithm

To avoid ambiguity, from now on, a measurement from an odometry will be denoted z ^ δ k and a drift-less sensor measurement will be denoted z ^ k .
Now consider a drift-less sensor measurement z ^ k R m with a known covariance R k R m × m . The true output of the vehicle z k most likely lies in the confidence ellipse of the measurement defined by the eigenvalues of R . Since the true output z k is not available. We resort to sampling the measurement distribution p ( z ^ k x k ) deterministically.
Z k : = z ¯ 0 k z ¯ 1 k z ¯ 2 k z ¯ q k ,
where Z k R m × q , and q is the number of samples taken from the drift-less measurement distribution, and z ¯ i k is the ith sample in Z k and z ¯ 0 k = z ^ k .
Using the samples in Z k , the innovation between the odometry output and the samples are calculated as follows:
v i k = e ( z ¯ i k , z ^ δ k ) ,
V k : = v 0 k v 1 k v q k ,
where V R m × q is called the innovation matrix, and e : R m × R m R m is the innovation (error) function which can be defined simply as e ( z ¯ i k , z ^ δ k ) : = z ¯ i k z ^ δ k in case of Cartesian states (position, linear velocity and linear acceleration), but needs more elaborate design in case of orientations to manage to calculate the innovation over the rotation manifold taking into account representation singularities. For more information, see [45,46].
The innovation values are stored in the so-called innovation memory tensor Ξ R n v × m × q which stores the last n v innovation matrices as shown in Equation (21). Here, we call n v , the measurement horizon. The choice of the measurement horizon n v is a design parameter and would be a trade-off between accuracy of the covariance estimation and the computational cost.
Ξ = Ξ 0 Ξ 1 Ξ q T = v 0 k n v T v 0 k n v + 1 T v 0 k T v 1 k n v T v 1 k n v + 1 T v 1 k T v q k n v T v q k n v + 1 T v q k T T ,
where Ξ i R n v × m is the matrix containing the n v previous innovations calculated for a given track of sample points.
As mentioned before, a drift-less sensor does not suffer from error accumulation, but only from random error. Now let us recall the drift model in the previous section.
Δ δ = K 1 Δ z , and δ z = K 1 .
The drift coefficient K 1 represent the increase in the drift in the output of the odometry with respect to the change in the output states z . Therefore, using a drift-less sensor, the change in the states due to drift can be captured by estimating the K 1 .
After we stored the innovation points for n v sample points, which encodes the deviation between the odometry and the drift-less sensor. The slope of these values is an estimate of K 1 since the normal progression of the output states z is captured by both sensors but only the drift suffering sensor has the drift component δ .
In other words, using the innovation memory tensor Ξ , the drift coefficient K 1 can be estimated for each track of the sample points, by computing the first order polynomial fit of the innovation data using a linear least squares approach as shown in the following equation.
τ K ^ i ] T = ( T ¯ T · T ¯ ) 1 T ¯ T Ξ i ,
T ¯ = 1 n v , 1 T ,
[ K ^ i ] T = k ^ 11 k ^ 1 m ,
where T R n v is the time vector for the last n v instances, K ^ i R m × m is the estimated drift coefficient matrix computed for Ξ i and [ K ^ i ] R m is a vector containing the diagonal values of the drift coefficient matrix, 1 n v , 1 R n v is an all ones vector, and τ R 1 × m is the intercept which is of no use here. Equation (23) is calculated for each sub-matrix Ξ i and q estimates of K 1 k are calculated.
Using these estimates, the drift increment covariance Q δ can be also estimated using Equation (16) as
Q ^ δ k = E [ K 1 Δ z ^ δ k Δ z ^ δ k T K 1 ] = 1 q i = 0 q K ^ i Δ z ^ δ k Δ z ^ δ k T K ^ i .
Consequently, the drift covariance matrix can be calculated as
Σ ^ δ k = Σ ^ δ k 1 + W Q ^ δ k ,
where W R m × m is a diagonal matrix of weights. Notice that in Equation (26), since the true output state increment Δ z k is not available, and assuming a fast sampling time, the increment from the odometry is used instead. To compensate for such change in the equation, the design parameter W is added to the algorithm. The covariance estimation algorithm is stated in Algorithm 1.
Algorithm 1: Drift Covariance Estimation Algorithm.
Sensors 19 05178 i001

4.2. Algorithm Implementation

A generic implementation of the covariance estimation algorithm was developed and available as online open source repository in [47]. This implementation uses the unscented transform introduced in [48,49]. Normally, the unscented transform is used in the unscented Kalman filter; however, it also fits for the proposed covariance estimation algorithm for sampling the drift-less measurement distribution.
Sampling a drift-less measurement distribution using the unscented transform is as follows.
Z k = z ^ k z ^ k + ( α R k ) z ^ k ( α R k ) R m × 2 m + 1
where α R is the sampling parameter in the unscented transform.
The α parameter is normally calculated as α = m + λ where lambda is a design parameter in the unscented transform (for more information see [49]). This calculation method can be used for sampling the measurement distribution. However, to show that the algorithm is independent of the sampling approach, here we make the α itself a design parameter which can be set by the user without the need to specify λ first
Remark: The choice of the parameter α should be dependent on the accuracy of the drift-less sensor covariance. More specifically, if the drift-less sensor covariance R k reflects under-confidence in the sensor, then the true pose z is more likely to be in the confidence ellipse and consequently, α should be less than 1. However, if the covariance reflects over-confidence in the sensor, then α should be greater than 1.
Also, similar to the unscented Kalman filter, rather than calculating the normal mean for the drift coefficients, we calculate a weighted mean. The weights calculations and the covariance calculation are described in the following equations.
W 0 = m 2 m + 1 and W i = m + 1 4 m 2 + 2 m ,
Q ^ δ k = i = 0 2 m W i ( m ) K ^ i Δ z ^ δ k Δ z ^ δ k T K ^ i ,
where W i R is the weight for a given sampled measurement.
Remark: The choice of the weights stated in Equation (29) is a design choice. The calculation of the weights is different than that of the unscented transform. Here, we chose to give a higher weight to the sensor measurement z ^ while giving equal weights to all other samples. Again, this is a design parameter which can be changed or even completely removed from the algorithm implementation.
Notice that the proposed algorithm only estimates the covariance of the odometry output z ^ δ but does not correct such drift. The correction can be done through using the output of the localization algorithm x ^ o u t as shown in the following equations and illustrated in Figure 1.
z ^ δ k = Cx o u t k 1 + Δ z ^ δ k
Σ ^ δ k = P ^ δ k 1 + W Q ^ δ k
Through using the drift covariance estimation, over time the covariance of the odometry will be more accurately quantified taking the odometry drift into consideration. This odometry with its estimated covariance is then provided to the localization algorithm which will help conserve an accurate localization output which in turn will be fed to the odometry to correct the drift.

Time and Memory Complexity

In this subsection, the time and memory complexity of the algorithm described in the last subsection are presented. As can be seen in Algorithm 1, the most computationally expensive operation is the sampling of the measurement distribution due to the matrix square root operation. The matrix square root is typically performed using Cholesky decomposition and in general the time complexity would be O( m 3 ) [50]. Although this is normally computationally expensive, in this case, the worst-case scenario covariance matrix would be a 6 × 6 matrix which still considered a simple operation due to the powerful processors available presently. Furthermore, if the noise in the sensor readings is uncorrelated (for different states), the covariance matrix reduces to a diagonal matrix and the matrix square root reduces to a set of normal square root operations which is a constant time operation. Consequently, ignoring the matrix square root, several steps of the algorithm iterates over each sampled measurement making the algorithm complexity O(q). Notice that the matrix inversion of ( T ¯ T · T ¯ ) is only an inversion operation of a 2 × 2 matrix which is a constant time operation.
As for the memory complexity, this can be specified using the innovation memory tensor. In each iteration of the algorithm, the innovation memory tensor must store the m measured states for each of the q samples generated for each of the timesteps in the measurement horizon n v . This makes the memory complexity of the algorithm O( m q n v ).

5. Experimental Work

To validate the proposed algorithm, several scenarios were designed and tested over various experiments as well as Oxford RobotCar Dataset [20]. Furthermore, to show the effect of the DCE algorithm on the localization results compared to open source odometries, we report the results of using an open source implementation of the LOAM algorithm along with the EU long-term dataset compared to that of using the same package alongside a DCE-UKF algorithm. This section describes the used platform for the real-world experiments, the testing environment, the designed scenarios, the multisensor fusion filters used in testing the algorithm, the selected evaluation metrics, and the sessions used for validation from the Oxford RobotCar Dataset and EU long-term dataset.

5.1. Experimental Platform

The aforementioned approach was tested over an automated ground vehicle, which is a part of the Intelligent Campus Automobile (iCab) project [51]. The vehicle is an electric golf cart, which is equipped with multiple on-board sensors, including LiDAR, stereo camera, optical encoders for wheel and steering, digital magnetometer and GPS module. Moreover, the vehicle is equipped with an embedded computer, which operates with Robot Operating System (ROS)-based architecture [52]. This architecture enables the vehicle to perform self-localization, navigation, planning and environment perception, among others.

5.2. Scenarios

The testing environment was the off-road vicinity of the campus, which has free pedestrian areas and surrounded with many buildings. In this environment, three scenarios were designed to evaluate the proposed approach, and each scenario was experimented three times under different conditions. The scenarios are depicted in Figure 2 and described in the following subsections.

5.2.1. Scenario I

The first scenario was designed as a circle of total diameter of 22 m, in which the iCab steering wheel was adjusted to 8.5 and average velocity of 5 kmph. In this case, the theoretical path was designed as a pure circle with the same diameter to be compared with the obtained odometries. The scenario was selected to evaluate the proposed approach performance in optimizing the localization in simple circular motion. Moreover, it is a closed loop, thus the vehicle end point is the same as the starting point.

5.2.2. Scenario II

The second scenario was designed as a quadratic shape of total length of 54 m and width of 56 m. This was also a closed shape, where the theoretical path was designed as a right-angled quadratic shape, thus the vehicle end point is the same as the starting point. The iCab followed the shape with average velocity of 5 kmph and rotating with sharp 30 around the corners. The scenario was selected to evaluate the proposed approach performance in optimizing the localization in both straight-line and curved motions.

5.2.3. Scenario III

The third and last scenario was designed as a trajectory from one building to another in the campus. The selected points are part of the pick-up/drop-off points of the iCab project. The theoretical path was obtained from the path planner to be compared with the obtained odometries. The path consists of multiple curves, straight-lines, dynamic obstacles, and it is one of the normal trajectories that the iCab follows in its daily operation. The iCab followed the path with average velocity of 5 kmph and a maximum of 15 steering angle during curvatures.
For the iCab experiments, we chose to use the velodyne sensor along with the LOAM algorithm as a reference odometry since the ground truth was absent through the experiments. The reason for choosing the LOAM algorithm (which is also considered an odometry) is the fact that package accuracy over the KITTI Benchmark [53] is in the second place in the list of the most accurate odometry algorithms, with values of 0.59 % and 0.0014 /m for the T E m e a n and O E m e a n (defined in the evaluation metrics subsection) respectively. Furthermore, The iCab experiments were executed with low speeds which enhance the accuracy of the LOAM algorithm as can be seen in Figure 2. Therefore, LOAM readings were considered to be the closest to ground truth in comparison with all other available sensors in the iCab, and accordingly it was set as the reference odometry through the experiments.

5.3. Oxford RobotCar Dataset

The Oxford RobotCar is a dataset for autonomous driving which was recorded through the period of May 2014 till December 2015 through traversing a fixed route through central Oxford using Oxford RobotCar platform which is an Autonomous Nissan LEAF [20]. The autonomous vehicle used is equipped with 6 Cameras, a LiDAR, GPS and INS + GPS as the ground truth.
In this paper, several sessions were used from the dataset to verify the covariance estimation algorithm. In the dataset, the GPS data contains its covariance. Accordingly, a multisensor fusion algorithm can be used to fuse the GPS data with visual odometry data also provided by the dataset.
Given that the visual odometry algorithm suffers from drift, the covariance of the visual odometry is estimated using the proposed algorithm with the GPS covariance then the localization using both visual odometry and GPS measurements. Moreover, since these are pre-recorded data, no correction was made to the results of the odometry. These tests are useful to validate the covariance estimation even without correction of the odometry output and its covariance.

5.4. EU Long-Term Dataset

The EU long-term Dataset [21] is a dataset for autonomous driving which contains the sensors data from multiple heterogeneous sensors. The data was collected using the UTBM car in human driving mode through driving the car in the downtown of Montpelier in France. For the long-term data, the driving distance was about 5.0 km per session which was driven over 16 min.
In this paper, we use the LiDAR data to validate the DCE algorithm. Since the GPS/RTK data from the dataset is the ground truth, we induced an artificial noise over its data and used it as a drift-less sensor for the covariance estimation. Furthermore, an open source implementation of the LOAM algorithm was used as a LiDAR odometry suffering from drift. Here, because the dataset was recorded with a relatively high speed (50 kmph), the results of the LOAM algorithm deteriorated very fast and showed a considerable amount of drift. Therefore, it was suitable for comparison with the DCE-UKF results.

5.5. Multisensor Fusion-Based Localization Algorithms

To evaluate the true potential of the proposed algorithm, the performance and results are compared relative to different values of constant covariances in a different multisensor fusion algorithms, and the r o b o t _ l o c a l i z a t i o n package was selected in order to do the fusion [54]. The package contains two fusion algorithms: Extended Kalman Filter (EKF) and Unscented Kalman Filter (UKF). Also, a third filter was added by the author to the r o b o t _ l o c a l i z a t i o n which is the Extended H-infinity filter.

5.5.1. Extended Kalman Filter

The Extended Kalman Filter(EKF) is the direct extension of the most widely used filter for sensor noise filtering which is the Kalman filter algorithm [23]. EKF uses the first order Taylor expansion to linearize the nonlinear system and propagate them using the error propagation theory. The EKF is a recursive algorithm which provides the optimal minimum mean-squared error (MMSE) state estimation assuming that the prior predictions and observations are both Gaussian random variables.

5.5.2. Unscented Kalman Filter

The Unscented Kalman Filter (UKF) is another nonlinear extension of the linear Kalman filter algorithm [48,49,55]. However, in case of the UKF, the algorithm deals with the nonlinear system directly without the need for linearization which leads to increased accuracy of the state estimation. UKF uses the unscented transform to propagate the error through the nonlinear system directly but still in this case both the prior prediction and observation are assumed to be Gaussian random variables.

5.5.3. Extended H-Infinity Filter

The Extended H-infinity filter is another probabilistic filter which aims at minimizing a different objective than that of the Kalman filters [56]. In EH-infinity, a game theory approach is used in which nature is considered the opponent of the filter and is trying to maximize the errors in the estimation. In other words, the EH-infinity assumes the worst-case scenario in which both the estimation and observation errors, are maximum [57]. This worst-case scenario is modeled by the cost function which is then converted to a minimax problem and the EH-infinity solves this minimax problem.
In this paper, the three filters are used to show the efficacy and accuracy of the covariance estimation algorithm being proposed. The choice of using r o b o t _ l o c a l i z a t i o n package was made to use an already verified and published fusion package, thus focusing on the effect of using different covariances under the same conditions.

5.6. Evaluation Metrics

The evaluation metrics for the sensor fusion algorithms were calculated for both translation and orientation. First, the mean and maximum error percentages of the translation; which are calculated as shown in Equations (33) and (34) respectively.
T E m e a n [ % ] = 1 N k = 1 N x ^ k y ^ k x k y k 2 T o t a l D i s t a n c e ,
T E m a x [ % ] = m a x ( x ^ k y ^ k x k y k 2 ) T o t a l D i s t a n c e ,
where ( x ^ k , y ^ k ) are the estimated coordinates of the vehicle and ( x k , y k ) are the true coordinates at time step k.
As for the orientation, the mean and maximum error in the orientation are divided by the total distance covered by the vehicle, which are calculated as shown in Equations (35) and (36) respectively.
O E m e a n [ o / m ] = 1 N k = 1 N θ ^ k θ k T o t a l D i s t a n c e ,
O E m a x [ o / m ] = m a x ( θ ^ k θ k ) T o t a l D i s t a n c e ,
where θ ^ k is the estimated orientation of the vehicle and θ k is the true orientation of the vehicle at time step k.

6. Results and Discussion

Five different sensors were used in the iCab platform through experiments; the LiDAR as the reference odometry, GPS as a drift-less sensor, wheel encoders odometry and visual odometry [58]. Additionally, compass orientation was included to the fusion algorithm. The covariance was estimated for the odometries (Encoders and Visual) using the available covariance of the drift-less sensor (GPS). For the covariance estimation algorithm, the encoder odometry measured the three planar states of the vehicle [ x , y , γ ] T while the visual odometry only estimated the planar position of the vehicle [ x , y ] T .
As for Oxford RobotCar Dataset, the sessions used in this paper are a total of four days driving in the dataset which is about 7165 meters driving. However, in the case of the dataset, only the translation errors are calculated due to the absence of measurements of the orientation.
Furthermore, for the EU long-term dataset, a total of three sessions were used for the comparison, these are a total of 15,000 km of driving divided over three days in different weather conditions. Similar to Oxford RobotCar Dataset, only the translational ground truth data are available in the dataset (from the GPS/RTK), so here we only show the result of the fusion for the translation.
To show the efficacy of the Drift Covariance Estimation (DCE) algorithm, its localization results are compared to the results of different values of constant covariances. The values used are percentages of the True Variances (TV) of the odometries, which are calculated retroactively from the data of the experiments.
The constant values of covariances are selected depending on the error values for each experiment. As shown in the tables below, 125 % of the TV gave higher error than 25 % of the TV. Observing these results, smaller percentages of the TV were used in order to reach better accuracy. In addition, lower than 2.5 % of the TV were omitted, because they also provided less accurate results.
All the data from the different scenarios are fused using the three filters mentioned in Section 5. It is worth mentioning that the results from each filter are taken separately as no direct comparison between the filters is intended in the paper. For example, the EH filter contain a parameter called the performance bound which needs tuning and can significantly enhance the results of the filter; however, the enhancement of the filter results is out of scope since the main concern is to validate the efficacy of the DCE algorithm for different fusion algorithms using the same filter parameters for constant and adaptive covariances.
Also, notice that the correction step was used through the experiments of the iCab and the EU Long-term dataset. The covariance for the odometries based on the TV was calculated as follows:
Σ ^ k = P ^ k 1 + Q t Δ z ,
where Q t R m × m is the covariance matrix containing the true variances for each of the output states.

6.1. Platform Experiments

In Figure 3, one of the three experiments which were executed for Scenario I using the EKF is shown as well as the error plots for each of the covariance values and the GPS which was used to estimate the covariance of the odometries. Notice that for the TV and the 125 % of TV, the output of the EKF diverged which means that even the use of the true variance did not result in good fusion results. This is expected because the covariance of an odometry should increase with time as the drift error increases in the measurements. Overall, the DCE-EKF outperformed all other covariance values as can be seen in the error plot.
Notice that although the TV was outperforming the DCE algorithm during the first 25 seconds of the experiment, as shown in the translation error plot, the DCE algorithm had significantly more accurate results afterwards. This is a result of the fact that the DCE relies on previous data to estimate the covariance and at the beginning of the experiment, there was no enough data to estimate the covariance accurately and the GPS was suffering from increasing error imitating that of an odometry (as shown in Figure 3). However, after having enough data the DCE algorithm managed to converge to a much better estimate of the covariance and consequently of the vehicle’s location.
Table 1, Table 2 and Table 3 summarizes the quantitative results for Scenario I over the three executed experiments. The DCE showed better accuracy while using any of the localization algorithm (UKF, EKF or EH ) in both orientation and translation.
Figure 4 shows the localization output of the DCE-UKF along with the odometries and the GPS measurements. This experiment was executed while the vehicle was moving very close to a building which led to very bad GPS measurements. It can also be seen that both the encoders and the visual odometries suffered from a huge amount of drift. Given all these inaccuracies, through the use of the DCE algorithm and the correction step, the drift in both odometries were eliminated. Notice that although the other runs with constant covariance also had a correction step, the effect of the drift and the inaccuracies in the GPS deteriorated the localization output which shows the efficacy of the DCE algorithm.
Although the GPS error was significantly fluctuating as can be seen in the error plot, the output of the DCE-UKF did not diverge or deteriorate unlike other covariance values. There are two reasons for such results. First, the algorithm relies on calculating the first order polynomial fit of innovations between the odometry and the drift-less sensor, which means that the magnitude of the error in the drift-less sensor itself does not affect the result of the DCE algorithm but only the slope of such error. Second, although the GPS readings suffer from sudden increases in the error, due to the fact that the estimation algorithm does not rely on only one measurement but a series of past measurement (measurement horizon n v ) to estimate the covariance, the estimated covariance algorithm was accurate enough to get much better results compared to the sensors used and to any other constant covariance.
In Scenario II, the localization output for the TV and 125 % diverged which again confirms the fact that using constant covariances for odometries is not accurate as well as finding accurate values for the covariances through experiments is not applicable since the drift behavior changes with operation conditions. Even if the TV can be quantified, using it will not produce accurate localization results and even if it works for a given experiments, it might lead to divergence in other operation conditions or in longer durations of operation.
Table 4, Table 5 and Table 6 shows the quantitative results for scenario II. The DCE algorithm shows better performance than constant covariances for the three used localization algorithms. In the EKF results, the maximum orientation error for other values of covariance was better than that of the DCE algorithm. This is because the experiments for Scenario II was made while the vehicle was moving very close to the walls of a building which might affected the readings of the magnetometer (due to interference with magnetic fields). This led to an underestimation of the magnetometer covariance in this case. Notice that the same constant value for magnetometer covariance was used in all experiments of all scenarios. Again, we stress the fact that even if a set of TV values gave accurate results for a given set of experiments, it might not be the correct value through long operations.
As for Scenario III, Figure 5 shows the path and error plot for one of the experiments using EH for localization. As shown in the figure, all constant covariance led to the divergence of the localization output. However, in case of DCE, the output did not diverge and shows more accurate results than that of the constant covariances.
In this experiment, the GPS error was suffering from increasing error similar to drift error. However, this drift error was small compared to that of the odometries. Consequently, the error in the localization also suffered from a slight drift. Still, even with this slight drift, the output was significantly better than constant covariances as can be seen in the figure. Notice that the fact that the GPS is suffering from increasing error is not due to the theory of action of the GPS but only a random event that might be due to a certain noise in the path chosen for the vehicle.
Table 7, Table 8 and Table 9 shows the quantitative results for Scenario III which shows superior performance of the DCE algorithm compared to constant covariances. Although the orientation accuracy of some constant covariances were more accurate than the DCE, the value of such covariance differed from one experiment to another and from one filter to another as you might notice in the tables which again leads to the same conclusion that using constant covariance for drift suffering odometries is incomprehensible.

6.2. Oxford RobotCar Dataset

Table 10, Table 11 and Table 12 shows the quantitative results for the sessions of Oxford Dataset. As shown in the tables, the covariance estimation algorithm outperformed the constant covariances while using the three fusion filters which shows the efficacy of the algorithm even over longer distances than those tested using the iCab platform and even without any corrective feedback for the odometry being used.
It can be seen that due to the absence of corrective feedback, the average and maximum errors are relatively large. This would not be the case if corrective feedback was incorporated in the results. However, no corrective feedback was made to show the effect of the DCE algorithm over the localization without the effect of the corrections. If corrections were made throughout the runs, the results would have been much better. Despite the fact that the visual odometry will suffer from large error throughout the dataset runs in the absence of the correction due to the accumulation of error with time, the DCE algorithm managed to provide the most accurate results over the dataset runs as shown in the tables.
It is also important to mention specific cases which shows the inconsistency of using constant covariances for odometry fusion. Through using the constant covariance, a given percentage could provide good fusion results (compared to other percentages) for a given experiment but then does not work for another. This can first be seen between the results of different TVs in the results tables. For example, in the Oxford dataset tables, the best UKF results after those of the DCE-UKF is provided by the 2.5 % TV constant covariance; however, it is not the case for EKF fusion.
Furthermore, Table 13 shows the best average results through using constant covariance for each of the sessions used from Oxford dataset. The inconsistency of using constant covariance can be obviously seen from the results as in each day, one constant covariance value is better than the others. However, in 3 of the 4 days the DCE algorithm showed superior results compared to all constant covariance values and on average over the whole dataset test, the DCE algorithm was superior using the three fusion filters as shown in Table 10, Table 11 and Table 12.
The reason that in day 4 the DCE was outperformed by the TV is circumstantial because the DCE provides an estimate of the covariance. This does not mean that it provides the optimal or the true value of the covariance but only a good estimate which can be used to get good localization results using odometries which as was shown throughout the paper cannot have a constant covariance and the true value of the covariance cannot be determined at any time or for any kind of operations except retroactively as was done in the results with using a reference. Table 13 is also evidence that the usage of constant covariances is infeasible and will deteriorate the localization results due to the fact that odometries have variable covariance throughout operation.

6.3. EU Long-Term Dataset

Table 14 shows the results of the DCE-UKF algorithm compared with different constant covariance similar to the results shown in the previous two subsections. As shown in the table, the results of the DCE-UKF outperform those of the UKF with constant covariances. Those results for the LiDAR odometry (LOAM) conform with the findings of the previous two subsections which shows the results of the DCE algorithm for visual odometry (Oxford Dataset), and visual and encoder odometries (iCab experiments). Although the results of the DCE-UKF compared to constant covariance shows the efficacy of the DCE algorithm, the aim of this subsection and the validation with EU Long-term Dataset is to show the effect of the DCE algorithm when integrated with the LOAM and show the fact that DCE can be integrated with any odometry algorithm in order to estimate its drift covariance and consequently achieve more accurate pose estimation through multisensor fusion.
The data in the EU long-term dataset was recorded while the vehicle was driven with a relatively high speed, consequently, the LOAM algorithm suffered from a substantial amount of drift error. Using the DCE algorithm, we were able to achieve a much better pose estimation. In addition to being better than the LOAM algorithm, we also show here that the DCE results through using the GPS (with added artificial white noise N ( 0,25 ) ) is better than the pose estimate of the noisy GPS. Figure 6 shows the fusion results of the LOAM with DCE compared to the results of the LOAM alone which suffered from substantial amount of drift as can be shown in the figure. In addition to the LOAM data, the figure also shows the noisy data of the GPS. It can also be seen that the DCE-UKF output is smoother and more accurate than that of the GPS results.
Table 15 shows the T E m e a n and T E m a x of the DCE-UKF, LOAM, GPS and filtered GPS over 3 driving sessions of the EU long-term dataset (15,000 km). The use of the DCE-UKF along with the LOAM data achieved much better results than just using the LOAM. This shows the importance of using a fusion algorithm with accurate covariance estimation to achieve more accurate pose estimation than that of an odometry regardless of the amount of drift the odometry might suffer from.
Due to the high amount of drift error in the LOAM results, as shown in Figure 6, one might think that the results of only using a UKF to filter the readings from the GPS might lead to a better results than fusing the GPS with a LiDAR odometry and using the DCE algorithm. For this, we also show the results of filtered GPS readings using a UKF without fusing the results of the LOAM at all. As it can be seen in Table 15, the result of fusing DCE-LOAM with the noisy GPS readings led to better results than ignoring the data from the LOAM completely.
The results achieved from the EU long-term dataset conforms with those of the iCab experiments and the Oxford dataset and show the effect of the DCE algorithm when integrated with a drift suffering odometry. It also confirms the fact that the DCE algorithm can be an integral part of an odometry which can lead to a better pose estimation. The results also show the effect of the DCE algorithm over an even longer driving duration and in different weather conditions.
Finally, all the experiments were executed using an Intel Core i7 CPU at 2.10 GHz processor. The average computation time of the algorithm was 13.3 ms. This small computation time shows the efficiency of using the DCE algorithm on an autonomous vehicle since the performance of the localization or the SLAM modules will not be significantly affected. Furthermore, the maximum and minimum computation time were 23.3 ms and 8.1 ms respectively along with standard deviation of 3.5 ms which shows that the performance of the DCE algorithm is consistent and does not significantly fluctuate through operation.

7. Conclusions and Future Work

This paper presented a novel approach for estimating the covariance of odometries which suffers from an accumulation of error (drift) due to the reliance on integration to measure the pose of the vehicle. The algorithm uses the covariance of another sensor which does not suffer from drift (drift-less sensor). The drift covariance estimation algorithm overcomes the challenges of quantifying the constant covariances through the presence of the ground truth or through hard-tuning and also taking into consideration the fact that the covariance of such odometries is dynamic and changes with time during the operation of the sensor used in the odometry depending on different factors.
The drift covariance estimation algorithm was tested using several real-world experiments by using an experimental automated platform as well as Oxford RobotCar Dataset and the EU Long-term Dataset. The testing was done by using three different localization algorithms namely the extended and unscented Kalman filter as well as the extended H filter. The localization output through using the drift covariance estimation was then compared to the localization output with different constant covariance values. The results showed that the drift covariance estimation algorithm outperformed the constant covariances in almost all the experiments which confirms that the use of constant covariances for drift suffering sensor is neither optimal nor practical. It also shows the efficacy of the drift covariance estimation algorithm from the localization accuracy point of view.
Furthermore, the results of the EU Long-term Dataset were compared with the results of an open source implementation of the well know LOAM algorithm. The results of the comparison showed that integrating the DCE algorithm with the LOAM led to the enhancement of the pose estimation even over longer driving distances and in different weather conditions.
As for the future work, we plan to further investigate possible solutions to generalize the proposed algorithm to work on arbitrary sensors (drift suffering or drift-less).

Author Contributions

M.O. derived the drift error model of odometries; M.O., A.H. and A.A.-K. designed the proposed algorithm; M.O., A.H. and A.A.-K. designed and performed the experiments for the validation; M.O. analyzed the data and calculated its statistics; M.O. and A. Hussein wrote the first draft of the paper and modified the paper based on reviewers comments; A.A.-K., F.G. and D.C. offered supervision throughout the whole work.

Funding

This research was supported by the Spanish Government through the CICYT projects (TRA2015-63708-R and TRA2016-78886-C3-1-R).

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Urmson, C.; Anhalt, J.; Bagnell, D.; Baker, C.; Bittner, R.; Clark, M.; Dolan, J.; Duggins, D.; Galatali, T.; Geyer, C.; et al. Autonomous driving in urban environments: Boss and the urban challenge. J. Field Robot. 2008, 25, 425–466. [Google Scholar] [CrossRef]
  2. Kelly, J.; Sukhatme, G.S. Visual-inertial sensor fusion: Localization, mapping and sensor-to-sensor self-calibration. Int. J. Robot. Res. 2011, 30, 56–79. [Google Scholar] [CrossRef]
  3. Luo, R.C.; Chang, C.C. Multisensor Fusion and Integration: A Review on Approaches and Its Applications in Mechatronics. IEEE Trans. Ind. Inform. 2012, 8, 49–60. [Google Scholar] [CrossRef]
  4. Duan, P.; Tian, G.; Wu, H. A multi-sensor-based mobile robot localization framework. In Proceedings of the 2014 IEEE International Conference on Robotics and Biomimetics (ROBIO 2014), Bali, Indonesia, 5–10 December 2014; pp. 642–647. [Google Scholar]
  5. Magrin, C.E.S.; Todt, E. Hierarchical Sensor Fusion Method Based on Fingerprint kNN and Fuzzy Features Weighting for Indoor Localization of a Mobile Robot Platform. In Proceedings of the 2016 XIII Latin American Robotics Symposium and IV Brazilian Robotics Symposium (LARS/SBR), Recife, Brazil, 8–12 October 2016; pp. 305–310. [Google Scholar]
  6. Lu, W.; Zhang, J.; Zhao, X.; Wang, J.; Dang, J. Multimodal sensory fusion for soccer robot self-localization based on long short-term memory recurrent neural network. J. Ambient Intell. Hum. Comput. 2017, 8, 885–893. [Google Scholar] [CrossRef]
  7. Thrun, S.; Burgard, W.; Fox, D. Probabilistic Robotics; MIT Press: Cambridge, MA, USA, 2005. [Google Scholar]
  8. Ward, E.; Folkesson, J. Vehicle localization with low cost radar sensors. In Proceedings of the 2016 IEEE Intelligent Vehicles Symposium (IV), Gothenburg, Sweden, 19–22 June 2016; pp. 864–870. [Google Scholar]
  9. Meng, X.; Wang, H.; Liu, B. A robust vehicle localization approach based on gnss/imu/dmi/lidar sensor fusion for autonomous vehicles. Sensors 2017, 17, 2140. [Google Scholar] [CrossRef]
  10. Liu, J.; Chen, H.Z.; Cai, B.G.; Wang, J. State estimation of connected vehicles using a nonlinear ensemble filter. J. Cent. South Univ. 2015, 22, 2406–2415. [Google Scholar] [CrossRef]
  11. He, B.; Liu, Y.; Dong, D.; Shen, Y.; Yan, T.; Nian, R. Simultaneous Localization and Mapping with Iterative Sparse Extended Information Filter for Autonomous Vehicles. Sensors 2015, 15, 19852–19879. [Google Scholar] [CrossRef]
  12. Kim, H.; Liu, B.; Goh, C.Y.; Lee, S.; Myung, H. Robust vehicle localization using entropy-weighted particle filter-based data fusion of vertical and road intensity information for a large scale urban area. IEEE Robot. Autom. Lett. 2017, 2, 1518–1524. [Google Scholar] [CrossRef]
  13. Cadena, C.; Carlone, L.; Carrillo, H.; Latif, Y.; Scaramuzza, D.; Neira, J.; Reid, I.; Leonard, J.J. Past, present, and future of simultaneous localization and mapping: Toward the robust-perception age. IEEE Trans. Robot. 2016, 32, 1309–1332. [Google Scholar] [CrossRef]
  14. Sakaeta, K.; Nonaka, K.; Sekiguchi, K. MHE based vehicle localization integrating scan-matching and odometry in unknown structured environment. In Proceedings of the 2016 55th Annual Conference of the Society of Instrument and Control Engineers of Japan (SICE), Tsukuba, Japan, 20–23 September 2016; pp. 306–311. [Google Scholar]
  15. Mur-Artal, R.; Montiel, J.M.M.; Tardos, J.D. ORB-SLAM: A versatile and accurate monocular SLAM system. IEEE Trans. Robot. 2015, 31, 1147–1163. [Google Scholar] [CrossRef]
  16. Engel, J.; Stückler, J.; Cremers, D. Large-scale direct SLAM with stereo cameras. In Proceedings of the 2015 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Hamburg, Germany, 28 September–2 October 2015; pp. 1935–1942. [Google Scholar]
  17. Siegwart, R.; Nourbakhsh, I.R.; Scaramuzza, D. Introduction to Autonomous Mobile Robots; MIT Press: Cambridge, MA, USA, 2011. [Google Scholar]
  18. Rudolph, A. Quantification and estimation of differential odometry errors in mobile robotics with redundant sensor information. Int. J. Robot. Res. 2003, 22, 117–128. [Google Scholar] [CrossRef]
  19. Osman, M.; Hussein, A.; Al-Kaff, A.; García, F.; Armingol, J.M. Online Adaptive Covariance Estimation Approach for Multiple Odometry Sensors Fusion. In Proceedings of the 2018 IEEE Intelligent Vehicles Symposium (IV), Changshu, China, 26–30 June 2018; pp. 355–360. [Google Scholar]
  20. Maddern, W.; Pascoe, G.; Linegar, C.; Newman, P. 1 Year, 1000km: The Oxford RobotCar Dataset. Int. J. Robot. Res. (IJRR) 2017, 36, 3–15. [Google Scholar] [CrossRef]
  21. Yan, Z.; Sun, L.; Krajnik, T.; Ruichek, Y. EU Long-term Dataset with Multiple Sensors for Autonomous Driving. arXiv 2019, arXiv:1909.03330. [Google Scholar]
  22. Zhang, J.; Singh, S. LOAM: Lidar Odometry and Mapping in Real-time. Available online: https://www.ri.cmu.edu/pub_files/2014/7/Ji_LidarMapping_RSS2014_v8.pdf (accessed on 5 October 2019).
  23. Kalman, R.E. A new approach to linear filtering and prediction problems. J. Basic Eng. 1960, 82, 35–45. [Google Scholar] [CrossRef]
  24. Kalman, R.E.; Bucy, R.S. New results in linear filtering and prediction theory. J. Basic Eng. 1961, 83, 95–108. [Google Scholar] [CrossRef]
  25. Mehra, R. On the identification of variances and adaptive Kalman filtering. IEEE Trans. Autom. Control 1970, 15, 175–184. [Google Scholar] [CrossRef]
  26. Diniz, P.S. Adaptive Filtering; Springer: Berlin, Germany, 1997. [Google Scholar]
  27. Mehra, R. Approaches to adaptive filtering. IEEE Trans. Autom. Control 1972, 17, 693–698. [Google Scholar] [CrossRef]
  28. Yazdkhasti, S.; Sasiadek, J.Z. Multi Sensor Fusion Based on Adaptive Kalman Filtering. In Advances in Aerospace Guidance, Navigation and Control; Springer: Berlin, Germany, 2018; pp. 317–333. [Google Scholar]
  29. Akhlaghi, S.; Zhou, N.; Huang, Z. Adaptive Adjustment of Noise Covariance in Kalman Filter for Dynamic State Estimation. arXiv 2017, arXiv:1702.00884. [Google Scholar]
  30. Wang, H.; Deng, Z.; Feng, B.; Ma, H.; Xia, Y. An adaptive Kalman filter estimating process noise covariance. Neurocomputing 2017, 223, 12–17. [Google Scholar] [CrossRef]
  31. Feng, B.; Fu, M.; Ma, H.; Xia, Y.; Wang, B. Kalman filter with recursive covariance estimation‚Äîsequentially estimating process noise covariance. IEEE Trans. Ind. Electron. 2014, 61, 6253–6263. [Google Scholar] [CrossRef]
  32. Wang, Y.; Yang, A.; Li, Z.; Wang, P.; Yang, H. Blind drift calibration of sensor networks using signal space projection and Kalman filter. In Proceedings of the 2015 IEEE Tenth International Conference on Intelligent Sensors, Sensor Networks and Information Processing (ISSNIP), Singapore, 7–9 April 2015; pp. 1–6. [Google Scholar]
  33. Wang, Y.; Yang, A.; Chen, X.; Wang, P.; Wang, Y.; Yang, H. A deep learning approach for blind drift calibration of sensor networks. IEEE Sens. J. 2017, 17, 4158–4171. [Google Scholar] [CrossRef]
  34. Rathore, P.; Kumar, D.; Rajasegarar, S.; Palaniswami, M. Bayesian maximum entropy and interacting multiple model based automatic sensor drift detection and correction in an IoT environment. In Proceedings of the 2018 IEEE 4th World Forum on Internet of Things (WF-IoT), Singapore, 5–8 February 2018; pp. 598–603. [Google Scholar]
  35. Rathore, P.; Kumar, D.; Rajasegarar, S.; Palaniswami, M. Maximum entropy-based auto drift correction using high-and low-precision sensors. ACM Trans. Sens. Netw. (TOSN) 2017, 13, 24. [Google Scholar] [CrossRef]
  36. Tian, Y.P.; Yang, X.J.; Guo, Y.Z.; Liu, F. Filtering and Analysis on the Random Drift of FOG. In AOPC 2015: Optical Fiber Sensors and Applications; International Society for Optics and Photonics: Bellingham, WA, USA, 2015; Volume 9679, p. 96790J. [Google Scholar]
  37. Sun, J.; Xu, X.; Liu, Y.; Zhang, T.; Li, Y. FOG random drift signal denoising based on the improved AR model and modified Sage-Husa adaptive Kalman filter. Sensors 2016, 16, 1073. [Google Scholar] [CrossRef]
  38. Bychkovskiy, V.; Megerian, S.; Estrin, D.; Potkonjak, M. A collaborative approach to in-place sensor calibration. In Information Processing in Sensor Networks; Springer: Berlin, Germany, 2003; pp. 301–316. [Google Scholar]
  39. Lee, K.; Chung, W.; Yoo, K. Kinematic parameter calibration of a car-like mobile robot to improve odometry accuracy. Mechatronics 2010, 20, 582–595. [Google Scholar] [CrossRef]
  40. Borenstein, J.; Feng, L. Measurement and correction of systematic odometry errors in mobile robots. IEEE Trans. Robot. Autom. 1996, 12, 869–880. [Google Scholar] [CrossRef]
  41. Desai, A.; Lee, D.J. Visual odometry drift reduction using SYBA descriptor and feature transformation. IEEE Trans. Intell. Transp. Syst. 2016, 17, 1839–1851. [Google Scholar] [CrossRef]
  42. Peretroukhin, V.; Clement, L.; Kelly, J. Reducing drift in visual odometry by inferring sun direction using a bayesian convolutional neural network. In Proceedings of the 2017 IEEE International Conference on Robotics and Automation (ICRA), Singapore, 29 May–3 June 2017; pp. 2035–2042. [Google Scholar]
  43. Lee, Y.H.; Zhu, C.; Giorgi, G.; Günther, C. Fusion of Monocular Vision and Radio-based Ranging for Global Scale Estimation and Drift Mitigation. arXiv 2018, arXiv:1810.01346. [Google Scholar]
  44. Tang, T.; Yoon, D.; Pomerleau, F.; Barfoot, T.D. Learning a bias correction for Lidar-only motion estimation. In Proceedings of the 2018 15th Conference on Computer and Robot Vision (CRV), Toronto, ON, Canada, 8–10 May 2018; pp. 166–173. [Google Scholar]
  45. Grisetti, G.; Kummerle, R.; Stachniss, C.; Burgard, W. A tutorial on graph-based SLAM. IEEE Intell. Transp. Syst. Mag. 2010, 2, 31–43. [Google Scholar] [CrossRef]
  46. Campa, R.; De La Torre, H. Pose control of robot manipulators using different orientation representations: A comparative review. In Proceedings of the 2009 American Control Conference, St. Louis, MO, USA, 10–12 June 2009; pp. 2855–2860. [Google Scholar]
  47. Osman, M. DCE: Online Drift Covariance Estimation. Available online: https://github.com/lsi-uc3m/covariance_estimation (accessed on 5 October 2019).
  48. Julier, S.J.; Uhlmann, J.K. New extension of the Kalman filter to nonlinear systems. In Signal Processing, Sensor Fusion, and Target Recognition VI; International Society for Optics and Photonics: Bellingham, WA, USA, 1997; Volume 3068, pp. 182–194. [Google Scholar]
  49. Wan, E.A.; Van Der Merwe, R. The unscented Kalman filter for nonlinear estimation. In Proceedings of the IEEE Adaptive Systems for Signal Processing, Communications, and Control Symposium, Lake Louise, AB, Canada, 4 October 2000; pp. 153–158. [Google Scholar]
  50. Krishnamoorthy, A.; Menon, D. Matrix inversion using Cholesky decomposition. In Proceedings of the 2013 Signal Processing: Algorithms, Architectures, Arrangements, and Applications (SPA), Poznan, Poland, 26–28 September 2013; pp. 70–72. [Google Scholar]
  51. Marin-Plaza, P.; Beltran, J.; Hussein, A.; Musleh, B.; Martin, D.; de la Escalera, A.; Armingol, J.M. Stereo vision-based local occupancy grid map for autonomous navigation in ROS. In Proceedings of the 11th International Joint Conference on Computer Vision, Imaging and Computer Graphics Theory and Applications VISIGRAPP, Rome, Italy, 27–29 February 2016; Volume 3, pp. 703–708. [Google Scholar]
  52. Hussein, A.; Marin-Plaza, P.; Martin, D.; de la Escalera, A.; Armingol, J.M. Autonomous Off-Road Navigation using Stereo-Vision and Laser-Rangefinder Fusion for Outdoor Obstacles Detection. In Proceedings of the IEEE Intelligent Vehicles Symposium (IV), Gothenburg, Sweden, 19–22 June 2016; pp. 104–109. [Google Scholar]
  53. Geiger, A.; Lenz, P.; Urtasun, R. Are we ready for Autonomous Driving? The KITTI Vision Benchmark Suite. In Proceedings of the Conference on Computer Vision and Pattern Recognition (CVPR), Providence, RI, USA, 16–21 June 2012. [Google Scholar]
  54. Moore, T.; Stouch, D. A Generalized Extended Kalman Filter Implementation for the Robot Operating System. In Proceedings of the 13th International Conference on Intelligent Autonomous Systems (IAS-13), Padova, Italy, 15–18 July 2014; Springer: Berlin, Germany, 2014. [Google Scholar]
  55. Julier, S.; Uhlmann, J.K. Unscented filtering and nonlinear estimation. Proc. IEEE 2004, 92, 401–422. [Google Scholar] [CrossRef] [Green Version]
  56. Osman, M.; Alonso, R.; Hammam, A.; Moreno, F.M.; Al-Kaff, A.; Hussein, A. Multisensor Fusion Localization using Extended H-infinity Filter using Pre-filtered Sensors Measurements. In Proceedings of the 2019 IEEE Intelligent Vehicles Symposium (IV), Paris, France, 9–12 June 2019; pp. 1139–1144. [Google Scholar]
  57. Simon, D. Optimal State Estimation: Kalman, H Infinity, and Nonlinear Approaches; Wiley: Hoboken, NJ, USA, 2006. [Google Scholar]
  58. Musleh, B.; Martin, D.; de la Escalera, A.; Armingol, J.M. Visual ego motion estimation in urban environments based on uv disparity. In Proceedings of the IEEE Intelligent Vehicles Symposium (IV2012), Alcala de Henares, Spain, 3–7 June 2012; pp. 444–449. [Google Scholar]
Figure 1. The covariance estimation algorithm operation structure with the corrective feedback localization from the localization algorithm to the odometry.
Figure 1. The covariance estimation algorithm operation structure with the corrective feedback localization from the localization algorithm to the odometry.
Sensors 19 05178 g001
Figure 2. Visual demonstration of the three scenarios, where the green point is the start point and the blue curve is the path drawn using the LiDAR odometry. The Figure is reproduced from [19] (© 2018 IEEE).
Figure 2. Visual demonstration of the three scenarios, where the green point is the start point and the blue curve is the path drawn using the LiDAR odometry. The Figure is reproduced from [19] (© 2018 IEEE).
Sensors 19 05178 g002
Figure 3. Visual demonstration of one of Scenario I experiments using EKF for localization.
Figure 3. Visual demonstration of one of Scenario I experiments using EKF for localization.
Sensors 19 05178 g003
Figure 4. Visual demonstration of one of Scenario II experiments using UKF for localization.
Figure 4. Visual demonstration of one of Scenario II experiments using UKF for localization.
Sensors 19 05178 g004
Figure 5. Visual demonstration of one of Scenario II experiments using UKF for localization.
Figure 5. Visual demonstration of one of Scenario II experiments using UKF for localization.
Sensors 19 05178 g005
Figure 6. The EU dataset results of the DCE-UKF, LOAM, and GPS.
Figure 6. The EU dataset results of the DCE-UKF, LOAM, and GPS.
Sensors 19 05178 g006
Table 1. Mean of Scenario I UKF results.
Table 1. Mean of Scenario I UKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-UKF1.393.000.002810.1187
True Variance6.75613.8530.2490.612
2.5% TV1.7963.5980.0770.227
5% TV2.6195.7050.0990.302
25% TV4.0617.7460.1640.349
125% TV7.61314.7720.2630.667
Table 2. Mean of Scenario I EKF results.
Table 2. Mean of Scenario I EKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EKF1.5913.2670.0260.09
True Variance3.0407.1010.0580.249
2.5% TV1.6553.3170.0320.099
5% TV1.7173.4650.0330.109
25% TV1.9543.9380.0310.105
125% TV3.81110.9730.1100.374
Table 3. Mean of Scenario I EH results.
Table 3. Mean of Scenario I EH results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EH 2.2894.1160.0310.091
True Variance20.85056.4600.4741.580
2.5% TV2.4344.4160.0400.137
5% TV2.5104.5750.0370.135
25% TV7.18315.3460.1380.372
125% TV19.24745.6200.3511.189
Table 4. Mean of Scenario II UKF results.
Table 4. Mean of Scenario II UKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-UKF2.003.390.0190.0720
True Variance13.03444.6620.0190.109
2.5% TV4.9428.2590.0190.111
5% TV6.49811.4510.0190.103
25% TV9.63321.4330.0200.111
125% TV13.59360.0600.0190.110
Table 5. Mean of Scenario II EKF results.
Table 5. Mean of Scenario II EKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EKF2.5394.4740.0190.097
True Variance10.28328.1310.0200.079
2.5% TV3.8526.6630.0240.089
5% TV4.3107.7350.0200.074
25% TV8.05723.8220.0200.077
125% TV9.81324.69100.0210.075
Table 6. Mean of Scenario II EH results.
Table 6. Mean of Scenario II EH results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EH 3.5855.9640.0230.126
True Variance47.930122.4890.2681.096
2.5% TV15.92832.8950.2500.871
5% TV35.60067.5630.5051.167
25% TV45.915101.0550.3291.083
125% TV47.359134.8810.2621.123
Table 7. Mean of Scenario III UKF results.
Table 7. Mean of Scenario III UKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-UKF2.114.230.02510.0763
True Variance15.84156.2300.0220.167
2.5% TV4.3758.9710.0230.090
5% TV4.61310.3720.0240.120
25% TV7.62721.7150.0250.147
125% TV13.50846.6740.0240.155
Table 8. Mean of Scenario III EKF results.
Table 8. Mean of Scenario III EKF results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EKF2.2255.8040.0440.153
True Variance3.1167.8260.0250.142
2.5% TV3.2158.6140.0280.168
5% TV3.3898.0090.0300.154
25% TV3.0637.7400.0270.122
125% TV3.0288.1940.0240.149
Table 9. Mean of Scenario III EH results.
Table 9. Mean of Scenario III EH results.
MetricsMean [%]Mean [ /m]
TE mean TE max OE mean OE max
DCE-EH 4.6249.3930.0370.153
True Variance27.54681.9600.3751.739
2.5% TV20.75661.0270.3181.230
5% TV26.51880.3970.3441.343
25% TV27.82985.3200.3991.790
125% TV25.99079.9230.2911.467
Table 10. Mean of Oxford Dataset UKF results.
Table 10. Mean of Oxford Dataset UKF results.
MetricsMean [%]
TE mean TE max
DCE-UKF2.7449.1085
True Variance3.587114.1377
2.5% TV2.93239.194
5% TV3.354910.7285
25% TV4.389036.8538
125% TV3.563213.6774
Table 11. Mean of Oxford Dataset EKF results.
Table 11. Mean of Oxford Dataset EKF results.
MetricsMean [%]
TE mean TE max
DCE-EKF3.226510.0566
True Variance3.692514.1595
2.5% TV3.362311.7762
5% TV3.250711.2075
25% TV4.287635.1085
125% TV3.733914.3134
Table 12. Mean of Oxford Dataset EH results.
Table 12. Mean of Oxford Dataset EH results.
MetricsMean [%]
TE mean TE max
DCE-EH 8.902429.9001
True Variance23.577260.7318
2.5% TV17.612244.6157
5% TV20.149050.1683
25% TV24.269064.7884
125% TV24.531862.4231
Table 13. The best average UKF error using constant covariances for each day of the dataset and the corresponding DCE-UKF results.
Table 13. The best average UKF error using constant covariances for each day of the dataset and the corresponding DCE-UKF results.
Day NumberTE mean [%]
Best Constant CovarianceAdaptive Covariance
11.509 (2.5 % T.V.)1.366
22.886 (125 % T.V.)2.584
35.759 (5 % T.V.)5.295
42.984 ( T.V.)3.471
Table 14. Mean of EU Dataset UKF results.
Table 14. Mean of EU Dataset UKF results.
MetricsMean [%]
TE mean TE max
DCE-UKF0.0780.295
True Variance0.6792.280
2.5% TV0.0810.314
5% TV0.0880.469
25% TV0.8672.130
125% TV0.0961.364
Table 15. The EU dataset results of the DCE-UKF, LOAM, GPS and filtered GPS.
Table 15. The EU dataset results of the DCE-UKF, LOAM, GPS and filtered GPS.
MetricsMean [%]
TE mean TE max
DCE-UKF0.0780.295
LOAM6.15513.607
GPS0.1060.380
Filtered GPS0.0820.319

Share and Cite

MDPI and ACS Style

Osman, M.; Hussein, A.; Al-Kaff, A.; García, F.; Cao, D. A Novel Online Approach for Drift Covariance Estimation of Odometries Used in Intelligent Vehicle Localization. Sensors 2019, 19, 5178. https://doi.org/10.3390/s19235178

AMA Style

Osman M, Hussein A, Al-Kaff A, García F, Cao D. A Novel Online Approach for Drift Covariance Estimation of Odometries Used in Intelligent Vehicle Localization. Sensors. 2019; 19(23):5178. https://doi.org/10.3390/s19235178

Chicago/Turabian Style

Osman, Mostafa, Ahmed Hussein, Abdulla Al-Kaff, Fernando García, and Dongpu Cao. 2019. "A Novel Online Approach for Drift Covariance Estimation of Odometries Used in Intelligent Vehicle Localization" Sensors 19, no. 23: 5178. https://doi.org/10.3390/s19235178

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