Next Article in Journal
Network Resource Allocation Method Based on Awareness–Prediction Joint Compensation for Low-Earth-Orbit Satellite Networks
Previous Article in Journal
An Investigation of the Promotion of the Aerodynamic Performance of a Supersonic Compressor Cascade Using a Local Negative-Curvature Ramp
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Vehicle Pose Estimation Method Based on Maximum Correntropy Square Root Unscented Kalman Filter

School of Information Science and Engineering, Shenyang University of Technology, Shenyang 110870, China
*
Author to whom correspondence should be addressed.
Appl. Sci. 2025, 15(10), 5662; https://doi.org/10.3390/app15105662
Submission received: 31 March 2025 / Revised: 8 May 2025 / Accepted: 14 May 2025 / Published: 19 May 2025

Abstract

:
Simultaneous Localization and Mapping (SLAM) is an effective method for estimating and correcting the pose of the mobile robot. However, a large amount of external noise and observed outliers in complex unknown environments often lead to a decrease in the estimation accuracy and robustness of the SLAM algorithm. To improve the performance of the Square Root Unscented Kalman Filter SLAM (SRUKF-SLAM), this paper proposes the Maximum Correntropy Square Root Unscented Kalman Filter SLAM (MCSRUKF-SLAM) algorithm. The method first generates an estimate of the predicted state and covariance matrix through the Unscented Transform (UT), and then obtains the square root matrix of the covariance through Cholesky and QR decomposition to replace the original covariance, effectively preserving the positive definiteness of the covariance and improving the accuracy of the algorithm. Moreover, the proposed MCSRUKF-SLAM recharacterizes measurement information at the cost of the Maximum Correntropy (MC) instead of the Minimum Mean Square Error (MMSE), effectively improving the SLAM algorithm’s ability to suppress non-Gaussian noise. The simulation results show that compared with EKF-SLAM, UKF-SLAM, SRUKF-SLAM, and MCUKF-SLAM, the accuracy of the proposed MCSRUKF-SLAM in Gaussian mixture noise improves by 81.8%, 80.9%, 78.7%, and 63.6%, and the accuracy of the proposed MCSRUKF-SLAM in colored noise improves by 50.3%, 39.9%, 38.2%, and 36.3%.

1. Introduction

Since the 21st century, with the rapid development of microelectronics technology, artificial intelligence technology, new materials technology, and computer technology, simultaneous localization and mapping (SLAM) technology has shown great application potential in many real scenarios [1,2,3]. For example, in the field of automatic driving, the SLAM system constructs a high-precision environment map and locates vehicle position in real time by fusing lidar, vision, and inertial measurement unit (IMU) data, providing a key basis for path planning and obstacle avoidance decisions [4,5]. Similarly, for warehousing and the logistics robot, SLAM technology helps the robot accurately locate items in the dynamic shelf environment and improve the efficiency of sorting, handling, and inventory management [5,6]. In addition, SLAM is also widely used in UAV patrol, augmented reality (AR), and service robots [7,8,9,10]. Simultaneous Localization and Mapping (SLAM) technology [11,12] is a key technology for the mobile robot to achieve environmental perception and self-localization. SLAM technology can be described as the robot moving from the unknown position in the unknown environment, positioning itself based on pose estimation and sensor observation information during the movement process, and establishing an environmental map. Therefore, stable, reliable, and high-precision pose estimation technology is one of the key technologies for achieving autonomous robot movement and practical applications [13,14]. The pose estimation is the process of predicting the robot’s position and posture in the unknown environment based on the certain algorithm and combined with sensor observation information. According to its principles, the pose estimation technique can be divided into relative pose estimation and absolute pose estimation [15]. The relative pose estimation method requires the initial pose of the robot to be known, and then utilizes sensor information and observed relative motion states to indirectly estimate the current pose of the robot. Absolute pose estimation does not require the initial pose information of the robot, and can estimate the pose state of the mobile robot solely based on sensor information, with relatively stable estimation accuracy [16]. Therefore, this paper mainly studies the absolute pose estimation of the mobile robot based on map-matching positioning.
In practical applications, the motion model and observation model in SLAM is usually the nonlinear system, and the Extended Kalman Filter SLAM (EKF-SLAM) [13,17,18,19] is one of the commonly used nonlinear pose estimation algorithms in SLAM. EKF-SLAM applies Taylor series to linearly approximate nonlinear systems, resulting in significant linearization errors. Therefore, some scholars have proposed the Unscented Kalman Filter (UKF-SLAM) algorithm [20,21,22], which directly approximates the probability density distribution of nonlinear functions and uses the sigma point set to approximate the posterior probability density of the target state. However, the UKF-SLAM algorithm cannot guarantee the positive definiteness of the covariance matrix, which can lead to a decrease in the filtering accuracy of the UKF-SLAM algorithm. Researchers have proposed the Square Root Unscented Kalman Filter SLAM (SRUKF-SLAM) algorithm [23,24], which uses the square root matrix of covariance instead of the original covariance matrix to avoid filter divergence caused by non-positive definiteness of the covariance matrix. Furthermore, the SRUKF-SLAM algorithm has higher filtering efficiency than the UKF-SLAM algorithm, which is beneficial for real-time estimation of the robot pose.
The above-mentioned Kalman filter and its derivative algorithms are only applicable to robot systems under the assumption of Gaussian noise. In practical application scenarios, the noise in the sensor information of mobile robot SLAM has a certain correlation, and the noise model often follows the non-Gaussian distribution [25,26,27]. This non-Gaussian characteristic can cause second-order statistical divergence, resulting in a significant decrease or even divergence in the positioning accuracy of the traditional Kalman filter and its derivative algorithms based on the minimum mean square error (MMSE) criterion [28,29].
In response to the limitations of the aforementioned filtering algorithms, the Particle Filter SLAM (PF-SLAM) [30,31] algorithm has been proposed. The PF-SLAM algorithm uses random sample data to approximate the posterior probability density function, so it requires a large amount of sample data to obtain acceptable estimation accuracy. This increases the computational complexity of the PF-SLAM algorithm. Furthermore, this also increases the difficulty of the algorithm in practical applications.
In recent years, the Maximum Correntropy (MC) has been proven to solve the problem of low-pose estimation accuracy of traditional Kalman filtering and its derivative algorithms in non-Gaussian noise environments [32,33,34,35]. Qi et al. proposed vehicle state estimation algorithms based on the Maximum Correntropy Extended Kalman Filter (MC-EKF) [36] and the Maximum Correntropy Adaptive Extended Kalman Filter (MC-AEKF) [37]. The research results demonstrate that, under non-Gaussian noise environments (particularly heavy-tailed noise), MC-AEKF and MC-EKF exhibit stronger robustness and higher estimation accuracy compared to traditional AEKF/EKF. Subsequently, scholars have proposed the Maximum Correntropy Unscented Kalman Filter (MCUKF) [38] and an iterative Maximum Correntropy Unscented Kalman Filter algorithm [39]. These methods have demonstrated excellent performance in complex noise environments, though they were only validated through numerical simulations and not applied to practical problems. Wang et al. introduced an MCUKF algorithm for loosely coupled positioning in an inertial navigation system (INS) and ultra-wideband (UWB) integration [40], which significantly outperforms traditional UKF methods in terms of positioning accuracy and robustness. Zhang et al. proposed a Maximum Correntropy Adaptive Unscented Kalman Filter (MC-AUKF) algorithm [41] for estimating vehicle states and key parameters. This algorithm demonstrates superior performance under non-Gaussian noise and effectively improves estimation accuracy. However, in highly non-Gaussian noise environments or during rapid motion scenarios, the iterative process of MC-AUKF may suffer from loss of positive definiteness in the covariance matrix due to rounding errors or ill-conditioning, leading to inconsistent state estimation and numerical instability in filtering. In contrast, the Square-Root Unscented Kalman Filter (SRUKF) significantly enhances numerical stability, computational efficiency, and robustness by introducing square-root decomposition, making it more suitable for robot-pose estimation in non-Gaussian noise environments.
Based on the above research background, this paper combines the Maximum Correntropy with the square root unscented Kalman filter to propose the Maximum Correntropy Square Root Unscented Kalman Filter SLAM (MCSRUKF-SLAM) algorithm. The MCSRUKF-SLAM uses MC instead of MMSE, effectively solving the problem of low-pose estimation accuracy caused by non-Gaussian noise in the system. Furthermore, the MCSRUKF-SLAM algorithm adds the square root filter on the basis of the Unscented Kalman Filter. It ensures the positive definiteness of the covariance matrix and improves the stability of the filtering values by performing Cholesky decomposition on the covariance matrix.
The rest of this paper is organized as follows: In Section 2, the SLAM problem is proposed, and then the SRUKF-SLAM algorithm is described. In Section 3, the MCSRUKF-SLAM for robot tracking is proposed. In Section 4, the robot system model is introduced, and then the simulation environment and parameters are given. In Section 5, the superiority of the proposed algorithm is verified by simulation and experiment. Finally, some conclusions are drawn in Section 6.

2. Problem Description and Existing Methods

2.1. SLAM Problem Description

The motion model and observation model of the mobile robot are the foundation for implementing SLAM. For SLAM, the motion model and observation model of the mobile robot can be described using the discrete nonlinear function. The motion model and observation model are expressed as
x k = f x k 1 , u k + w k ,
z k = h x k , m k + v k ,
where x k denotes the state vector of the robot pose at time k; it consists of the robot’s position information xk, yk, and heading angle ϕk, i.e., xk = [xk yk ϕk]T. u k is the control vector of the robot at time k, f   ( · ) is the nonlinear state transition function of robot motion, and w k is the process noise. z k denotes the observation vector of the robot at time k, h   ( · ) is the nonlinear observation function of the robot, v k is the measurement noise, and m k denotes the environmental map at time k, which is composed of the spatial positions of n feature landmarks. It can be expressed as m k = m 1 ,   m 2 , ,   m n .
The SLAM problem essentially utilizes the observation information Z 1 :   k and control variable U 1 :   k before time k to calculate the joint posterior probability density function p   ( x k , m k   | Z 1 :   k , U 1 :   k ) of the robot state vector x k and the environmental map m k at the current time k. It is assumed that the motion model of the mobile robot is the Markov process, that is, the robot’s state is only related to the state of the previous moment. Therefore, according to Bayesian formula [42], p   ( x k , m k   | Z 1 :   k , U 1 :   k ) can be expressed as
p x k , m k | Z 1 : k , U 1 : k p z k | x k , m k p x k | x k 1 , u k p x k 1 , m k 1 | Z 1 : k 1 , U 1 : k 1 d x k 1 ,
where Z 1 :   k = { z 1 ,   z 2 , ,   z k } denotes all observations from time 1 to k, and U 1 :   k = { u 1 ,   u 2 , ,   u k } denotes all control variables from time 1 to k. p   ( x k   | x k 1 , u k ) is the probability model of the robot motion. p   ( z k   | x k , m k ) is the probability model for the robot observation. p   ( x k ,   m k   | Z 1 :   k , U 1 :   k ) , and p   ( x k , m k   | Z 1 :   k 1 , U 1 :   k 1 ) are posterior probability density functions at time k and time k−1, respectively.

2.2. Square Root Unscented Kalman Filter SLAM

In general, it is difficult to directly integrate the probability expression in Equation (3). In SLAM, Bayesian filtering methods in probability statistics are usually used for the approximate calculation [13]. Furthermore, since the motion model and observation model of the mobile robot are the nonlinear system, nonlinear Bayesian filtering methods are usually used. Among them, the Square Root Unscented Kalman Filter SLAM (SRUKF-SLAM) algorithm [23] is a classic algorithm for solving the SLAM problem of the mobile robot. The algorithm uses Unscented Transform (UT) to approximate the posterior probability density of the system state and uses the square root form to ensure the positive definiteness of the covariance matrix, reduce the calculation error of the state estimation, and improve the calculation efficiency of the algorithm, so as to improve the real-time performance of the algorithm. The algorithm employs Unscented Transform (UT) to approximate the posterior probability density of the system state. By employing Cholesky decomposition to obtain the square-root matrix of the covariance, it ensures positive definiteness of the covariance matrix, reduces computational errors in state estimation, and enhances algorithmic efficiency.
The SRUKF-SLAM algorithm employs the Unscented Transform (UT) technique. The UT operates by strategically selecting sigma points that encapsulate the complete statistical properties (mean and covariance) of the state vector distribution. These sigma points are then propagated through the nonlinear system function, generating a transformed set of sigma points. The posterior statistics are subsequently computed through weighted averaging of these propagated sigma points. Furthermore, the algorithm utilizes the square-root matrix S of the covariance instead of the original covariance matrix P to guarantee the positive definiteness of the covariance matrix. The selection of sigma points in the SRUKF-SLAM algorithm can be determined by
ξ i = x ^ ,   i = 0 x ^ + n + λ S i , i = 1 , 2 , , n x ^ n + λ S i n , i = n + 1 , , 2 n ,
where x ^ is the mean vector of the known state vector x, and S is the square root matrix of the covariance matrix P of the state vector x, which can be obtained by decomposing P through Cholesky decomposition. n is the dimension of the state vector x, and n + λ S i , is the i-th row of the square root matrix of n + λ S , which can be obtained by Cholesky decomposition.
The weight corresponding to each sigma point in Equation (4) is
ω 0 m = λ n + λ ω 0 c = λ n + λ + 1 α 2 + β ω i m = ω i c = 1 2 n + λ , i = 1 , , 2 n ,
where ω i m denote the weights of the mean vector, and ω i c denotes the weights of the covariance matrix. The superscripts m and c represent the mean and covariance, respectively. The subscripts 0 and i represent the initial value and i-th sigma point, respectively. α determines the spread of the sigma points, the range of values for α is 0 ≤ α ≤ 1. β is a parameter related to the prior knowledge of the distribution of the state vector and is usually taken as 2. λ is a composite scaling factor, given by
λ = α 2 n + φ n ,
where the value of parameter φ is usually 3n [43].
The following is the specific process of the SRUKF-SLAM algorithm.
(1) Initialize
x ^ 0 = E x 0 ,
S 0 = chol E x 0 x ^ 0 x 0 x ^ 0 T ,
where x 0 denotes initial state vector, x ^ 0 denotes the mean of the initial state vector, E [ · ] denotes the expectation operator, chol { · } denotes the Cholesky decomposition of the matrix, and S0 is the initial value of the square root matrix of covariance;
(2) Time Update
The selection of sigma points at time k−1 can be determined by
ξ i , k 1 = x ^ k 1 , i = 0 x ^ k 1 + n + λ S k 1 i , i = 1 , 2 , , n x ^ k 1 n + λ S k 1 i n , i = n + 1 , , 2 n ,
We substitute the sigma points ξ i ,   k 1 in Equation (9) into the nonlinear state function f ( · ) in Equation (1) and obtain the predicted value of the state vector at time k as
x i , k | k 1 = f ξ i , k 1 , u k ,
The mean prediction of the state vector at time k can be determined by
x ^ k | k 1 = i = 0 2 n ω i m x i , k | k 1 ,
The covariance prediction of the state vector at time k can be determined by
S k | k 1 = QR ω i c x i , k | k 1 x ^ k | k 1 Q k ,
S k | k 1 = cholupdate S k | k 1 , x 0 , k | k 1 x ^ k | k 1 , ω 0 c ,
where QR   { · } denotes the process of QR decomposition, Q k represents the covariance matrix of process noise, and the operation cholupdate {·} implements a rank-1 update to the Cholesky factorization, yielding the corresponding updated Cholesky factor without requiring complete recomputation of the decomposition;
(3) Measurement Update
The selection of sigma points in the measurement update at time k−1 can be determined by
χ i , k | k 1 = x ^ k | k 1 , i = 0 x ^ k | k 1 + n + λ S k | k 1 i , i = 1 , 2 , , n x ^ k | k 1 n + λ S k | k 1 i n , i = n + 1 , , 2 n ,
We substitute the sigma points χ i ,   k | k 1 in Equation (14) into the nonlinear observation function h   ( · ) in Equation (2), and obtain the predicted value of the measurement vector at time k as
z i , k | k 1 = h χ i , k | k 1 , m k ,
The mean prediction of the measurement vector at time k can be determined by
z ^ k | k 1 = i = 0 2 n ω i m z i , k | k 1 ,
The covariance prediction of the measurement vector at time k can be determined by
S k z z = QR ω i c z i , k | k 1 z ^ k | k 1 R k ,
S k z z = cholupdate S k z z , z 0 , k | k 1 z ^ k | k 1 , ω 0 c ,
where R k denotes the covariance matrix of the measurement noise. The cross-covariance between the state vector and the measurement vector at time k can be determined by
P k x z = i = 0 2 n ω i c χ i , k | k 1 x ^ k | k 1 z i , k | k 1 z ^ k | k 1 T ,
(4) States Enhancement
The SRUKF-SAM algorithm is based on the MMSE criterion, and its cost function can be expressed as the problem of minimizing the error between state estimation and observation data, which can be written as
J x k = 1 2 z k H k x k z ^ k | k 1 H k x ^ k | k 1 R k 1 2 ,
where x A 2 = x T Ax , Hk is the Jacobian matrix of the measurement function h (·), and Rk is the covariance matrix of the measurement noise. To minimize the cost function J(xk), we take the derivative of the state vector xk in Equation (20) and set it as equal to zero, which can be expressed as
J x k x k = 0 ,
We substitute the cost function of Equation (20) into Equation (21), and further write it as
J x k x k = H k T R k 1 z k H k x k z ^ k | k 1 H k x ^ k | k 1 = 0 ,
We move the xk item contained in Equation (22) to the left, which can be written as
x k = x ^ k | k 1 + H k R k 1 H k 1 H k T R k 1 z k z ^ k | k 1 ,
According to Equation (23), the Kalman gain Kk is
K k = H k R k 1 H k 1 H k T R k 1 ,
where
H k = P k x z S k | k 1 S k | k 1 T 1 ,
R k = S k z z S k z z T H k S k | k 1 S k | k 1 T H k T ,
According to Equations (24)–(26), the Kalman gain can also be expressed by the covariance matrix as
K k = P k x z S k z z S k z z T 1 ,
The state estimation can be determined by
x ^ k = x ^ k | k 1 + K k z k z ^ k | k 1 ,
The covariance matrix of the state estimation error can be determined by
S k = cholupdate S k | k 1 , K k S k z z , 1 ,
In summary, the SRUKF-SLAM algorithm employs the UT technique to address system nonlinearities. During both the time update and measurement update phases, it utilizes QR decomposition [44] and Cholesky decomposition to factorize matrix S into the orthogonal matrix and right matrix. By substituting this right matrix for the original covariance matrix P in iterative updates, the algorithm effectively resolves the issue of non-positive-definite covariance matrices.

3. The Proposed Algorithm

In SLAM, accumulated sensor errors, measurement noise, complex environments, and abrupt changes in robot motion states not only introduce system nonlinearities but also often result in non-Gaussian noise distributions. Conventional nonlinear optimization algorithms, including the aforementioned SRUKF-SLAM approach, universally adopt the MMSE optimization criterion. As evident from Equation (20), their cost functions incorporate only first-order (mean) and second-order (variance) statistics of the error signals, failing to exploit the higher-order statistical characteristics (e.g., skewness and kurtosis) of non-Gaussian noise. Consequently, MMSE-based estimators exhibit heightened sensitivity to outliers under non-Gaussian noise conditions, leading to significant performance degradation in state estimation. Research has demonstrated that replacing the MMSE criterion with the Maximum Correntropy (MC) Criterion [45,46] in conventional nonlinear filtering algorithms can effectively suppress non-Gaussian noise interference. In order to improve the estimation accuracy of the SRUKF-SLAM algorithm in non-Gaussian noise, this paper proposes the Maximum Correntropy Square Root Unscented Kalman Filter SLAM (MCSRUKF-SLAM) algorithm. The algorithm introduces the MC criterion instead of the MMSE criterion to effectively improve its robustness in non-Gaussian noise. Combined with the SRUKF-SLAM algorithm, it constructs a new cost function, and uses Cholesky decomposition and orthogonal triangular decomposition to better ensure the positive definiteness of the covariance matrix, so as to ensure the stability of the filtering value.

3.1. Maximum Correntropy Criterion

Rooted in information theory, Correntropy is particularly suitable for non-Gaussian noise environments encountered in communication systems, image processing, and robotic systems [47]. This measure demonstrates superior capability in handling nonlinear signals compared to conventional approaches, delivering enhanced performance. Correntropy quantifies the similarity between two random variables by incorporating the kernel function [48]. Considering two given random variables X and Y with joint density function FXY (x, y), their Correntropy is defined by
V X , Y = E κ X , Y = κ x , y d F X Y x , y ,
where E   [ · ] denotes the expectation operator, and κ   ( · ) is a real-valued continuous, symmetric, and positive definite kernel function. In practical problems, the infinite number of sample data results in an unknown joint distribution function F XY x ,   y , making it impossible to directly calculate the Correntropy. Therefore, the Correntropy can be estimated using a sample estimator with N data points, as shown in Equation (31).
V ^ X , Y = 1 N i = 1 N κ x i , y i ,
where x i ,   y i i = 1 N is the sample data. For the kernel function selection, we adopt the Gaussian kernel due to its inherent smoothness and positive definiteness properties, which can be mathematically expressed as
κ x i , y i = G σ x i y i = exp x i y i 2 2 σ 2 ,
where σ > 0 is the kernel bandwidth of the Correntropy. Substituting the Gaussian kernel function in Equation (32) into Equation (31), it can be expressed as
V ^ X , Y = 1 N i = 1 N G σ x i y i ,
By Taylor series expansion of the Gaussian kernel function in Equation (33), we can obtain
V X , Y = n = 0 1 n 2 n σ 2 n n ! E X Y 2 n ,
In Equation (34), it can be observed that the Correntropy includes all even-order moments of the error variable X     Y . From Equations (32) and (33), it can be observed that when the error (xiyi) is small, the kernel function value approaches 1, whereas for large errors, it rapidly decays to 0. This analysis demonstrates that Correntropy can capture higher-order statistical moments of the error signal, thereby accurately characterizing the higher-order properties of non-Gaussian noise distributions. Moreover, by assigning smaller weights to large errors through the kernel function, Correntropy effectively suppresses the influence of non-Gaussian noise.
The Maximum Correntropy criterion is an optimization criterion to maximize the Correntropy between the estimated value and the real value. Therefore, the MC criterion can be expressed as
J MC = max i = 1 N G σ x i y i ,
In practical applications, the MC criterion is typically reformulated as an optimization problem that minimizes negative Correntropy. The MC criterion is formulated as
J MC = min i = 1 N G σ x i y i ,
By leveraging the significant advantages of the MC criterion in suppressing non-Gaussian noise, we develop the Maximum Correntropy Square Root Unscented Kalman Filter SLAM (MCSRUKF-SLAM). The detailed derivation of the algorithm is presented in the following sections.

3.2. The Proposed MCSRUKF-SLAM Algorithm

For the convenience of analysis and research, the nonlinear system model of the proposed MCSRUKF-SLAM algorithm can be written as
x k = f k 1 x k 1 + w k 1 z k = h k x k + v k ,
where x k is the state vector that describes the robot pose, z k is the observation vector from the current position of the robot to the feature, and w k and v k denote the process noise and measurement noise of the robot, respectively. The nonlinear functions f k 1 ( x k 1 ) and h k ( x k ) are known. The traditional SLAM algorithm usually assumes the Gaussian white noise sequence with zero mean values for both process noise and measurement noise. However, the proposed MCSRUKF-SLAM algorithm assumes the measurement noise v k follows the non-Gaussian distribution. The proposed MCSRUKF-SLAM algorithm has the same (1) initialization, (2) time update, and (3) measurement update as the above SRUKF-SLAM algorithm.
In Equation (4) States Enhancement, the proposed MCSRUKF-SLAM algorithm reconstructs the cost function by employing Weighted Least Squares (WLS) [38] for Gaussian process noise while adopting the MC instead of MMSE to handle non-Gaussian measurement noise. We substitute the measurement error vector into Equation (32), and the Correntropy of the measurement error vector is expressed as
L k = G σ z k H k x k z ^ k | k 1 H k x ^ k | k 1 R k 1 2 ,
where Lk is a scalar, which is easily separated in subsequent calculations, avoiding numerical problems. By minimizing the negative Correntropy according to [45] and by incorporating the measurement error’s Correntropy from Equation (38) into the cost function, we define the new cost function as
J D = x k x ^ k | k 1 S k | k 1 1 2 2 σ 2 G σ z k H k x k z ^ k | k 1 + H k x ^ k | k 1 R k 1 2 ,
where x A 2 = x T Ax . We hope the Correntropy will be able to capture more information when non-Gaussian measurement noise appears in the system. Therefore, the Gaussian kernel is applied to every element of the estimation error matrices following the ideas of M-estimation [49], The expression of Gaussian kernel function is shown in Equation (32). The value of the kernel bandwidth of Gaussian kernel function has a significant impact on the performance of the algorithm, and the mismatched kernel bandwidth will lead to state prediction bias or covariance estimation distortion. When the bandwidth is too large, local dynamic changes will be ignored in state estimation, resulting in underfitting. When the bandwidth is too small, the state estimation will be interfered by outliers, resulting in overfitting, and the weight distribution of sigma points of the proposed algorithm will be unbalanced. In general, the empirical method is usually used to select the kernel bandwidth [38], but the fixed kernel bandwidth cannot flexibly adapt to the local characteristics of the data, which leads to the performance degradation of the algorithm in complex scenes. Adaptive kernel bandwidth solves the limitation of fixed bandwidth through data-driven flexibility [39], which is formulated as
σ = 1 / z k z ^ k | k 1 R k 1 ,
where Rk is the relative variance of measurement noise at each time instant k.
The optimal estimate of the state vector x k is represented as
x ^ k = argmax x k   J D ,
In Equation (41), we observe that when J D x k   = 0 , the optimal solution for the state, vector x k can be obtained. Therefore, by making the partial derivative of the cost function J D equal to 0, we can obtain
J D x k = S k | k 1 1 x k x ^ k | k 1 + 2 σ 2 L k H k T R k 1 2 σ 2 z k H k x k z ^ k | k 1 + H k x ^ k | k 1 = 0 ,
Moving the term contains x k to the left-hand side, we obtain
S k | k 1 1 + L k H k T R k 1 H k x k = L k H k T R k 1 z k z ^ k | k 1 + L k H k T R k 1 H k + S k | k 1 1 x ^ k | k 1 ,
Equation (43) is a fixed-point equation [41] since Lk is related to x k , which can be solved using the fixed-point method. Consequently, Equation (43) can be reformulated using the fixed-point method as
x k = g x k ,
g x k = L k H k T R k 1 z k z ^ k | k 1 S k | k 1 1 + L k H k T R k 1 H k 1 + x ^ k | k 1 ,
The solution to fixed-point Equations (44) and (45) fundamentally involves determining the fixed point that satisfies these equalities, which can be computed through iterative numerical methods. As established in Reference [50], these fixed-point equations satisfy single-step convergence conditions, meaning only one iteration is sufficient to achieve the required estimation performance. Consequently, after a single iteration of the fixed-point equations, we obtain
x k = K k z k z ^ k | k 1 + x ^ k | k 1 ,
K k = S k | k 1 1 + L k H k T R k 1 H k 1 L k H k T R k 1 ,
Equation (47) requires multiple matrix inversion operations, significantly increasing computational complexity. To address this, we introduce the matrix inversion lemma (All inversions exist) [51] as follows
A + B C 1 D 1 = A 1 A 1 B C + D A 1 B 1 D A 1 ,
According to Equation (48), We can obtain another equivalent form of Equation (47), as shown below.
K k = S k | k 1 L k H k T I + R k 1 H k S k | k 1 L k H k T 1 R k 1 = S k | k 1 L k H k T R k + H k S k | k 1 L k H k T 1 ,
In contrast to Equation (47), the formulation in Equation (49) requires only a single matrix inversion operation, thereby achieving significantly reduced computational complexity. Following the fixed-point methodology, during the iterative application of the fixed-point formula, H k x k     H k x ^ k | k 1 in Equation (38). Consequently, Equation (38) can be reformulated as
L k = G σ z k z ^ k | k 1 R k 1 ,
The corresponding estimation error covariance is calculated by
S k = I K k H k S k | k 1 I K k H k T + K k R k K k T ,
S k = cholupdate S k | k 1 , K k S k z z , 1 ,
The above is the specific derivation process of the proposed MCSRUKF-SLAM algorithm. To well understand the proposed algorithm, Algorithm 1 summarizes the pseudo-code of the MCSRUKF-SLAM algorithm, and Figure 1 shows the flowchart of the MCSRUKF-SLAM algorithm.
Algorithm 1: MCSRUKF-SLAM
  1: Initialize: x ^ 0 , S0
  2: for k = 1: n;
  3: Generate sigma points ξ i ,   k 1 using x ^ k 1 and Sk1 by (9);
  4: Obtain the mean x ^ k | k 1 and covariance of the one step predicted state Sk|k1 by (10)–(13);
  5: Calculate sigma points χ i ,   k | k 1 using x ^ k | k 1 and Sk|k1 by (14);
  6: Compute the mean z ^ k | k 1 , the covariance matrix S k zz and the cross-covariance matrix P k zz of the predicted measurement by (15)–(19);
  7: Obtain the pseudo measurement matrix Hk by (25);
  8: Obtain Rk by (26);
  9: Calculate Lk and Kk by (49) and (50);
  10: Calculate xk and Sk by (46), (51), and (52);
  11: end.

4. Material and Methods

4.1. System Model

The system model of the mobile robot generally consists of the motion model and the observation model. For SLAM, the motion model and the observation model can be described using discrete nonlinear functions. Therefore, the more complex the nonlinear function, the greater the computational complexity in solving the SLAM problem. Relatively simple motion models and observation models are generally used in SLAM. In this paper, we adopt the wheeled robot model shown in Figure 2.
The state vector x k of the wheeled robot is usually composed of the robot’s position information x k , y k , and course angle ϕ k , i.e., x k = [ x k y k   ϕ k   ] T . The observation vector z j ,   k of the wheeled robot is usually composed of the distance r j ,   k between the j-th feature m j of the map and the sensor, and the direction angle θ j ,   k between feature m j and the sensor, i.e., z j ,   k = [ r j ,   k   θ j ,   k ] T . Therefore, the motion model and observation model of the wheeled robot are expressed as
x k = x k y k ϕ k = x k 1 + Δ T V k cos ϕ k 1 + Ω k y k 1 + Δ T V k sin ϕ k 1 + Ω k ϕ k 1 + Δ T V k L sin Ω k + w k ,
z j , k = r j , k θ j , k = x j , k x k 2 + y j , k y k 2 arctan y j , k y k x j , k x k ϕ k + v k ,
where V k denotes the speed control amount of the robot, Ω k denotes the wheel steering angle control amount of the robot, Δ T denotes the sampling interval, L denotes the wheelbase of the front and rear wheels, ( x j ,   k ,   y j ,   k ) is the coordinate of the j-th feature in the world coordinate system, w k is the process noise, and v k is the observation noise.

4.2. Simulation Environment

We used the MATLAB R2018a platform to establish an experimental environment with the size of 170 m * 140 m, randomly placed 100 uniformly distributed road markers, and set the true path of the mobile robot, as shown in Figure 3.
In Figure 3, the blue (*) denote the landmarks, the red dots 1–8 denote the key points on the path, the black dashed line denotes the true path of the robot, the black circle denotes the robot, the blue dot denotes the current position of the robot, the landmarks connected to the blue dot denote the landmarks observed by the robot sensor, and the rose red circle denotes the area composed of the sensor’s observation radius. The robot started moving from red dot 1 and moved along the black dashed line until it stopped at red dot 8. In order to conform to reality, we programed it so that the robot only observed the landmarks within the 180 degrees range directly ahead during movement. The key parameters in the simulation [25,26] are shown in Table 1.

5. Results

5.1. Simulation Results and Analysis

Non-Gaussian noise is ubiquitous in practical robot systems, such as the radar with Gaussian mixture measurement noise and the visual sensor with colored measurement noise. Therefore, we set up simulation experiments to prove the effectiveness of the proposed MCSRUKF-SLAM algorithm in Gaussian noise, Gaussian mixture noise, and colored noise environments. Furthermore, we analyzed the experimental results from the accuracy and running time of different algorithms.

5.1.1. The Accuracy Comparison of Different Algorithms

In order to study the accuracy performance of the algorithm, the Root Mean Square Error (RMSE) and state estimation error were used to evaluate the SLAM algorithm in the experiment. x ^ k ( s ) denotes the estimation pose of the robot at time k in the s-th simulation, and x k ( s ) denotes the true pose of the robot at time k in the s-th simulation. x ^ k ( s ) and x k ( s ) are composed of the robot’s position information and heading angle, which can be written as
x ^ k s = x ^ k s , y ^ k s , ϕ ^ k s T ,
x k s = x k s , y k s , ϕ k s T ,
Therefore, the RMSE and Average RMSE (ARMSE) can be expressed as
RMSE k = 1 m s = 1 m x ^ k s , y ^ k s x k s , y k s 2 2 ,
ARMSE = 1 n k = 1 n RMSE k ,
where m denotes the number of Monte Carlo runs, m = 50, n denotes the total time step, and n = 1133.
Similarly, the state estimation error and average state estimation error can be expressed as
error x , k = 1 m s = 1 m x ^ k s x k s 2 ,
Aerror x = 1 n k = 1 n error x , k ,
error y , k = 1 m s = 1 m y ^ k s y k s 2 ,
Aerror y = 1 n k = 1 n error y , k ,
error ϕ , k = 1 m s = 1 m ϕ ^ k s ϕ k s 2 ,
Aerror ϕ = 1 n k = 1 n error ϕ , k ,
  • Gaussian noise
In this simulation, we set both state noise and measurement noise as Gaussian noise. The distribution function of Gaussian noise is expressed as
f g = N μ , σ 2 ,
where μ = 0 , σ 2 = 4 , N   ( μ ,   σ 2 ) denotes normal distribution with mean μ and variance σ 2 .
The simulation results are given in Figure 4, Figure 5 and Figure 6. Figure 4 shows the comparison of simulation results of five algorithms in Gaussian noise. Figure 5 shows the RMSE comparison of five algorithms in Gaussian noise. Figure 6 shows the state estimation errors comparison of five algorithms in Gaussian noise. As we can see, EKF-SLAM, UKF-SLAM, SRUKF-SLAM, MCUKF-SLAM, and the proposed MCSRUKF-SLAM algorithm can obtain similar estimation performance. Therefore, the simulation results demonstrate that the proposed MCSRUKF-SLAM algorithm performs effectively in a Gaussian noise environment.
  • Gaussian mixture noise;
In this simulation, we set the state noise as Gaussian noise, as shown in Equation (65). The measurement noise was set as Gaussian mixture noise [50], and its distribution function was defined as
f m = λ N μ , σ 1 2 + 1 λ N μ , 2 σ 1 2 ,
where σ 1 2 is determined by σ V 2 and σ γ 2 . When adding noise to the robot speed V, σ 1 2 = σ V 2 = 4   m . When adding noise to the robot rudder angle γ, σ 1 2 = σ γ 2 =   100 ° .
The simulation results are given in Figure 7, Figure 8 and Figure 9, and Table 2. Figure 7 shows the comparison of the simulation results of five algorithms in Gaussian mixture noise. Figure 8 shows the RMSE comparison of five algorithms in Gaussian mixture noise. Figure 9 shows the state estimation errors comparison of five algorithms in Gaussian mixture noise. Table 2 shows the Average RMSE and average state estimation errors of five algorithms in Gaussian mixture noise.
In Figure 7, we observe that the simulation results obtained by EKF-SLAM, UKF-SLAM, and SRUKF-SLAM have little difference, and there is a large error compared to the true path. Because the above three algorithms are affected by non-Gaussian noise and exhibit divergence, it increases the difficulty of control. The simulation results obtained by the MCUKF-SLAM algorithm perform better than the above three algorithms, which also proves the effectiveness of the Maximum Correntropy in the non-Gaussian noise environment. The simulation results of the proposed MCSRUKF-SLAM algorithm are optimal, and its pose estimation results are the closest to the true path. Therefore, compared to other algorithms, the proposed MCSRUKF-SLAM algorithm has higher pose estimation accuracy and better anti-interference ability in Gaussian mixture noise.
In Figure 8 and Figure 9, and Table 2, we observe that the accuracy of MCUKF-SLAM is higher than that of the EKF-SLAM, UKF-SLAM, and SRUKF-SLAM algorithms. The accuracy of the EKF-SLAM algorithm is the worst, and UKF-SLAM and SRUKF-SLAM show almost the same accuracy performance. The proposed MCSRUKF-SLAM algorithm is significantly better than other algorithms in pose estimation accuracy. Furthermore, the accuracy of the proposed MCSRUKF-SLAM algorithm improved by 81.8%, 80.9%, 78.7%, and 63.6% compared to EKF-SLAM, UKF-SLAM, SRUKF-SLAM, and MCUKF-SLAM, respectively.
  • Colored noise
In this simulation, we set the state noise as Gaussian noise, as shown in Equation (65). The measurement noise was set as colored noise, and its distribution function [38] can be defined as
f c k = f 1 k + c 1 f 1 k 1 + c 2 f 1 k 2 ,
where f 1 = N   ( μ ,   σ 1 2 ) , c 1 and c 2 are weight coefficients, and c 1 = 0.8 , c 2 = 0.6 . The value of σ 1 2 in f 1 refers to Equation (66).
The simulation results are given in Figure 10, Figure 11 and Figure 12 and Table 3. Figure 10 shows the comparison of the simulation results of five algorithms in colored noise. Figure 11 shows the RMSE comparison of five algorithms in colored noise. Figure 12 shows the state estimation errors comparison of five algorithms in colored noise. Table 3 shows the ARMSE and average state estimation errors of different SLAM algorithms in colored noise.
In Figure 10, we observe that there is a certain error between the estimated path obtained by the EKF-SLAM, UKF-SALM, and SRUKF-SLAM algorithms in colored noise and the true path of the robot, indicating that the three algorithms have poor resistance to non-Gaussian noise interference. The simulation results of the MCUKF-SLAM algorithm are slightly better than the above three algorithms. The proposed MCSRUKF-SLAM algorithm is optimal, and the estimated path obtained is also closer to the true path of the robot. Therefore, the proposed MCSRUKF-SLAM algorithm has better anti-interference ability and robustness in colored noise.
In Figure 11 and Figure 12, and Table 3, we observe that UKF-SLAM and SRUKF-SLAM have better accuracy performance than the EKF-SLAM algorithm. UKF-SLAM and SRUKF-SLAM have almost the same accuracy performance, and MCUKF-SLAM has better accuracy than the EKF-SLAM, UKF-SLAM, and SRUKF-SLAM algorithms. The proposed MCSRUKF-SLAM algorithm is significantly better than other algorithms in pose estimation accuracy. Furthermore, the accuracy of the proposed MCSRUKF-SLAM algorithm improves by 50.3%, 39.9%, 38.2%, and 36.3% compared to EKF-SLAM, UKF-SLAM, SRUKF-SLAM, and MCUKF-SLAM, respectively.
In summary, the experimental results show that the proposed MCSRUKF-SLAM algorithm has better pose estimation accuracy compared to other algorithms in Gaussian mixture noise and colored noise. The simulation results confirm the proposed MCSRUKF-SLAM algorithm’s robustness and effectiveness under non-Gaussian noise conditions.

5.1.2. The Stability Analysis of Different Algorithms

In the fields of target tracking, navigation, and autonomous driving, the stability of filtering algorithms directly affects the accuracy and reliability of state estimation. Due to variations in motion speed, the system nonlinearity significantly increases, which may lead to substantial errors or even divergence in SLAM algorithms. Therefore, analyzing the stability of different algorithms under varying speeds holds significant theoretical and practical value.
We conducted 100 Monte Carlo simulation experiments in low-speed (8 m/s), medium-speed (15 m/s), and high-speed (30 m/s) scenarios. The measurement noise was set as Gaussian mixture noise, while the state noise followed a Gaussian distribution. The Average Root Mean Square Error (ARMSE) and divergence count per 100 runs were used as evaluation metrics for algorithm stability. The experimental results are presented in Table 4 and Table 5.
As shown in Table 4 and Table 5, the EKF-SLAM algorithm exhibits significant limitations in high-speed scenarios (30 m/s), with an error of 3.1131 m, an error growth rate of 216%, and a divergence rate of 25%. These empirical results conclusively validate the inherent shortcomings of linearization approximations when applied to highly nonlinear systems operating at elevated velocities. The UKF-SLAM algorithm demonstrates notable improvements through unscented transformation, reducing the error by 25% compared to EKF at 30 m/s. However, its 171% error growth rate and 13% divergence rate still indicate insufficient adaptability to high-speed conditions. In contrast, SRUKF-SLAM exhibits excellent error control capabilities, achieving zero divergence across all speed ranges and maintaining a low error growth rate of 77%. The square-root decomposition effectively enhances its numerical stability. The MCUKF-SLAM algorithm demonstrates notable limitations in high-speed scenarios (30 m/s), where maintaining positive definiteness of the covariance matrix becomes challenging. This instability leads to significant estimation errors, reflected in a 136% error growth rate and an 8% divergence rate. The proposed MCSRUKF-SLAM algorithm achieves zero divergence across all speed ranges and delivers the best error growth rate (73%). These results confirm its superior numerical stability, as the square-root decomposition effectively addresses numerical ill-conditioning issues.

5.1.3. The Running Time Comparison of Different Algorithms

In order to investigate the computational efficiency of different SLAM algorithms, the running time of different SLAM algorithms was compared in Gaussian mixture noise and colored noise. The experimental results are shown in Table 4. In this experiment, the processor model of the laptop is 11th Gen Intel (R) Core (TM) i7-1165G7 @ 2.80GHz, the memory is 16G, and the software used in the experiment is MATLAB 2018a.
Table 6 and Table 7 demonstrate that the computational time of identical SLAM algorithms varies slightly between Gaussian mixture noise and colored noise environments. This variation primarily results from noise-induced differences in matrix operation complexity, though the observed time differences remain negligible relative to the total running time. The experimental results obtained in both non-Gaussian noise environments exhibit remarkable consistency. Comparative analysis reveals that the EKF-SLAM algorithm achieves the shortest execution time. SRUKF-SLAM and UKF-SLAM exhibit similar performance in terms of computational speed. The proposed MCSRUKF-SLAM algorithm achieves comparable computational efficiency to MCUKF-SLAM. While the square-root formulation of MCSRUKF-SLAM provides marginal improvements in numerical stability, statistical analysis confirms this advantage does not reach significance. Experimental results show that while MCSRUKF-SLAM requires marginally longer runtime, its superior system performance and robustness fully compensate for this minor drawback.

5.2. Experimental Results and Analysis

To further validate the performance of the proposed SLAM algorithm, we evaluated EKF-SLAM, UKF-SLAM, SRUKF-SLAM, MCUKF-SLAM, and our MCSRUKF-SLAM using a laser SLAM dataset collected in an outdoor parking environment by the Australian Centre for Robotics at the University of Sydney [52].
This parking lot represents a complex semi-structured outdoor environment prone to generating non-Gaussian noise and significant outliers due to environmental variations and electromagnetic interference. Such realistic conditions provide an ideal testbed for validating both the robustness and precision performance of SLAM algorithms. The geometric parameters and sensor configuration of the data collection vehicle are shown in Figure 13. As illustrated, the experimental platform is a four-wheeled intelligent vehicle equipped with wheel encoders (ROD-430), a LiDAR sensor (SICK LMS 221), and a GPS receiver (Ashtech GG24). The wheel encoder was employed to measure the vehicle speed and steering angle, with standard deviations of 2 m/s and π/30 rad, respectively. A lidar system with a 180° frontal field of view (FOV) was utilized to estimate the range and heading angle of environmental features, exhibiting standard deviations of 1 m and π/60 rad, respectively. GPS was used to obtain the ground truth of the vehicle state for validating the performance of the SLAM algorithm. In this experiment, the steel pole wrapped with reflective material served as an artificial landmark to enhance the detection of feature-based fiducials by the lidar system.
EKF, UKF, SRUKF, and MCUKF are widely adopted algorithms in SLAM systems. Therefore, in our experiments, the proposed MCSRUKF-SLAM algorithm was comprehensively compared against these baseline methods. The experimental results in Figure 14 were obtained by averaging 30 Monte Carlo runs for each SLAM algorithm. In the figure, crosses (+) and squares (□) denote the estimated landmark positions and ground truth landmark positions, respectively, while the dashed lines in different colors and solid black lines represent the robot’s estimated trajectory and ground truth trajectory, respectively. Table 8 shows the ARMSE of different algorithms in the car park dataset. As shown in Figure 14 and Table 8, the estimation performance of EKF-SLAM is inferior to that of UKF-SLAM and SRUKF-SLAM, with UKF-SLAM and SRUKF-SLAM exhibiting comparable performance. MCUKF-SLAM outperformed SRUKF-SLAM, while the proposed MCSRUKF-SLAM demonstrates significantly higher accuracy than all other SLAM algorithms. Therefore, the experimental results in Figure 14 and Table 8 indicate that the proposed MCSRUKF-SLAM algorithm achieved remarkable localization precision in the real-world parking lot datasets.

6. Conclusions

The contribution of this paper is to address the problems of the SLAM algorithm in mobile robot applications, with a focus on researching robot-pose estimation algorithms under non-Gaussian noise. Furthermore, in response to the problem of low estimation accuracy of the traditional Kalman filtering algorithm in non-Gaussian noise, we proposed the MCSRUKF-SLAM algorithm to improve the accuracy of the robot pose estimation. The proposed MCSRUKF-SLAM algorithm incorporates the square root form of sigma points into the Unscented Kalman Filter, and uses relatively simple QR decomposition and Cholesky decomposition to perform square root operations on the error covariance matrix. Moreover, the proposed MCSRUKF-SLAM algorithm which combines with the Maximum Correntropy criterion, effectively improves the problems of poor pose estimation accuracy in non-Gaussian noise.

Author Contributions

Conceptualization, S.L. and Y.G.; methodology, S.L.; software, S.L.; validation, Y.G.; writing—review and editing, S.L.; supervision, Y.G. All authors have read and agreed to the published version of the manuscript.

Funding

This research received no external funding.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The data are available on request.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Nam, D.V.; Danh, P.T.; Park, C.H.; Kim, G.W. Fusion consistency for industrial robot navigation: An integrated SLAM framework with multiple 2D LiDAR-visual-inertial sensors. Comput. Electr. Eng. 2024, 120, 109607. [Google Scholar] [CrossRef]
  2. Ding, S.S.; Zhang, T.D.; Lei, M.; Chai, H.R.; Jia, F.X. Robust visual-based localization and mapping for underwater vehicles: A survey. Ocean. Eng. 2024, 312, 119274. [Google Scholar] [CrossRef]
  3. Wang, Z.H.; Chen, H.Y.; Zhang, S.W.; Lou, Y.J. Active View Planning for Visual SLAM in Outdoor Environments Based on Continuous Information Modeling. IEEE ASME Trans. Mechatron. 2024, 29, 237–248. [Google Scholar] [CrossRef]
  4. Zheng, S.R.; Wang, J.L.; Rizos, C.; Ding, W.D.; El-Mowafy, A. Simultaneous Localization and Mapping (SLAM) for Autonomous Driving: Concept and Analysis. Remote Sens. 2023, 15, 1156. [Google Scholar] [CrossRef]
  5. Huang, L.; Zhu, Z.; Yun, J.T.; Xu, M.M.; Liu, Y.; Sun, Y.; Hu, J.; Li, F.Z. Semantic Loopback Detection Method Based on Instance Segmentation and Visual SLAM in Autonomous Driving. IEEE Trans. Intell. Transp. Syst. 2023, 25, 3118–3127. [Google Scholar] [CrossRef]
  6. Zhang, H.; Yu, L.; Fei, S.M. Design of Dual-LiDAR High Precision Natural Navigation System. IEEE Sensors 2022, 22, 7231–7239. [Google Scholar] [CrossRef]
  7. Chen, J.Y.; Wang, H.; Hu, M.H.; Suganthan, P.N. Versatile LiDAR-Inertial Odometry with SE(2) Constraints for Ground Vehicles. IEEE Robot. Autom. 2023, 8, 3486–3493. [Google Scholar] [CrossRef]
  8. Zhuang, L.C.; Zhong, X.R.; Xu, L.J.; Tian, C.B.; Yu, W.S. Visual SLAM for Unmanned Aerial Vehicles: Localization and Perception. Sensors 2024, 24, 2980. [Google Scholar] [CrossRef]
  9. Sheng, X.D.; Mao, S.J.; Yan, Y.C.; Yang, X.K. Review on SLAM algorithms for Augmented Reality. Displays 2024, 84, 102806. [Google Scholar] [CrossRef]
  10. Pollmann, K.; Loh, W.; Fronemann, N.; Ziegler, D. Entertainment vs. manipulation: Personalized human-robot interaction between user experience and ethical design. Technol. Forecast. Soc. Change 2023, 189, 122376. [Google Scholar] [CrossRef]
  11. Chen, W.F.; Shang, G.T.; Ji, A.H.; Zhou, C.J.; Wang, Y.X.; Xu, C.H.; Li, Z.X.; Hu, K. An Overview on Visual SLAM: From Tradition to Semantic. Remote Sens. 2023, 14, 3010. [Google Scholar] [CrossRef]
  12. Zuo, C.L.; Feng, Z.; Xiao, X.H. CMDS-SLAM: Real-time efficient centralized multi-robot dense surfel SLAM. Meas. Sci. Technol. 2024, 35, 116303. [Google Scholar] [CrossRef]
  13. Ullah, I.; Su, X.; Zhang, X.W.; Choi, D.M.; Seet, G. Simultaneous Localization and Mapping Based on Kalman Filter and Extended Kalman Filter. Wirel. Commun. Mob. Comput. 2020, 2020, 2138643. [Google Scholar] [CrossRef]
  14. Dai, J.; Li, D.F.; Li, Y.Q.; Zhao, J.W.; Li, W.B.; Liu, G. Mobile Robot Localization and Mapping Algorithm Based on the Fusion of Image and Laser Point Cloud. Sensors 2022, 22, 4114. [Google Scholar] [CrossRef]
  15. Wang, Y.Z.; Liu, X.H.; Kang, Y.; Ge, S.S. Anomaly Resilient Relative Pose Estimation for Multiple Nonholonomic Mobile Robot Systems. IEEE Sys. J. 2022, 16, 659–670. [Google Scholar] [CrossRef]
  16. Zhu, W.P.; Cheng, X.L. Indoor Localization Method of Mobile Educational Robot Based on Visual Sensor. Internet Technol. 2023, 24, 205–215. [Google Scholar]
  17. Chen, W.; Jiang, S.; Cao, J.R.; Sun, R.S. An adaptive EKF-SLAM algorithm for cooperative navigation of multi-aircrafts. IET Control Theory Appl. 2024, 18, 2823–2829. [Google Scholar] [CrossRef]
  18. Zhou, Z.; Wang, D.Q.; Xu, B.Y. A multi-innovation with forgetting factor based EKF-SLAM method for mobile robots. Assem. Autom. 2021, 41, 71–78. [Google Scholar] [CrossRef]
  19. Mailka, H.; Abouzahir, M.; Ramzi, M. An efficient end-to-end EKF-SLAM architecture based on LiDAR, GNSS, and IMU data sensor fusion for autonomous ground vehicles. Multimed. Tools Appl. 2024, 83, 56183–56206. [Google Scholar] [CrossRef]
  20. Bahraini, M.S. On the Efficiency of SLAM Using Adaptive Unscented Kalman Filter. IJST-T. Mech. Eng. 2020, 44, 727–735. [Google Scholar] [CrossRef]
  21. Yuan, S.A.; Wu, J.A.; Luan, F.J.; Zhang, L.L.; Lv, J.Q. Improvement of Strong Tracking UKF-SLAM Approach using Three-position Ultrasonic Detection. Rob. Autom. Syst. 2023, 159, 104305. [Google Scholar] [CrossRef]
  22. Cao, Y.B.; Deng, Z.Y.; Luo, Z.H.; Fan, J.W. A Multi-Sensor Deep Fusion SLAM Algorithm Based on TSDF Map. IEEE Access 2024, 12, 154535–154545. [Google Scholar] [CrossRef]
  23. Havangi, R. Robust SLAM: SLAM base on H∞ square root unscented Kalman filter. Nonlinear Dyn. 2016, 83, 767–779. [Google Scholar] [CrossRef]
  24. Dutt, R.; Acharyya, A. Low-Complexity Square-Root Unscented Kalman Filter Design Methodology. Circ. Syst. Signal Process. 2023, 42, 6900–6928. [Google Scholar] [CrossRef]
  25. Tang, M.; Chen, Z.; Yin, F.L. SLAM with Improved Schmidt Orthogonal Unscented Kalman Filter. Int. J. Control Autom. Syst. 2022, 20, 1327–1335. [Google Scholar] [CrossRef]
  26. Tang, M.; Chen, Z.; Yin, F.L. An Improved Adaptive Unscented FastSLAM with Genetic Resampling. Int. J. Control Autom. Syst. 2021, 19, 1677–1690. [Google Scholar] [CrossRef]
  27. Wang, J.; Meng, Z.Y.; Wang, L. A UPF-PS SLAM Algorithm for Indoor Mobile Robot with NonGaussian Detection Model. IEEE-ASME Trans. Mechatron. 2022, 27, 1–11. [Google Scholar] [CrossRef]
  28. Shi, W.L.; Li, Y.S.; Wang, Y.Y. Noise-Free Maximum Correntropy Criterion Algorithm in Non-Gaussian Environment. IEEE Trans. Circuits Syst. Express Briefs 2020, 67, 8704943. [Google Scholar] [CrossRef]
  29. Liu, X.; Ren, Z.G.; Lyu, H.Q.; Jiang, Z.H.; Ren, P.J.; Chen, B.D. Linear and Nonlinear Regression-Based Maximum Correntropy Extended Kalman Filtering. IEEE Trans. Syst. Man. Cybern. Syst. 2021, 51, 8736038. [Google Scholar] [CrossRef]
  30. Zhang, Q.Y.; Li, Y.; Ma, T.; Cong, Z.; Zhang, W.J. Bathymetric Particle Filter SLAM With Graph-Based Trajectory Update Method. IEEE Access 2021, 9, 85464–85475. [Google Scholar] [CrossRef]
  31. Wang, Y.F.; Wang, X.Y. Research on SLAM Road Sign Observation Based on Particle Filter. Comput. Intell. Neurosci. 2022, 2022, 4478978. [Google Scholar] [CrossRef] [PubMed]
  32. Lu, T.; Zhou, W.D.; Tong, S. Improved maximum correntropy cubature Kalman and information filters with application to target tracking under non-Gaussian noise. Int. J. Adapt. Control Signal Process. 2024, 38, 1199–1221. [Google Scholar] [CrossRef]
  33. Liu, Z.; Zhang, M.; Song, X.M.; Yan, X.H. A novel fusion maximum correntropy Kalman/UFIR filter for state estimation with uncertain non-Gaussian noise statistics. Meas. J. Int. Meas. Confed. 2023, 220, 113339. [Google Scholar] [CrossRef]
  34. Qiao, S.F.; Fan, Y.S.; Wang, G.F.; Mu, D.D.; He, Z.P. Maximum correntropy criterion variational Bayesian adaptive Kalman filter based on strong tracking with unknown noise covariances. J. Franklin Inst. 2023, 360, 6515–6536. [Google Scholar] [CrossRef]
  35. Guo, H.J.; Liu, H.Y.; Zhou, Y.; Hu, X.X. Robust State Estimation via Maximum Correntropy EKF on Matrix Lie Groups with Application to Low-Cost INS/GPS-Integrated Navigation System. IEEE Sensors J. 2023, 23, 9467–9479. [Google Scholar] [CrossRef]
  36. Qi, D.L.; Feng, J.A.; Ni, X.D.; Wang, L. Maximum Correntropy Extended Kalman Filter for Vehicle State Observation. Int. J. Automot. Technol. 2023, 24, 377–388. [Google Scholar] [CrossRef]
  37. Qi, D.L.; Feng, J.A.; Wan, W.K.; Song, B. A novel maximum correntropy adaptive extended Kalman filter for vehicle state estimation under non-Gaussian noise. Meas. Sci. Technol. 2023, 34, 025114. [Google Scholar] [CrossRef]
  38. Wang, G.Q.; Li, N.; Zhang, Y.G. Maximum correntropy unscented Kalman and information filters for non-Gaussian measurement noise. J. Franklin Inst. 2017, 354, 8659–8677. [Google Scholar] [CrossRef]
  39. Wang, G.Q.; Zhang, Y.G.; Wang, X.D. Iterated maximum correntropy unscented Kalman filters for non-Gaussian systems. Signal Process. 2019, 163, 87–94. [Google Scholar] [CrossRef]
  40. Wang, Y.; Lu, Y.; Zhou, Y.Q.; Zhao, Z.J. Maximum Correntropy Criterion-Based UKF for Loosely Coupling INS and UWB in Indoor Localization. CMES Comput. Model. Eng. Sci. 2024, 139, 2673–2703. [Google Scholar] [CrossRef]
  41. Zhang, F.; Feng, J.A.; Qi, D.L.; Liu, Y.; Shao, W.P.; Qi, J.A.; Lin, Y.A. Joint Estimation of Vehicle State and Parameter Based on Maximum Correntropy Adaptive Unscented Kalman Filter. Int. J. Automot. Technol. 2023, 24, 1553–1566. [Google Scholar] [CrossRef]
  42. Hajimolahoseini, H.; Amirfattahi, R.; Gazor, S.; Soltanian-Zadeh, H. Robust Estimation and Tracking of Pitch Period Using an Efficient Bayesian Filter. IEEE ACM Trans. Audio Speech Lang. Process. 2016, 24, 1219–1229. [Google Scholar] [CrossRef]
  43. Liu, X.; Chen, B.D.; Xu, B.; Wu, Z.Z.; Honeine, P. Maximum Correntropy Unscented Filter. Int. J. Syst. Sci. 2017, 48, 1607–1615. [Google Scholar] [CrossRef]
  44. Liu, Q.; Davoine, F.; Yang, J.; Cui, Y.; Jin, Z.; Han, F. A Fast and Accurate Matrix Completion Method Based on QR Decomposition and L2,1-Norm Minimization. IEEE Trans. Neural Netw. Learn. Syst. 2019, 30, 803–817. [Google Scholar] [CrossRef] [PubMed]
  45. Zhao, X.H.; Mu, D.J.; Gao, Z.H.; Zhang, J.H.; Li, G. Stochastic Stability of the Improved Maximum Correntropy Kalman Filter Against Non-Gaussian Noises. Int. J. Control Autom. Syst. 2024, 22, 731–743. [Google Scholar] [CrossRef]
  46. Jin, Y.Z.; Mu, L.X.; Feng, N.; Hei, X.H.; Li, Y.K.; Guo, X.; Ye, X.; Li, J.J. Maximum Correntropy-Based Extended Particle Filter for Nonlinear System. IEEE Trans. Circuits Syst. Express Briefs 2023, 70, 2520–2524. [Google Scholar] [CrossRef]
  47. Debasis, K.; Swagata, N.; Rhythm, G. On Weighted Least Squares Estimators of Parameters of a Chirp Model. Circ. Syst Signal Process. 2023, 42, 493–521. [Google Scholar]
  48. Wang, G.; Ouyang, L.Q.; Tong, L.L.; Fang, Q.; Peng, B. A Recursive Least P-Order Algorithm Based on M-Estimation in a Non-Gaussian Environment. IEEE Trans. Circuits Syst. Express Briefs 2023, 70, 2979–2983. [Google Scholar] [CrossRef]
  49. Chen, B.D.; Liu, X.; Zhao, H.Q.; Principe, J.C. Maximum correntropy Kalman filter. Automatica 2017, 76, 70–77. [Google Scholar] [CrossRef]
  50. Chang, G.B.; Liu, M. M-estimator-based robust Kalman filter for systems with process modeling errors and rank deficient measurement models. Nonlinear Dyn. 2015, 80, 1431–1449. [Google Scholar] [CrossRef]
  51. Chen, B.D.; Xing, L.; Zhao, H.Q.; Zheng, N.N.; Principe, J.C. Generalized Correntropy for Robust Adaptive Filtering. IEEE Trans. Signal Process. 2016, 64, 3376–3387. [Google Scholar] [CrossRef]
  52. Available online: http://www-personal.acfr.usyd.edu.au/nebot/dataset (accessed on 5 June 2023).
Figure 1. The flow chart of the MCSRUKF-SLAM algorithm.
Figure 1. The flow chart of the MCSRUKF-SLAM algorithm.
Applsci 15 05662 g001
Figure 2. Wheeled robot model.
Figure 2. Wheeled robot model.
Applsci 15 05662 g002
Figure 3. The true path of the mobile robot.
Figure 3. The true path of the mobile robot.
Applsci 15 05662 g003
Figure 4. Estimation results of five algorithms in Gaussian noise.
Figure 4. Estimation results of five algorithms in Gaussian noise.
Applsci 15 05662 g004
Figure 5. RMSE of five algorithms in Gaussian noise.
Figure 5. RMSE of five algorithms in Gaussian noise.
Applsci 15 05662 g005
Figure 6. State estimation errors of five algorithms in Gaussian noise.
Figure 6. State estimation errors of five algorithms in Gaussian noise.
Applsci 15 05662 g006
Figure 7. Comparison of simulation results of five algorithms in Gaussian mixture noise.
Figure 7. Comparison of simulation results of five algorithms in Gaussian mixture noise.
Applsci 15 05662 g007
Figure 8. RMSE of five algorithms in Gaussian mixture noise.
Figure 8. RMSE of five algorithms in Gaussian mixture noise.
Applsci 15 05662 g008
Figure 9. State estimation errors of five algorithms in Gaussian mixture noise.
Figure 9. State estimation errors of five algorithms in Gaussian mixture noise.
Applsci 15 05662 g009
Figure 10. Comparison of simulation results of five algorithms in colored noise.
Figure 10. Comparison of simulation results of five algorithms in colored noise.
Applsci 15 05662 g010
Figure 11. RMSE of five algorithms in colored noise.
Figure 11. RMSE of five algorithms in colored noise.
Applsci 15 05662 g011
Figure 12. State estimation errors of five algorithms in colored noise.
Figure 12. State estimation errors of five algorithms in colored noise.
Applsci 15 05662 g012
Figure 13. Basic parameters of the mobile vehicle for the real-world dataset experiments in car park: (a) vehicle model and parameters; (b) mobile vehicle.
Figure 13. Basic parameters of the mobile vehicle for the real-world dataset experiments in car park: (a) vehicle model and parameters; (b) mobile vehicle.
Applsci 15 05662 g013
Figure 14. Comparison of the estimated paths in the car park: (a) EKF-SLAM; (b) UKF-SLAM; (c) SRUKF-SLAM; (d) MCUKF-SLAM; (e) MCSRUKF-SLAM.
Figure 14. Comparison of the estimated paths in the car park: (a) EKF-SLAM; (b) UKF-SLAM; (c) SRUKF-SLAM; (d) MCUKF-SLAM; (e) MCSRUKF-SLAM.
Applsci 15 05662 g014aApplsci 15 05662 g014b
Table 1. Main parameters of the robot.
Table 1. Main parameters of the robot.
ParametersSymbolsValue
Movement speed (m/s)V8
Maximum observation distance (m)mx30
Wheel-steering angle (rad)Ω30
Maximum turning speed of wheels (rad/s)Vt20
Control frequency (Hz)fc40
Observed frequency (Hz)fb5
Adjusting weightsδ8
Damping parametersμ0.001
Robot wheelbase (m)L4
Table 2. Comparison of average RMAE and average state estimation error for some SLAM algorithms in Gaussian mixture noise.
Table 2. Comparison of average RMAE and average state estimation error for some SLAM algorithms in Gaussian mixture noise.
AlgorithmsARMSE (m)Aerrorx (m)Aerrory (m)Aerrorϕ (rad)
EKF-SLAM [13]1.00390.41280.63100.0168
UKF-SLAM [20]0.87560.29560.49270.0138
SRUKF-SLAM [23]0.83480.25490.47760.0136
MCUKF-SLAM [39]0.80230.23350.45110.0129
The proposed MCSRUKF-SLAM0.47370.19050.27080.0079
Table 3. Comparison of average RMAE and average state estimation error for some SLAM algorithms in colored noise.
Table 3. Comparison of average RMAE and average state estimation error for some SLAM algorithms in colored noise.
AlgorithmsARMSE (m)Aerrorx (m)Aerrory (m)Aerrorϕ (rad)
EKF-SLAM [13]1.37830.60390.88410.0171
UKF-SLAM [20]1.13400.43360.61190.0138
SRUKF-SLAM [23]1.10910.42570.60050.0137
MCUKF-SLAM [39]1.07670.40180.59030.0135
The proposed MCSRUKF-SLAM0.68510.27340.38490.0123
Table 4. Comparison of average RMSE for various algorithms at different speeds (Unit: m).
Table 4. Comparison of average RMSE for various algorithms at different speeds (Unit: m).
AlgorithmsARMSE (8 m/s)ARMSE (15 m/s)ARMSE (30 m/s)Error growth rate (8→30 m/s)
EKF-SLAM [13]0.98581.80403.1131216%
UKF-SLAM [20]0.86071.31592.3353171%
SRUKF-SLAM [23]0.82081.02311.451877%
MCUKF-SLAM [39]0.78911.12331.8623136%
The proposed MCSRUKF-SLAM0.46550.56330.803973%
Table 5. Comparison of divergence count per 100 runs for various algorithms at different speeds.
Table 5. Comparison of divergence count per 100 runs for various algorithms at different speeds.
AlgorithmsDivergence Count per 100 Runs (8 m/s)Divergence Count per 100 Runs (15 m/s)Divergence Count per 100 Runs (30 m/s)
EKF-SLAM [13]31325
UKF-SLAM [20]0613
SRUKF-SLAM [23]000
MCUKF-SLAM [39]048
The proposed MCSRUKF-SLAM000
Table 6. Running time comparison of five algorithms under Gaussian mixture noise conditions.
Table 6. Running time comparison of five algorithms under Gaussian mixture noise conditions.
AlgorithmsTotal Running Time (s)Single Step Time (s)
EKF-SLAM [13]223.2010.197
UKF-SLAM [20]244.7180.216
SRUKF-SLAM [23]235.6640.208
MCUKF-SLAM [39]319.5060.282
The proposed MCSRUKF-SLAM311.5750.275
Table 7. Running time comparison of five algorithms under colored noise conditions.
Table 7. Running time comparison of five algorithms under colored noise conditions.
AlgorithmsTotal Running Time (s)Single Step Time (s)
EKF-SLAM [13]232.2650.206
UKF-SLAM [20]250.3930.222
SRUKF-SLAM [23]240.1960.215
MCUKF-SLAM [39]329.7030.293
The proposed MCSRUKF-SLAM324.0380.285
Table 8. Comparison of average RMSE for various SLAM algorithm.
Table 8. Comparison of average RMSE for various SLAM algorithm.
AlgorithmEKF-SLAMUKF-SLAMSRUKF-SLAMMCUKF-SLAMThe Proposed MCSRUKF-SLAM
ARMSE(m)0.710.5580.5370.4930.284
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

Liu, S.; Guo, Y. Vehicle Pose Estimation Method Based on Maximum Correntropy Square Root Unscented Kalman Filter. Appl. Sci. 2025, 15, 5662. https://doi.org/10.3390/app15105662

AMA Style

Liu S, Guo Y. Vehicle Pose Estimation Method Based on Maximum Correntropy Square Root Unscented Kalman Filter. Applied Sciences. 2025; 15(10):5662. https://doi.org/10.3390/app15105662

Chicago/Turabian Style

Liu, Shuyu, and Ying Guo. 2025. "Vehicle Pose Estimation Method Based on Maximum Correntropy Square Root Unscented Kalman Filter" Applied Sciences 15, no. 10: 5662. https://doi.org/10.3390/app15105662

APA Style

Liu, S., & Guo, Y. (2025). Vehicle Pose Estimation Method Based on Maximum Correntropy Square Root Unscented Kalman Filter. Applied Sciences, 15(10), 5662. https://doi.org/10.3390/app15105662

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