Next Article in Journal
OISE: Optimized Input Sampling Explanation with a Saliency Map Based on the Black-Box Model
Next Article in Special Issue
Design and Implementation of a Six-Degrees-of-Freedom Underwater Remotely Operated Vehicle
Previous Article in Journal
Priority of Emergency Vehicle Dynamic Right-Of-Way Control Method in Networked Environment
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

ROV State Estimation Using Mixture of Gaussian Based on Expectation-Maximization Cubature Particle Filter

College of Engineering Science and Technology, Shanghai Ocean University, Shanghai 201306, China
*
Author to whom correspondence should be addressed.
Appl. Sci. 2023, 13(10), 5885; https://doi.org/10.3390/app13105885
Submission received: 9 April 2023 / Revised: 26 April 2023 / Accepted: 28 April 2023 / Published: 10 May 2023
(This article belongs to the Special Issue Design and Implementation of Underwater Vehicles)

Abstract

:
The underwater motion of the ROV is affected by various environmental factors, such as wind, waves, and currents. The complex relationship between these disturbance variables results in non-Gaussian noise distribution, which cannot be handled by the classical Kalman filter. For the accurate and real-time observation of ROV climbing, and, at the same time, to reduce the influence of the uncertainty of the noise distribution, the ROV state filter is designed based on the mixture of Gaussian model theory with the expectation-maximization cubature particle filter (EM-MOGCPF). The EM-MOGCPF considers different sensor measurement noises, and the addition of mixture of Gaussian (MOG) improves the fineness and real-time properties, while the expectation-maximization (EM) reduces the complexity of the algorithm. To estimate the ROV xyz-axis and yaw angular states, we establish a four-degree-of-freedom (4-DOF) ROV kinetics model, which uses a simulation platform for multiple sea state degrees. The results show that the EM-MOGCPF effectively improves the estimation accuracy and exhibits strong adaptability to nonlinear and non-Gaussian environments. We believe that this algorithm holds promise in solving the state estimation challenge in these difficult environments.

1. Introduction

The adhesion of marine organisms to the anchor chain can significantly reduce its weight support capability. Furthermore, the secretions from these organisms can speed up the corrosion of the steel structure. To ensure proper weight support and extend the lifespan of the steel structure, frequent underwater cleaning of the anchor chain is necessary. This cleaning must adhere to safety regulations set forth by the classification society and the operation area. Given the complexity of the underwater environment, the cleaning process requires a specialized ROV. This type of ROV is strongly coupled and strongly nonlinear [1,2,3]. Therefore, the ROV’s control accuracy is essential in ensuring that it runs normally. To calculate the current state of the ROV using a series of filtering and data fusion algorithms, state estimation is adopted, which plays a critical role in the control of the ROV. It serves as the intermediary layer between sensor measurement and controller calculation. By using a series of filtering and data fusion algorithms, the current state of the ROV can be accurately calculated. This information can then be used to improve the accuracy of the controller, creating a closed loop that enhances the ROV’s performance.
Many scholars have carried out a lot of work on the state estimation algorithm. The Kalman filter [4] has been widely used in the model-driven state estimation method because of how straightforward and easy it is to use. Standard Kalman filter theory only applies to linear systems; however, in engineering applications, the system is typically nonlinear. Bucy and Sunahara proposed the extended Kalman filter (EKF) [5], Dong et al. [6] proposed an EKF-based adaptive object tracking method for AUV state estimation, Han et al. [7] designed a tracking controller based on feedback linearization by using EKF to estimate the state of UVMS, and Zheng et al. [8] implemented the adaptive control of UVMSs using EKF to estimate system state and forecast external disturbances, but EKF ignores the high-order terms of the nonlinear system, lowering the estimation accuracy [9]. The original filtering method has been enhanced with further research [10]. The other two frequently used filtering techniques are unscented Kalman filtering (UKF) [11] and the cubature Kalman filter (CKF) [12]. UKF uses a series of sigma points to propagate the state and covariance matrix [13]. CKF calculates the integral; unlike UKF, CKF uses a 2n cubature point propagation state and covariance matrix. When using an identical matrix factorization method, such as the Cholesky method, CKF has a lower calculation burden than UKF and has better stability and higher precision [14]. Chen et al. [15] designed an augmented state cubature Kalman filter to improve the stability of the long-range navigation of surface ships.
When the system noise cannot be approximated as a Gaussian noise distribution, the estimation accuracy of the Kalman filter decreases. In this case, a numerical approximation method, the particle filter, is needed [16]. By using a Monte Carlo simulation, a huge number of particles are created, and the distribution of these particles is utilized to estimate the probability distribution of states. Particle filters are used in research [17] to complete attitude estimation during the UAV landing procedure; a particle filter based on multi-model interaction [18] was presented to address the issue of estimating the performance of several rotors, and it minimizes the estimate error when compared to EKF. The correlation filter [19], which combines particle filters and correlation filters, performs well in state estimation; Jing and Chen [20] proposed a particle filter based on color distribution for object tracking, which increased the tracking accuracy by addressing the issue of object tracking illumination changes and occlusion.
Mixture of Gaussian (MOG) can be seen as a combination of k single Gaussian models; MOG is widely utilized to mimic non-Gaussian density because it enhances the real-time state estimation performance while maintaining the estimation performance [21]. Kotecha and Djuric [22] extended MOG and PF to dynamic space models with non-Gaussian noise; Ulmschneider et al. [23] used MOG in multi-path-assisted positioning to improve the positioning accuracy. A recursive estimator for non-Gaussian problems was derived in [24]; any probability density can be approximated by a mixture model of finite Gaussian functions [25]. MOGKF outperforms PF and IMM-KF in non-Gaussian issues, as Bilik showed in [26].
In this paper, we address the challenging problem of ROV state estimation in an underwater environment that is nonlinear and non-Gaussian. Due to the complexity of the underwater environment, the process noise of ROV sensors is non-Gaussian, which poses a significant challenge to state estimation. To overcome this issue, we propose a state estimation algorithm that operates effectively in a non-Gaussian noise environment. Specifically, we apply the CKF to the PF framework to compute the mean and variance of the importance density function, generate a new posterior probability density distribution, and regenerate new particles. The problem of particle degradation is alleviated by using MOG instead of a single Gaussian noise distribution in the EM algorithm, which also reduces the amount of calculation required during resampling. Simulation trials are used to confirm the algorithm’s efficacy and noise resistance.
The rest of this paper is as follows. Section 2 analyzes the ROV motion state and establishes a four-degree-of-freedom dynamic model. Section 3 selects state quantities and observations and reviews the CKF algorithm. Section 4 introduces the proposed EM-MOGCPF algorithm. Section 5 presents the simulation results. Then, Section 6 summarizes the main work of this paper.

2. ROV Modeling

2.1. Description

The research object of this paper is an anchor chain cleaning robot; the three-dimensional model is illustrated in Figure 1. The ROV features an octahedral open frame structure, with a maximum operational water depth of 500 m.
The crawling state of the anchor chain is shown in Figure 2. The operation process of the ROV is divided into five steps, namely lifting into the water, underwater movement, cleaning operation, inspection operation, and recovery.

2.2. Coordinate System

According to Figure 3, this paper establishes a dynamic model of the ROV in two coordinate systems, namely the earth frame O-XYZ and the body-fixed frame o-xyz. The earth frame is a fixed system with O as the origin, where OX and OY are two horizontal directions perpendicular to each another, and OZ points vertically to the water surface. Meanwhile, the ROV’s position and direction are described by the body-fixed frame, which is a local coordinate system fixed on the moving rigid body. The body-fixed frame has o as the origin, where ox represents the front of the ROV movement, oz represents the bottom, and oy and the other two axes form a right-handed coordinate system.
The ROV has six-degree-of-freedom (DOF) motions: three translational motions, surge (X), sway (Y), and heave (Z). There are three Euler angles, roll ( φ ), pitch ( θ ), and yaw ( ψ ), which represent the position and attitude of the ROV relative to the inertial system. The linear velocity and angular velocity of the ROV are denoted by ( u , v , w ) and ( p , q , r ), respectively.
The motion state of the ROV on the anchor chain is constrained according to the working state specified in Section 2.1, and the self-stabilizing roll and pitch motions make it unnecessary to consider the roll and pitch angles. Therefore, the ROV motion model’s 4-DOF are simplified, and the motion parameters are defined as presented in Table 1 [27].
In the inertial coordinate system, the attitude vector is η = [ x y z ψ ] T , where x y z is the three-axis translation displacement, and ψ is the heading angle. The motion coordinate system’s velocity vector is V = [ u v w r ] T , where u v w is the linear velocity, and r is the angular velocity around the z-axis. A few assumptions are made as follows:
  • The ROV density is distributed uniformly;
  • There is low-speed movement;
  • The center of buoyancy and gravity are congruent.
The space conversion equation is given by
η ˙ = J ( η ) V ,
where J ( η ) is Jacobian matrix
J ( η ) = J 1 ( η ) 0 3 × 3 0 3 × 3 J 2 ( η )
J 1 ( η ) and J 2 ( η ) are given by
J 1 ( η ) = c o s ψ s i n ψ c o s φ + c o s ψ s i n θ s i n φ s i n ψ s i n φ + c o s ψ s i n θ s i n φ s i n ψ c o s θ c o s ψ c o s φ + s i n φ s i n θ s i n ψ c o s ψ s i n φ + s i n θ s i n ψ c o s φ s i n θ c o s θ s i n φ c o s θ c o s φ ,
J 2 ( η ) = 1 s i n φ t a n θ c o s φ t a n θ 0 c o s φ s i n φ 0 s i n φ s e c θ c o s φ s e c θ ,

2.3. ROV Dynamic Model

In Fossen’s theory [27], ROV dynamics consist of a rigid body force, hydrodynamic force, and water surface static force:
M V ˙ + C R B ( V ) V + C A ( V ) V + D N L ( V ) V + D L ( V ) V + g ( η ) + g r = τ + τ e n v ,
The system inertia matrix M R 4 × 4 , M = M R B + M A , composed of the rigid-body and added mass matrices,
M R B = m 0 0 0 0 m 0 0 0 0 m 0 0 0 0 I z , M A = X u ˙ 0 0 0 0 Y v ˙ 0 0 0 0 Z w ˙ 0 0 0 0 N r ˙ ,
The Coriolis-centripetal matrix C ( V ) R 4 × 4 , C ( V ) = C R B ( V ) + C A ( V ) is composed of the rigid-body and added mass effects:
C R B ( V ) = 0 0 0 m v 0 0 0 m u 0 0 m 0 m v m u 0 0 , C A ( V ) = 0 0 0 Y v ˙ v 0 0 0 X u ˙ u 0 0 0 0 Y v ˙ v X u ˙ u 0 N r ˙ ,
The damping matrix D ( V ) R 4 × 4 , D ( V ) = D L + D N L ( V ) is composed of the linear and nonlinear hydrodynamic damping:
D L = X u 0 0 0 0 Y v 0 0 0 0 Z w 0 0 0 0 N r ,
D L = X | u | u | u | 0 0 0 0 Y | v | v | v | 0 0 0 0 Z | w | w | w | 0 0 0 0 N | r | r | r | ,
g ( η ) and g ( 0 ) are the restoring forces that try to bring the system to its natural equilibrium; it is implemented as
g ( η ) = 0 0 ( W B ) 0 ,
where W and B are, respectively, buoyancy and gravity.
For the ROV, τ gives propulsion. There are only four different motions, surge, sway, heave, and yaw, because the ROV is attached to an anchor chain; hence, τ R 4 × 1 , τ = [ τ x τ y τ z τ ψ ]
The ROV is exposed to environmental disturbance forces and moments in the water throughout the diving process, which are made up of secondary wave forces, ocean currents, and wind forces. The bias model b ˙ is
b ˙ = F b + w b ,
where w b is a zero mean Gaussian white noise vector, and F b is a environmental disturbance matrix.

2.4. Complete ROV State Space Model

The complete mathematical model of an ROV is represented using a state space formulation that integrates the coordinate system and dynamic model. By combining Equations (1) and (5), we obtain a state space model.
η ˙ = R ( ψ ) V , V ˙ = M 1 [ C ( V ) v D ( V ) V g ( η ) g r + τ + τ e n v ] ,
where, as in Table 1, it has 4-DOF; when moving on the anchor chain, the transverse rolling and pitching movements do not need to be considered. The transformation matrix J ( η ) is simplified to a pure rotational matrix R ( ψ ) .

3. State Estimation Based on Nonlinear Gaussian Systems

3.1. Observer Design

The Kalman filter is designed on the ROV of the 4-DOF dynamic model, and the dynamic model of the ROV has been given in Section 2.3. The state variables are defined as follows:
x ^ = [ x y z φ u v w r b x b y b z b φ ] ,
where x ^ R 12 × 1 . In a linear system, the state space equation can be expressed as
x k ˙ = A x k 1 + B u k 1 + E w k 1 , z k = H x k + v k ,
Expanding the matrices in Equation (14) yields
A = R ( ψ ) V M 1 ( D ( v ) v C ( v ) v + R T ( ψ ) b ) F b 0 9 × 1 , B = 0 M 1 0 ,
E = 0 0 0 0 M 1 0 0 0 1 4 × 4 , H = 1 4 × 4 0 4 × 8 ,
where A R 12 × 1 , is the state-transition matrix, B R 12 × 4 is the input matrix, E R 12 × 12 is the noise matrix, H R 4 × 12 is the measurement, w is the process noise, w ( 0 , Q k ) , and v is the measurement noise, v ( 0 , R k ) .

3.2. CKF Algorithm

In underwater scenarios, the kinematic characteristics of ROVs are highly nonlinear due to the interconnections between each degree of freedom. Therefore, linear Kalman filtering is not suitable for modeling such scenarios. To address this issue, Arasaratnam and Haykin [12] proposed the CKF, which can overcome the divergence problem of the EKF. Unlike the EKF, the CKF does not rely on linearizing the nonlinear system, but instead transforms it to calculate the first- and second-order moments of the filter distribution. As a result, the CKF is applicable to a wide range of nonlinear systems, as long as the error remains within acceptable limits.
The following Gaussian noise nonlinear system model is formed:
x k ˙ = f ( x k 1 , u k 1 ) + w k , z k = h ( x k ) + v k ,
where f ( ) and h ( ) represent the nonlinear process and measurement equation.
Step 1: Initialize
To produce 2n cubature points, CKF applies the third-order spherical radial volume rule as shown:
x ^ k = E ( x 0 ) , P k = E ( x 0 x ^ k ) ( x 0 x ^ k ) T ,
and substituting Equation (17) into Equation (18) yields
x ^ k = E [ f ( x k 1 , u k 1 ) + w k 1 ] .
Since w k 1 is assumed to be zero-mean and independent of past measurements, we obtain
x ^ k = E [ f ( x k 1 , u k 1 ) + w k 1 ] = f ( x k 1 , u k 1 ) p ( x k 1 | Y k 1 ) d x k 1 = f ( x k 1 , u k 1 ) × N ( x k 1 ; x ^ k 1 | k 1 , P k 1 | k 1 ) d x k 1 ,
where N is a symbol for the Gaussian density, Y k 1 = [ u i , z i ] , i = 1 k 1 indicates the input measurement from 1 to k 1 , and p ( x k 1 | Y k 1 ) is the old posterior density at time k 1 ,
Similarly, we can obtain the error covariance P k 1 :
P k = E ( x 0 x ^ k ) ( x 0 x ^ k ) T = f ( x k 1 , u k 1 ) f T ( x k 1 , u k 1 ) × N ( x k 1 ; x ^ k 1 | k 1 , P k 1 | k 1 ) d x k 1 x ^ k | k 1 x ^ k 1 | k 1 T + Q k 1 ,
Step 2: Time Update
In order to avoid the non-positive definite phenomenon of the system state covariance array caused by using Cholesky decomposition in traditional CKF, singular value decomposition (SVD) is adopted instead of Cholesky decomposition in this paper. Calculate the cubature point:
P k 1 = U k 1 S k 1 0 0 0 U k 1 T , x k i = U k 1 S k 1 ξ i + x ^ k , i = 1 , 2 , , 2 n , ξ i = n [ 1 ] i , i = 1 , 2 , , 2 n , n [ 1 ] i , i = n + 1 , n + 2 , , 2 n ,
where S k 1 is a diagonal matrix, cubature point ξ i , n represents the state variable dimension, n = 12 according to Section 3.1, [ 1 ] i denotes the column i of [ 1 ] , and [ 1 ] is a symmetric matrix with a dominant diagonal line of 1.
Propagate the cubature point:
x k + 1 | k i = f ( x k i ) ,
The state variable predicted values and error covariance predicted values are
x ^ k + 1 | k = 1 2 n i = 1 2 n x k + 1 | k i , P k + 1 | k = 1 2 n i = 1 2 n x k + 1 | k i ( x k + 1 | k i ) T x k + 1 | k ^ ( x k + 1 | k ^ ) T + Q ,
Step 3: Measurement Update
Perform the matrix decomposition with SVD and calculate the cubature point:
P k + 1 | k = U k + 1 | k S k + 1 | k 0 0 0 U k + 1 | k T , x k + 1 | k = U k + 1 | k S k + 1 | k ξ i + x ^ k + 1 | k ,
Propagate the cubature point:
z k + 1 | k i = h ( x k + 1 | k i ) ,
Calculate the measured predicted values:
z ^ k + 1 = 1 2 n i = 1 2 n z k + 1 i ,
The measurement error covariance and cross-covariance at time k+1 have the following forms:
P k + 1 z = 1 2 n i = 1 2 n z k + 1 i ( z k + 1 i ) T z k + 1 i ^ ( z k + 1 i ) T + R , P k + 1 x z = 1 2 n i = 1 2 n x k + 1 i ( z k + 1 i ) T x k + 1 ^ ( z k + 1 ^ ) T ,
The Kalman gain, states, and error covariance are expressed as follows:
K k + 1 = P k + 1 x z ( P k + 1 x y ) 1 , x ^ k + 1 = x ^ k + 1 | k + K k + 1 ( z k + 1 z ^ k + 1 ) , P k + 1 = P k + 1 | k K k + 1 P k + 1 Z K k + 1 T ,

4. State Estimation Based on Nonlinear/Non-Gaussian Systems

4.1. CPF Algorithm

The underwater motion of the ROV is affected by various environmental factors, such as wind, waves, and currents. The complex relationship between these disturbance variables results in a non-Gaussian noise distribution, which cannot be handled by the classical Kalman filter. Therefore, it is difficult to meet the actual system’s requirements, and the Kalman filter fails to achieve optimal estimation performance.
In nonlinear and non-Gaussian systems, the particle filtering algorithm can approximate the posterior probability density of random variables satisfying any distribution (Gaussian or non-Gaussian) and state (linear or nonlinear) as the number of particles increases. However, the importance density function of traditional particle filtering is the state transfer probability function, which does not consider the latest quantitative information. As a result, the particles are prone to degeneracy. To alleviate this problem, the cubature Kalman filter is applied to the particle filtering framework.
At time step k, the CKF algorithm is employed to compute the mean and variance of the importance density function based on the observed data. A new posterior probability density distribution is then generated, which can generate new particles. The weights of the particles are calculated, normalized, and resampled to complete the state estimation process.
The importance density distribution used in the PF is designed by the CKF algorithm, which is obtained by the calculations described in Section 3.2.
q ( x ^ k | k i | x ^ k | k 1 i , z k ) = N ( x ^ k | k i , P k | k i ) ,
where N is the total number of particles, which is sampled from the importance function at moment k:
x k i N ( x ^ k | k i , P k | k i ) ,
When i = 1 , 2 , N , calculate the importance weights of the particles again and normalize:
w k i = p ( x k | X k i ) p ( x k i | x k 1 i ) q ( x ^ k | k i | x ^ k | k 1 i , z k ) , w k i ¯ = w k i [ i = 1 N w k i ] 1 ,
When the weights of the particles fall below the designated threshold, the particles are resampled, resulting in N particles with equal weights ( X k i , 1 N ) . Calculate state estimates as follows:
x ^ k | k = 1 N i = 1 N x k i , P ^ k | k = 1 N i = 1 N ( x k i x ^ k | k ) ( x k i x k | k ^ ) T ,

4.2. MOGCPF

In this paper, we propose a modified algorithm, MOGCPF, based on the CPF algorithm. CPF leverages the CKF to obtain a Gaussian distribution, which is used as the importance density function. However, in practice, the importance density function cannot always be accurately approximated by a Gaussian distribution, which limits the accuracy of CPF. To address this issue, we leverage MOG, which can approximate any posterior probability density. By selecting appropriate mixture components, we obtain an improved approximation for the importance density function, which enhances the accuracy of the MOGCPF algorithm.
In the framework of CPF, using the MOG approximation, the posterior density of states and the densities of process and measurement noise at moment k are assumed to be approximated as follows:
p G ( x k | z k ) = i = 1 G w k i N ( x k ; u k i , P k i ) , p G ( v k ) = a = 1 T r k a N ( v k ; u v , k a , Q k a ) , p G ( q k + 1 ) = m = 1 M γ k + 1 m N ( q k + 1 ; u r , k + 1 m , R k + 1 m ) ,
where G is the number of mixed components; ω i is mixed weights. The MOG-approximated predicted density p G ( x k | z k ) of states at time k + 1 is
p G ( x k + 1 | z k ) = p ( x k + 1 | x k ) p ( x k | z k ) d x k , r = 1 K i = 1 G w k i r k i × N ( x k + 1 ; f ( x k ) + u v , k b , Q k b ) × N ( x k + 1 ; f ( x k ) + u k i , P k i ) d x k ,
where G = G K , i = 1 , 2 , , G , r = 1 , 2 , , K , i = 1 , , G , with mixed weights w k + 1 i
w k + 1 i = w k i r k i i = 1 G r = 1 K w k i r k i ,
During the CKF time update,
x k i = u k i , S k i = P k i ,
Calculate the cubature point (l is the number of dimensions):
X l , k i = S k i n [ I ] l + x l , k i , X l , k + 1 i = f ( X l , k i ) + u v , k b , x ^ k + 1 | k i = 1 2 n i = 1 2 n X l , k + 1 i , P k + 1 | k i = 1 2 n i = 1 2 n X l , k + 1 i ( X l , k + 1 i ) T x ^ k + 1 | k i ( x ^ k + 1 | k i ) T + Q k b ,
and let u k + 1 i = x k | k + 1 i , P k + 1 i = P k + 1 | k i ; thus, the MOG of the prior density function is
p G ( x k + 1 | z k ) = i = 1 G w k + 1 i N ( x k ; u k + 1 i , P k + 1 i ) ,
Similarly, in the CKF measurement update phase, the posterior density function
p G ( x k + 1 | z k ) = i = 1 G w k + 1 i N ( x k ; u k + 1 i , P k + 1 i ) ,
It can be seen that in the time update, the Gaussian component increases from G to G , and the Gaussian component increases from G to G in the measurement update; as the estimation process proceeds, it leads to an increasing amount of computation, so it is necessary to reduce G to G during resampling.

4.3. EM-MOGCPF

The EM algorithm [28] is used on the basis of MOGCPF to calculate MOG parameters in the set of importance-sampled particles, which reduces G n to G, improves the problem of particle sample degradation, and reduces the computational effort. The algorithm flow is shown in Figure 4.
The mixture weights for each model are set to w g = 1 G , the mean u g is set to a random number, the covariance matrix P g is set to a unit matrix, and we calculate P g , w g and take the proportion of each type of sample to the total number of samples:
ρ = [ ( w 1 , u 1 , P 1 ) , ( w 2 , u 2 , P 2 ) , , ( w i , u i , P i ) , ] ( i = 1 , , G ) ,
Calculate r 1 ( x k ) , r 2 ( x k ) , , r i ( x k ) , k = 1 , 2 , , N by ρ .
r i ( x k ) = α i N ( x k ; u i , P i ) i = 1 G α i N ( x k ; u i , P i ) ,
Obtain the new mean u ^ i , variance P i ^ , and mixture weights w i ^ :
u ^ i = k = 1 N r i ( x k ) x k k = 1 N r i ( x k ) , P i ^ = k = 1 N r i ( x k ) ( x k u ^ i ) ( x k u ^ i ) T k = 1 N r i ( x k ) , w i ^ = 1 N k = 1 N r i ( x k ) ,
Let ρ ^ = [ ( w ^ 1 , u ^ 1 , P ^ 1 ) , ( w ^ 2 , u ^ 2 , P ^ 2 ) , , ( w ^ i , u ^ i , P ^ i ) , ] ; the iteration stops when | ρ ρ ^ | < v (v is a minimum value); otherwise, obtain ρ = ρ ^ and return to Equation (42) to calculate r i ( x k ) .
When w k + 1 i = w ^ i , u k + 1 i = u ^ i , P k + 1 i = P ^ i , obtain the new posterior density:
p G ( x k + 1 | z k + 1 ) = i = 1 G w k + 1 i N ( x k + 1 ; u k + 1 i , P k + 1 i ) ,
from the EM algorithm; we can observe a reduction in the number of mixture components, G n to G, which has the effect of reducing the posterior probability density at moment k + 1 .
State estimate at moment k + 1 :
x ^ k + 1 = i = 1 G w k + 1 i u k + 1 i , P ^ k + 1 = i = 1 G w k + 1 i [ P k i + ( u k + 1 i x ^ k + 1 ) ( u k + 1 i x ^ k + 1 ) T ] ,

5. Experimental and Analysis

5.1. Experimental Settings

The ROV is measured to have a mass of 26 kg; moment of inertia I z = 1.04 kg · m2. The buoyancy and gravity counterweights are balanced. Meanwhile, the overall structure of the ROV designed in this paper is symmetrical front-to-back, up-and-down, and left-to-right, with the center of gravity coordinates as the origin of the coordinate axis.
By the above analysis and calculation, we can obtain the rigid-body matrix:
M R B = 26 0 0 0 0 26 0 0 0 0 26 0 0 0 0 1.04 ,
The added mass matrix:
M A = 24.56 0 0 0 0 34.27 0 0 0 0 39.19 0 0 0 0 2.01 ,
The linear hydrodynamic damping matrix:
D L = 30.57 0 0 0 0 42.21 0 0 0 0 89.10 0 0 0 0 0.028 ,
The nonlinear hydrodynamic damping matrix:
D N L ( V ) = 97.43 0 0 0 0 79.39 0 0 0 0 117.40 0 0 0 0 1.25 ,
The evaluation index adopted in this study is the root mean square error (RMSE), which represents the square root of the ratio of the squared difference between the predicted and true values to the number of observations N. The RMSE value serves as a measure of the model’s performance, with smaller values indicating more accurate prediction results. The calculation formula for RMSE is presented below:
R M S E = 1 N i = 1 N ( y ^ y ) 2 2 ,
where N is the total number of samples, y ^ is the predicted attitude of the ROV, and y is the ROV’s actual attitude.
Due to the complexity of simulating the real state of the anchor chain underwater, it is necessary to approximate the anchor chain as a suspension line. The suspension line can be described by the general equation
y = a c o s h ( x a 1 ) ,
where a is the distance from the vertex of the curve to the horizontal coordinate.
The motion state of the ROV is influenced by varying sea states, which are presented in Table 2 [29] below. The strength of ROV interference increases as the sea state degree increases. When the sea state degree is 0, the impact of waves and sea wind can be mostly disregarded, and only the influence of ocean currents needs to be considered. Therefore, a Gaussian noise model can be assumed during this time. Conversely, when the sea state degrees are 1–3, the impact of waves, sea wind, and ocean currents must be taken into account, and a non-Gaussian noise model should be used.
State vector x ^ = 0 , covariance matrix p 0 = d i a g [ 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 , 0.3 ] , T = 200 , particles N = 300 , anchor chain length a = 60.845 . Our proposed algorithm is subjected to comparison with CKF, CPF, and PF.

5.2. Results and Discussion

5.2.1. Sea State Degree: 0

At a sea state degree of 0, the surface of the sea is calm with no wind or waves. The only external noise present is caused by underwater currents, and it is assumed that this noise follows a Gaussian distribution. Process noise w k N ( 0 , Q ) , measurement noise v k N ( 0 , R ) , R = d i a g [ 0.3 , 0.2 , 0.3 , 0.05 ] , Q = d i a g [ 0 , 0 , 0 , 0 , 3 , 4 , 5 , 0.02 , 2 , 2 , 2 , 0.5 ] .
Figure 5 and Figure 6 present the errors in the estimated displacement and velocity of the ROV using the proposed algorithm, as well as three other algorithms: CPF, CKF, and PF. It is evident that the PF algorithm suffers from particle degradation over time, which leads to a decrease in estimation accuracy and filter divergence. On the other hand, the estimation accuracy of CKF in the presence of Gaussian noise is consistent with expectations, and CPF effectively addresses the particle degradation issue by using CKF for importance density function calculation. Consequently, the proposed algorithm outperforms the other algorithms at a sea state of 0.

5.2.2. Sea State Degree: 1−2

There is a light breeze and smooth wavelet on the sea surface at a sea state of 1–2, and the measurement noise is non-Gaussian distributed, v k 1.875 N ( 0 , R ) + 0.04 N ( 0.357 R ) , R = d i a g [ 0.4 , 0.3 , 0.3 , 0.4 ] . Figure 7 and Figure 8 demonstrate that the CKF algorithm diverges in both the XYZ axis and yaw angle estimation when the noise distribution is non-Gaussian. This indicates that CKF is only suitable for Gaussian noise environments. Furthermore, in the estimation of Y and Z axis displacement, particle degradation gradually occurs in PF after a certain period of time. The importance density function of CPF cannot always be approximated by a Gaussian distribution, as evidenced by the small divergence observed at sea state levels 1–2. Hence, the proposed algorithm shows improved noise immunity by incorporating a mixed Gaussian model. Overall, the results suggest that the algorithm presented in this paper outperforms CKF, PF, and CPF under mixed noise conditions.

5.2.3. Sea State Degree: 3

A sea state of 3 represents the maximum sea state in which an ROV can operate effectively. Beyond this level, the use of an ROV is not recommended. In such challenging environments, the benefits of the improved algorithm become apparent. Moreover, when the sea surface is affected by slight waves and a gentle breeze, the measurement noise follows a non-Gaussian distribution, v K 0.1 N ( 0 , R 1 ) + 0.9 N ( 0 , 150 R 2 ) , R 1 = d i a g [ 0.4 , 0.3 , 0.3 , 0.4 ] , R 2 = d i a g [ 0.2 , 0.2 , 0.1 , 0.003 ] . In Figure 9 and Figure 10, it is evident that the estimation error of the CKF algorithm increases as the sea state level rises and the external noise becomes more complex. The filter exhibits multiple divergences in these scenarios. Specifically, when estimating the Z-axis displacement and bow angle, the CKF algorithm’s error is even larger than that of the PF algorithm, which suffers from particle degradation and multiple outliers in the estimation due to its inability to consider the latest measurement information. Moreover, the complexity of the noise model makes it difficult to approximate the mixed Gaussian noise using only a single Gaussian distribution.
The CPF algorithm’s error starts to increase when estimating the X-axis displacement after T > 100 s, and when estimating the Y-axis displacement after T > 40 s, indicating that CPF cannot guarantee estimation accuracy over a long time. On the other hand, the algorithm proposed in this paper not only has no outliers, but also avoids divergence in long-term estimates, while significantly improving the accuracy compared to other algorithms.
Table 3 and Figure 11 and Figure 12 demonstrate that the RMSE values of x , y , z , ψ attitudes can be found.
(1)
In sea state degree 0, the particle filtering has a maximum RMSE in all four attitudes due to the appearance of particle degeneracy. The CKF algorithm performs better than the particle filtering algorithm in a Gaussian noise environment. CPF reduces particle degradation after importance density sampling with CKF, and the estimation accuracy is improved by 55.37 % , 49.35 % , 82.06 % , 40.41 % in x , y , z , ψ compared to particle filtering, respectively. This indicates that CPF was able to solve the particle degradation problem. The algorithm EM-MOGCPF proposed in this paper has the best estimation accuracy, compared with the best phenotypic performance of CPF, and the four attitudes were improved by 32.06 % , 27.5 % , 24.76 % , 38.77 % , respectively.
(2)
In sea state degree 1–2, underwater noise is non-Gaussian distributed under the influence of wind and waves. The RMSE of the CKF algorithm is slightly greater than that of particle filtering for the x-axis and yaw angular ψ estimates. CKF’s estimation accuracy decreases and it is not suitable for state estimation under non-Gaussian noise. Although CPF combines the applicability of particle filtering for non-Gaussian noise, it is applicable to a single noise model; the EM-MOGCPF algorithm incorporates the MOG model, which effectively improves the estimation accuracy under mixed noise.
(3)
As the sea state degree rises to 3, the RMSE of CKF in three attitudes is greater than that of particle filtering; it shows that as the noise environment becomes more complex, the accuracy of CKF estimation is worsened. Similarly, the performance of CPF at this sea degree is also poor. By comparison, the estimation accuracy of EM-MOGCPF is also the highest among the four algorithms. RMSE does not show large values as the sea degree increases, and it has good noise immunity in complex environments. Compared to CPF, which has the best relative stability, the accuracy is improved by 53.67 % , 81.37 % , 81.26 % , 68.47 % . This shows that EM-MOGCPF has good estimation accuracy even at the maximum operating conditions.

6. Conclusions

In this paper, we propose the EM-MOGCPF algorithm, an improved state estimation approach based on the CPF framework, for underwater robots operating in environments with nonlinear and non-Gaussian noise distributions. Our algorithm leverages a hybrid Gaussian model to approximate the significant type density function, and employs the EM algorithm instead of traditional resampling to mitigate the particle degradation problem. We also use a modified algorithm for underwater anchor chain cleaning robot observation, and validate the performance of the algorithm under three different sea state conditions. Our experimental results demonstrate that the proposed algorithm can accurately estimate the robot state and achieve strong convergence even in the presence of different noise distributions, while effectively resisting the influence of noise. The algorithm exhibits good environmental adaptability and can address the problem of robot state estimation in underwater nonlinear and non-Gaussian environments. Moreover, the proposed algorithm can be applied to other state estimation fields.
Future research includes developing a simulation platform for underwater robot state observation, exploring underwater robot models with more degrees of freedom and parameter estimation, and conducting additional underwater experiments to further evaluate the real-time performance and accuracy of the algorithm.

Author Contributions

Conceptualization, C.C. and B.W.; methodology, C.C. and B.W.; software, C.C. and Y.Z.; validation, B.W. and Z.J.; formal analysis, B.W. and C.C.; writing—original draft preparation, B.W. and C.C.; writing—review and editing, B.W. and C.C.; visualization, C.C.; supervision, Z.J. and B.W. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the Shanghai Science and Technology Commission Innovation Action Plan Project [20dz1206500].

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Acknowledgments

The authors are grateful for the support of the Shanghai Engineering Research Center of Hadal Science and Technology, Shanghai Ocean University, Shanghai, China.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Li, X.; Zhao, M.; Ge, T. A nonlinear observer for remotely operated vehicles with cable effect in ocean currents. Appl. Sci. 2018, 8, 867. [Google Scholar] [CrossRef]
  2. Soylu, S.; Proctor, A.A.; Podhorodeski, R.P.; Bradley, C.; Buckham, B.J. Precise trajectory control for an inspection class ROV. Ocean Eng. 2016, 111, 508–523. [Google Scholar]
  3. Chen, S.; Lin, T.; Jheng, K.; Wu, C. Application of fuzzy theory and optimum computing to the obstacle avoidance control of unmanned underwater vehicles. Appl. Sci. 2020, 10, 6105. [Google Scholar] [CrossRef]
  4. Jin, X.B.; Robert Jeremiah, R.J.; Su, T.L.; Bai, Y.T.; Kong, J.L. The new trend of state estimation: From model-driven to hybrid-driven methods. Sensors 2021, 21, 2085. [Google Scholar] [CrossRef] [PubMed]
  5. Julier, S.; Uhlmann, J.; Durrant-Whyte, H.F. A new method for the nonlinear transformation of means and covariances in filters and estimators. IEEE Trans. Autom. Control 2000, 45, 477–482. [Google Scholar]
  6. Dong, L.; Xu, H.; Feng, X.; Han, X.; Yu, C. An adaptive target tracking algorithm based on EKF for AUV with unknown Non-Gaussian process noise. Appl. Sci. 2020, 10, 3413. [Google Scholar] [CrossRef]
  7. Han, H.; Wei, Y.; Ye, X.; Liu, W. Motion Planning and Coordinated Control of Underwater Vehicle-Manipulator Systems with Inertial Delay Control and Fuzzy Compensator. Appl. Sci. 2020, 10, 3944. [Google Scholar] [CrossRef]
  8. Zheng, X.; Tian, Q.; Zhang, Q. Development and Control of an Innovative Underwater Vehicle Manipulator System. J. Mar. Sci. Eng. 2023, 11, 548. [Google Scholar]
  9. Li, M.; Mourikis, A.I. High-precision, consistent EKF-based visual-inertial odometry. Int. J. Robot. Res. 2013, 32, 690–711. [Google Scholar] [CrossRef]
  10. Gustafsson, F.; Hendeby, G. Some relations between extended and unscented Kalman filters. IEEE Trans. Signal Process. 2011, 60, 548. [Google Scholar]
  11. Menegaz, H.M.T.; Ishihara, J.Y. Unscented and square-root unscented Kalman filters for quaternionic systems. Int. J. Robust Nonlinear Control 2018, 28, 4500–4527. [Google Scholar] [CrossRef]
  12. Arasaratnam, I.; Haykin, S. Cubature kalman smoothers. Automatica 2011, 47, 2245–2250. [Google Scholar] [CrossRef]
  13. Rundtop, P.; Frank, K. Experimental evaluation of hydroacoustic instruments for ROV navigation along aquaculture net pens. Aquac. Eng. 2016, 74, 143–156. [Google Scholar] [CrossRef]
  14. Zhao, Y. Performance evaluation of cubature Kalman filter in a GPS/IMU tightly-coupled navigation system. Signal Process. 2016, 119, 67–79. [Google Scholar] [CrossRef]
  15. Chen, S.; Xiong, X.; Wen, Y.; Jian, J.; Huang, Y. State Compensation for Maritime Autonomous Surface Ships’ Remote Control. J. Mar. Sci. Eng. 2023, 11, 450. [Google Scholar] [CrossRef]
  16. Walia, G.S.; Kumar, A.; Saxena, A.; Sharma, K.; Singh, K. Robust object tracking with crow search optimized multi-cue particle filter. Pattern Anal. Appl. 2020, 23, 1439–1455. [Google Scholar] [CrossRef]
  17. Santos, N.P.; Lobo, V.; Bernardino, A. Unmanned aerial vehicle tracking using a particle filter based approach. In Proceedings of the 2019 IEEE Underwater Technology (UT), Kaohsiung, Taiwan, 16–19 April 2019. [Google Scholar]
  18. Zhao, Z.; Yao, P.; Wang, X.; Xu, J.; Wang, L.; Yu, J. Reliable flight performance assessment of multirotor based on interacting multiple model particle filter and health degree. Chin. J. Aeronaut. 2019, 32, 444–453. [Google Scholar] [CrossRef]
  19. Zhang, T.; Liu, S.; Xu, C.; Liu, B.; Yang, M.H. Correlation particle filter for visual tracking. IEEE Trans. Image Process. 2017, 27, 2676–2687. [Google Scholar] [CrossRef]
  20. Jing, Y.; Chen, Y. Distributed Color-Based Particle Filter for Target Tracking in Camera Network. In Proceedings of the Collaborative Computing: Networking, Applications and Worksharing: 16th EAI International Conference, Shanghai, China, 16–18 October 2020. [Google Scholar]
  21. Huang, T.; Peng, H.; Zhang, K. Model selection for Gaussian mixture models. Stat. Sin. 2017, 147–169. [Google Scholar] [CrossRef]
  22. Kotecha, J.H.; Djuric, P.M. Gaussian sum particle filtering. IEEE Trans. Signal Process 2003, 51, 2602–2612. [Google Scholar] [CrossRef]
  23. Ulmschneider, M.; Gentner, C.; Jost, T.; Dammann, A. Rao-Blackwellized Gaussian sum particle filtering for multipath assisted positioning. J. Electr. Comput. Eng. 2018, 2018. [Google Scholar] [CrossRef]
  24. Bilik, I.; Tabrikian, J. MMSE-based filtering in presence of non-Gaussian system and measurement noise. IEEE Trans. Aerosp. Electron. Syst. 2010, 46, 1153–1170. [Google Scholar] [CrossRef]
  25. Zhang, Y.; Ai, Q.; Li, Z. Improving aggregated baseline load estimation by Gaussian mixture model. Energy Rep. 2020, 6, 1221–1225. [Google Scholar] [CrossRef]
  26. Bilik, I.; Tabrikian, J. Optimal recursive filtering using MOG. In Proceedings of the IEEE/SP 13th Workshop on Statistical Signal Processing, Bordeaux, France, 17–20 July 2005. [Google Scholar]
  27. Coates, E.M.; Reinhardt, D.; Fossen, T.I. Reduced-attitude control of fixed-wing unmanned aerial vehicles using geometric methods on the two-sphere. IFAC-PapersOnLine 2020, 53, 5749–5756. [Google Scholar] [CrossRef]
  28. Hosseini, R.; Sra, S. An alternative to EM for Gaussian mixture models: Batch and stochastic Riemannian optimization. Math. Program. 2020, 181, 187–223. [Google Scholar] [CrossRef]
  29. Gouldby, B.; Méndez, F.J.; Guanche, Y.; Rueda, A.; Mínguez, R. A methodology for deriving extreme nearshore sea conditions for structural design and flood risk analysis. Coast. Eng. 2014, 88, 15–26. [Google Scholar] [CrossRef]
Figure 1. This is an ROV 3D model that has an electrical machine, regulating device, electronic module, and buoyancy material.
Figure 1. This is an ROV 3D model that has an electrical machine, regulating device, electronic module, and buoyancy material.
Applsci 13 05885 g001
Figure 2. The ROV is designed to operate on the mooring line.
Figure 2. The ROV is designed to operate on the mooring line.
Applsci 13 05885 g002
Figure 3. ROV coordinate system.
Figure 3. ROV coordinate system.
Applsci 13 05885 g003
Figure 4. EM-MOGCPF algorithm.
Figure 4. EM-MOGCPF algorithm.
Applsci 13 05885 g004
Figure 5. XYZ-axis and yaw angular error at sea state of 0. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Figure 5. XYZ-axis and yaw angular error at sea state of 0. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Applsci 13 05885 g005
Figure 6. XYZ-axis and yaw angular velocity error at sea state of 0. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Figure 6. XYZ-axis and yaw angular velocity error at sea state of 0. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Applsci 13 05885 g006
Figure 7. XYZ-axis and yaw angular error at sea state of 1–2. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Figure 7. XYZ-axis and yaw angular error at sea state of 1–2. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Applsci 13 05885 g007
Figure 8. XYZ-axis and yaw angular velocity error at sea state of 1–2. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Figure 8. XYZ-axis and yaw angular velocity error at sea state of 1–2. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Applsci 13 05885 g008
Figure 9. XYZ- axis and yaw angular error at sea state of 3. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Figure 9. XYZ- axis and yaw angular error at sea state of 3. (a) X-axis position estimation error; (b) Y-axis position estimation error; (c) Z-axis position estimation error; (d) Yaw angular position estimation error.
Applsci 13 05885 g009
Figure 10. XYZ- axis and yaw angular velocity error at sea state of 3. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Figure 10. XYZ- axis and yaw angular velocity error at sea state of 3. (a) X-axis velocity estimation error; (b) Y-axis velocity estimation error; (c) Z-axis velocity estimation error; (d) Yaw angular velocity estimation error.
Applsci 13 05885 g010
Figure 11. RMSE of sea state degree 0.
Figure 11. RMSE of sea state degree 0.
Applsci 13 05885 g011
Figure 12. (a) RMSE of sea state degree 1–2, (b) RMSE of sea state degree 3.
Figure 12. (a) RMSE of sea state degree 1–2, (b) RMSE of sea state degree 3.
Applsci 13 05885 g012
Table 1. Definition of motion parameters.
Table 1. Definition of motion parameters.
DOFMotionsForces and MomentsLinear and Angular VelocitiesPosition and Euler Angles
1SurgeXux
2SwayYvy
3HeaveZwz
4YawNr ψ
Table 2. State of the sea.
Table 2. State of the sea.
DegreeWindWind Speed (m/s)WaveWave Height (m)
0Calm0−0.2Calm glassy/
1Light air0.3−1.5Calm rippled0−0.1
2Light breeze1.6−3.3Smooth wavelet0.1−0.5
3Gentle breeze3.4−5.4Slight0.5−1.25
Table 3. RMSE of different algorithms in three sea states.
Table 3. RMSE of different algorithms in three sea states.
Simulation CaseAttitudePFCKFCPFEM-MOGCPF
Sea state degree: 0X1.85771.06180.82910.5633
Y1.22320.96020.72970.5290
Z3.82940.88270.68710.5140
ψ 2.52011.51641.50180.9196
Sea state degree: 1–2X0.82891.10100.66110.4392
Y2.69401.43070.81250.3738
Z6.99083.90501.03630.4771
ψ 1.65411.72590.88490.4083
Sea state degree: 3X2.16903.50371.28550.5956
Y7.51295.01901.66070.3094
Z5.965210.94003.37080.6318
ψ 8.707014.60106.77362.1357
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

Wang, B.; Chen, C.; Jiang, Z.; Zhao, Y. ROV State Estimation Using Mixture of Gaussian Based on Expectation-Maximization Cubature Particle Filter. Appl. Sci. 2023, 13, 5885. https://doi.org/10.3390/app13105885

AMA Style

Wang B, Chen C, Jiang Z, Zhao Y. ROV State Estimation Using Mixture of Gaussian Based on Expectation-Maximization Cubature Particle Filter. Applied Sciences. 2023; 13(10):5885. https://doi.org/10.3390/app13105885

Chicago/Turabian Style

Wang, Biao, Chunhao Chen, Zhe Jiang, and Yu Zhao. 2023. "ROV State Estimation Using Mixture of Gaussian Based on Expectation-Maximization Cubature Particle Filter" Applied Sciences 13, no. 10: 5885. https://doi.org/10.3390/app13105885

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