Next Article in Journal
Multiphysics Co-Simulation and Experimental Study of Deep-Sea Hydrothermal Energy Generation System
Previous Article in Journal
Small-Scale Model Experiments on Plastic Fragment Removal from Water Flows Using Multiple Filters in a Floating Body
Previous Article in Special Issue
Comparative Analysis of 3D LiDAR Scan-Matching Methods for State Estimation of Autonomous Surface Vessel
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Path Planning Method for Underwater Gravity-Aided Inertial Navigation Based on PCRB

School of Instrument Science and Engineering, Southeast University, Nanjing 210096, China
*
Author to whom correspondence should be addressed.
J. Mar. Sci. Eng. 2023, 11(5), 993; https://doi.org/10.3390/jmse11050993
Submission received: 5 April 2023 / Revised: 27 April 2023 / Accepted: 3 May 2023 / Published: 7 May 2023
(This article belongs to the Special Issue Navigation and Localization for Autonomous Marine Vehicle)

Abstract

:
Gravity-aided inertial navigation system (GAINS) is an important development in autonomous underwater vehicle (AUV) navigation. An effective path planning algorithm plays an important role in the performance of navigation in long-term underwater missions. By combining the gravity information obtained at each position with the error information from the INS, the posterior Cramér-Rao bound (PCRB) of GAINS is derived in this paper. The PCRB is the estimated lower bound of position variance for navigation along the planned trajectory. And the sum of PCRB is used as the minimum cost from the initial state to the current state in the state space, and the position error prediction variance of inertial navigation system (INS) is used as the minimum estimated cost of the path from the current state to the goal state in the A* algorithm. Thus, a path planning method with optimal navigation accuracy is proposed. According to simulation results, traveling along the path planned by the proposed method can rapidly improve the positioning accuracy while consuming just slightly more distance. Even when measuring noise changes, the planned path can still maintain optimal positioning accuracy, and high positioning accuracy is possible for any trajectory located within a certain range of the planned path.

1. Introduction

Autonomous underwater vehicles (AUV) usually use the Inertial Navigation System (INS) as their primary navigation device, but INS requires regular calibration to be able to perform long-term missions. In underwater situations, traditional navigation methods (e.g., GPS) are greatly limited due to the complexity and variability of the underwater environment [1,2,3]. In contrast, the Gravity-Aided Inertial Navigation System (GAINS) is an advanced technology used for underwater navigation that enables highly accurate position estimation without emitting or receiving signals. To achieve this objective, GAINS utilizes a specially designed navigation algorithm to compare the gravimeter’s measurements of gravity anomalies at the current position with the stored gravity field data to effectively correct the INS position [4,5,6,7].
As the variability of the gravity field significantly affects the performance of GAINS [8,9], the use of gravity navigation in order to make path planning for UAVs is crucial.In this regard, previous researchers have explored several characteristics to describe the gravity field information, such as variance, roughness, slope, coefficient of variation, fractal dimensions, and their combination to determine the efficiency of using the gravity field for navigation [10,11,12]. Based on empirical thresholds, the gravity map is divided by its characteristics into two categories: informative (suitable for positioning) and non-informative (not suitable for positioning) [13]. Then, by treating non-informative areas as obstacles, the path planning problem can be transformed into a sequence optimization problem [14,15]. There are many optimization methods available to solve this problem, including genetic algorithms, simulated annealing algorithms, ant colony algorithms, particle swarm algorithms, etc. [16,17,18,19,20]. However, the assumption that non-informative areas are restricted regions and entering these areas will result in significant positioning errors does not apply to UAV navigation situations. For example, flat areas are not suitable for gravity navigation, but there are no real obstacles, and, even relying solely on INS, it is possible to safely navigate through them. Furthermore, research suggests that areas suitable for positioning based on local characteristics are typically discrete and small, making it difficult to find connected informative areas [13,21,22,23]. As a result, it is impossible to use obstacle avoidance path planning methods for path planning in any sea area, especially when the starting or target points are surrounded by non-informative regions.
The main purpose of the planning method in this study is to find a path that minimizes the positioning error between the starting and ending points and can be carried out in any sea area. It is necessary to compare the filtering results along different trajectories to determine the optimality of the planned path. The posterior Cramér-Rao bound (PCRB) integrates information from kinetics and measurement models; therefore, it comprises all sensor-obtained gravity field information without the need for actually implementing the filtering algorithm [24,25,26,27,28,29,30]. A* algorithm is one of the most common heuristic search algorithms, swiftly investigating a possible set of solutions for a given issue using heuristic search techniques, focusing more on the end answer than on sub-problems, which enables it to produce pathways fast and with improved results [31,32]. This study uses PCRB as the cost function of A*, precisely fusing the path planning and navigation filter estimation results. The characteristics of the gravity fields at departure and destination are not limitations on the proposed path-planning method. This study doe not add distance directly to the cost or heuristic function like most shortest path trajectory designs do. Instead, the distance factor is included in the INS error divergence variance. Hence, this method can plan the quickest path while maintaining positioning accuracy.
The following is the arrangement of this paper: Section 2 derives the PCRB model of GAINS, and Section 3 combines PCRB with A* to form the PCRB-based A* path planning method. In Section 4, two simulation tests were conducted to prove the optimality of the two planned paths. Finally, conclusions are given in Section 5.

2. PCRB for Gravity-Aided Navigation System

In most cases, GAINS is modeled as a hidden Markov model (HMM), as shown in Figure 1, i.e., the observation depends only on the state of the Markov chain at that moment, independent of the other states; the current moment state is related only to the previous moment.
The mathematical model of GAINS can be reduced to the following two discrete-time equations.The first equation describes the evolution of the state vector, i.e., the INS error propagation process
x t + 1 = x t + u t + v t
where x t is the state vector indicating the carrier position. u t represents the state increment of INS. v t represents the state noise from IMU measurement error, Gaussian distribution, and with covariance matrix Q t .
The second equation describes the observed values of the gravity sensor and the comparison with the reference map values by interpolation
y t = h x t + ε t x t + w t
where y t is the measurement of the gravimeter at time t, and h denotes the interpolation method of the gravity sensors model combined with the reference data map, usually sampling bilinear or Kriging interpolation. w t denotes the measurement noise of the geophysical sensor, which is assumed to be additive Gaussian white noise. ε t denotes the reference data mapping error. Considering this error covariance depending on the location, the variance matrix of the total observation error is modeled as (3) [33].
R t = σ m 2 + C 0 β 2 δ 4 4 + σ g 2
where R t includes a combination of sensor measurements and map uncertainty. δ is the map spatial resolution, and σ m 2 is the map mapping error variance. C 0 is the variance of the local gravity anomaly. β is the inverse of the square of the correlation distance, and σ g 2 is the gravimeter measurement error variance.
Under the assumption of additive Gaussian white noise, v t and w t , are assumed to be independent of each other, and independent of x 0 . (1) and (2) explicitly determine the joint probability distribution p ( X t , Y t ) of X t ( x 0 , , x t ) and Y t ( y 0 , , y t ) at any moment t with a known p ( x 0 ) .
p ( X t + 1 , Y t + 1 ) = p ( X t , Y t ) · p x t + 1 X t , Y t · p y t + 1 x t + 1 , X t , Y t = p ( X t , Y t ) · p x t + 1 x t · p y t + 1 x t + 1
where p ( · ) refers to the probability density of the variables described in the parameters of p. The derivation of (4) makes use of the Markov property of the model, i.e., p x t + 1 X t , Y t = p x t + 1 x t , and p y t + 1 x t + 1 , X t , Y t = p y t + 1 x t + 1 .
PCRB is a lower bound on the mean squared error (MSE) of a deterministic parameter estimate in parameter estimation, defined as the variance of any unbiased estimate being at least larger than the inverse of the Fisher information. Whenever the estimate X ^ t is based on the sequence Y t , the mean square error for any unbiased estimator X ^ t should satisfy the following condition.
E X ^ t X t X ^ t X t T P t = J t 1
where J t is the Fisher information matrix.
J t = E Δ X t X t log p Y t , X t
where log p Y t , X t denotes the joint probability density of X t and Y t . Here and below, ∇ is the operator of the first order derivative, and Δ is the operator of the second order derivative.
Let P t | t denote the PCRB of the state x t determined for a given measurement Y t . By decomposing the lower bound (5) into subblocks, the estimated covariance of x t is lower bounded by the lower right block of P t , i.e.,
E X ^ t 1 X t 1 x ^ t x t X ^ t 1 X t 1 x ^ t x t T P t | t
Correspondingly, 
J t = E Δ X t 1 X t 1 Δ X t 1 x t Δ x t X t 1 Δ x t x t log p Y t , X t = A t B t B t T C t
From (8) it follows that
P t | t 1 = C t B t T A t 1 B t
Insert (4) into (8) to get the recursive update
J t + 1 = E Δ X t 1 X t 1 Δ X t 1 x t Δ X t 1 x t + 1 Δ x t X t 1 Δ x t x t Δ x t x t + 1 Δ x t + 1 X t 1 Δ x t + 1 x t Δ x t + 1 x t + 1 log p Y t + 1 , X t + 1 = A t B t 0 B t T C t + D t S t 0 S t T Z t
where 0 denotes the block matrix of zero entries of appropriate dimensionality.
Comparing with (9), it follows that
P t + 1 | t + 1 1 = Q t 0 S t T A t B t B t T C t + D t 1 0 S t = Z t S t T P t | t 1 + D t 1 S t
Under the assumption that the noise w n and v n of (1) and (2) are zero-mean Gaussian and invertible covariance matrices, Q t and R t , respectively, therefore,
log p x t + 1 x t = c 1 + 1 2 x t + 1 x t T Q t 1 x t + 1 x t
log p y t x t = c 2 + 1 2 y t h x t T R t 1 y t h x t
where c 1 and c 2 are constants. Thus, in the Equation (11),
D t = E Δ x t x t log p x t + 1 x t = Q t 1
S t = E Δ x t x t + 1 log p x t + 1 x t = Q t 1
Z t = E Δ x t + 1 x t + 1 log p x t + 1 x t + E Δ x t + 1 x t + 1 log p y t + 1 x t + 1 = Q t 1 + H t + 1 T R t + 1 1 H t + 1
where H t = h ( x t ) and H t is the gradient of h ( · ) at the true position at time t. In the above derivation, the expectation of both the measurement noise and the position is 0, so the expectation E is computed only at the current true position.
Bringing the Equations (14)–(16) into the Equation (11) gives
P t + 1 | t + 1 = H t + 1 T R t + 1 1 H t + 1 + Q t 1 Q t 1 P t | t 1 + Q t 1 1 Q t 1 1 = H t + 1 T R t + 1 1 H t + 1 + Q t + P t | t 1 1
The derivation of (17) makes use of the Woodbury matrix identity [34].
( A + U C V ) 1 = A 1 A 1 U C 1 + V A 1 U 1 V A 1
H t T R t 1 H t in (17) is only related to the position and represents the gravity information obtained from the map, and the square root of the trace of this matrix is used as the scalar navigation information map.
M t = t r { H t T R t 1 H t }
A further expansion of Equation (17) using the Woodbury matrix identity gives a more interesting form
P t + 1 | t = P t | t + Q t
P t + 1 | t + 1 = P t + 1 | t P t + 1 | t H t + 1 T H t + 1 P t + 1 | t H t + 1 T + R t + 1 1 H t + 1 P t + 1 | t
(20) and (21) constitute the recursive form of the PCRB for the state estimation in GAINS, where (20) is the one-step prediction covariance and (21) is the posterior filter covariance.
By linearizing the model, the recursive PCRB is consistent with the Riccati recursion of the error covariance of the Kalman filter for the system. This also indicates that the Kalman filter can obtain the optimal solution under the assumption of linear system models, and its state covariance can reach the PCRB.

3. A* Algorithm Path Planning Design Based on PCRB

The A* algorithm is a heuristic search algorithm that is recursive in nature and can follow certain steps, starting from the original state and gradually searching to the optimal solution. The A* algorithm uses the overhead G between nodes in the graph, and a heuristic function H related to the current task to find the optimal path.
F ( n ) = G ( n ) + H ( n )
where, F ( n ) is the valuation function of a node, which indicates the combined priority of that node considered in the selection of node n. G ( n ) denotes the actual generation value from the starting point to the current node. H ( n ) denotes the cost estimate of the current node to the target point, which is the prediction function.
The computation in PCRB is in the time domain and the A* algorithm works in the spatial domain. To facilitate the combination of PCRB with the A* algorithm, the coordinates at t time are assumed to be n. Correspondingly, the estimated position PCRB in n coordinates is P n | n . The INS position error dispersion is assumed to be time-dependent only, and the coefficient of linear drift of the position error variance with time is Q t . Denote the Euclidean distance from the current point ( x c , x f ) to the parent node ( x f , x f ) by d f , and denote the distance from the current point to the target node by d g to denote the Euclidean distance from the current point to the target node.
d f = ( x c x f ) 2 + ( y c y f ) 2
d g = ( x c x g ) 2 + ( y c y g ) 2
The position error uncertainty of INS grows linearly over a certain time period, and the relationship between Q n and distance is as follows.
Q n = Q t · d f / V ( n )
where V ( n ) is the average velocity of the carrier during the sampling interval.
The main goal of this paper is to identify the path that minimizes the total posterior filtering errors of navigation at each current waypoint. We accomplish this by using the PCRB P n | n at the present position n as the cost function G ( n ) for the current node in the A algorithm.
P n + 1 | n = P n | n + Q n
P n + 1 | n + 1 = P n + 1 | n P n + 1 | n H n + 1 n H n + 1 P n + 1 | n H n + 1 T + R n + 1 1 H n + 1 P n + 1 | n
(26) represents the navigation error covariance of the one-step prediction, and (27) represents the correction of the one-step prediction by the posterior information from the reweighted force measurement to obtain the PCRB. Obviously the P n | n matrix is a square matrix whose diagonal elements represent the error variance in two orthogonal directions, X direction (eastward) and Y direction (northward). In this paper, the sum of the traces of the PCRB of the localization error at each point on the trajectory is used as a metric to quantify the navigation accuracy of this path, i.e.,
G ( n + 1 ) = G ( n ) + t r { P n + 1 | n + 1 }
where t r { } means trace operation.
The heuristic function is the expected navigation error for the increase of the current position to the target position. Based on the fact that the INS position error can be considered as linearly divergent in the short term, the heuristic function is set to
H ( n ) = t r { Q t · d g / V ( n ) }
Assuming that the current node is n and the actual cost is G ( n ) , the complete computation steps of F ( n + 1 ) for its child node n + 1 are as follows.
(1)
Calculate the distance d g from the child node to the target node according to Equation (24), and bring in Equation (29) to calculate the estimated value H ( n + 1 ) .
(2)
The distance d f from the child node to the parent node is calculated according to Equation (23) and brought into Equation (25) to get Q n .
(3)
Substitute Q n into Equation (26) to get P n + 1 | n + 1 then bring (28) to calculate G ( n + 1 ) of the child nodes.
(4)
Combining the obtained G ( n + 1 ) and H ( n + 1 ) ,
F ( n + 1 ) = G ( n + 1 ) + H ( n + 1 )
The A* algorithm controls the points in the map by setting the open list and close list, and the pseudo code table of PCRB-based A* path planning algorithm is shown in Algorithm 1.
Algorithm 1 The PCRB-base A* path planning algorithm
Add the start point s to the open list and set the initial value F ( 0 ) = 0 .
Repeat the following procedure:
(1)
Iterate through the open list to find the node with the smallest F value and use it as the current node n to be processed.
(2)
Move the node to be processed to the close list.
(3)
For each of 8 grid points adjacent to the current node:
i
Ignore if it is already in the closed list;
ii
If it is not in the open list, add it and set the current node as its parent, recording the F, G and H values of this node;
iii
If it is already in the open list, check if this path (i.e., via the current node to this node) is better. Using the trace of G as a reference, a smaller value indicates that this path has a smaller localization covariance. If so, set its parent node to the current node and recalculate its G value and F value. The open list is sorted by F values and needs to be reordered after the change.
(1)
Stop, when
(i)
The endpoint is added to the open list, and the path is found at this point.
(ii)
The find focus fails and the open list is empty, when there is no path.
(2)
Let n = n + 1 and deal with the next node.
Starting from the end point, each node moves along its parent node until the start point, saving the path.

4. Simulation

The numerical gravity map of the simulation shown in Figure 2 is derived from the global ocean gravity field 1 × 1 model produced by Sandwell’s team [35], and the accuracy of the gravity field of the selected experimental region is better than 1.7 mGal. The maximum gravity anomaly in the region is 40.8 mGal and the minimum is 37.2 mGal. The gravity anomaly is highly undulating and contains various topographic features such as peaks, slopes, and flats, which are suitable for path planning analysis. Since the actual horizontal distances of longitude and 1 latitude of 1 are different, this paper projects the earth coordinate system to the geographic coordinate system, and the spatial resolution of the interpolated map is 1 km.
The measure of trajectory performance uses the Root Mean Square Error (RMSE), which is the square root of the ratio of the square of the deviation of the predicted value from the true value to the number of observations n.
RMSE = 1 N i = 1 n { x ^ i } { x i }
where { x i ^ } is the estimated value of the trajectory coordinates, { x i } is the true value of the trajectory coordinates, and N is the number of Monte Carlo experiments.
The estimated position x ^ is calculated by the SITAN algorithm, which is essentially an extended Kalman filter algorithm [5,36]. The state error propagation of SITAN can be simply modeled as (32).
Δ x t + 1 = Δ x t + v t
where Δ x t is the position error of INS, i.e., x t ^ = x INS Δ x t .
SITAN uses random linearization techniques to fit linear observation models.
z t = h ( x t ) y t H Δ x t + ε
where coefficients for H = [ h λ , h φ ] can be obtained from the following
h λ = 1 L ( 2 L + 1 ) ( L + 1 ) δ n = i L m = j L n = i 1 m = j + L Δ g M ( n , m ) n = i + 1 m = j L n = i + L m = j + L Δ g m ( n , m )
h φ = 1 L ( 2 L + 1 ) ( L + 1 ) δ n = i L m = j L n = i + L m = j 1 Δ g M ( n , m ) n = i L m = j + 1 n = i + L m = j + L Δ g m ( n , m )
(34) and (35) describe the process of calculating the observation matrix H for gravity anomaly data. The variables used are as follows: ( n , m ) , which represents the grid of the INS indicator position on the digital gravity map; Δ g M = h ( x t ) , which is the gravity anomaly extracted from the digital map based on the INS indicated position; Δ g m = y t , which is the gravity anomaly measured in real-time; δ which is the spacial resolution of the digital map; and L, which represents the number of grid points in the length of the fitted interval. Generally, a more accurate INS indicator position leads to a smaller INS confidence interval, resulting in a more precise linearized observation model.
For comparison, the following method [31,37] (hereinafter named method1) is used to calculate the informative areas.
S latitude = [ g ( i , j ) g ( i , j k ) ] 2 + [ g ( i , j ) g ( i , j + k ) ] 2
S longitude = [ g ( i , j ) g ( i k , j ) ] 2 + [ g ( i , j ) g ( i + k , j ) ] 2
Γ ( i , j ) = S longitude + S latitude / 4 ,
where S latitude and S longitude are the sum of the squares of the gravity anomaly differences between point ( i , j ) and its adjacent points within a distance of k in the latitude and longitude directions. When k = 6 , T > 9.3 is used as a criterion for determining the informative areas, as shown in Figure 3.
In order to implement method1 in the A* algorithm, the following design was carried out:
H m e t h o d 1 ( n ) = d g
G m e t h o d 1 n = 0 , when ( i , j ) informative areas 1 , when ( i , j ) non - informative areas
The meaning of (39) is to use the distance from the current point to the goal point as the heuristic function H ( n ) . (40) represents a cost function G ( n ) of 0 in the informative areas and 1 in the non-informative areas, rather than being treated as obstacles.

4.1. Test 1

The starting point of Test 1 in the planned path is located at ( 58 , 73 ) (start1 in Figure 2). The point is located within the slope area, where contour lines are densely distributed. The ending point, on the other hand, has coordinates of ( 65 , 9 ) . Table 1 lists the simulation conditions.
The background in Figure 4 is the M n contour filling map calculated from Equation (19) in spatial domain, i.e.,
M n = t r { H n T R n 1 H n }
where H n is the slope vector of the gravity field, and R n is the variance of the gravity measurement error at position n. M n represents the information of gravity anomaly fields in a small area that GAINS can collect. That is, a large M n means a small value of positioning error. A comparison between this and the gravity anomaly contours in Figure 2 reveals that regions with denser contours correspond to larger M n , which indicates that gravity navigation is more advantageous in these areas. In addition, compared with Figure 3, areas with large M n (i.e., dark colored areas) are basically consistent with the informative areas determined by method1, indicating that M n can quantify the informative areas.
As shown in Figure 4, following the proposed method, the planned path intersects the region with maximum information. However, the trajectory planned by method1 roughly follows the contour of the informative areas, rather than the center. Furthermore, the planned trajectory is smoother than the trajectory of method1, which is beneficial for heading control. In order to determine the optimality of the planned path, in addition to the path of method1 and the shortest path, we established several equidistant curves for comparison. Five additional curves were labeled as L1, L2, … curves, L5, from left to right, with a horizontal distance of 3.5 km between them.
We conducted Monte-Carlo simulations 100 times with the same parameters as those listed in Table 1. Each trajectory was divided into 100 sampling points by equal Euclidean distances. Figure 5 provides a comparison of the localization accuracy achieved using different trajectories in Test 1. As can be seen from Figure 5, the RMSE of all paths decreases rapidly during the initial stage since the starting point 1 is located in a region with high M n values. Among them, due to L4 and L5 towards the east heading in the initial stage, where the M n value there is relatively small, there is a slower RMSE descent of the trajectory in these two compared to other trajectories. Although the planned trajectory does not maintain the lowest RMSE throughout the entire path, it can be seen in the Figure 6 that the total RMSE of the planned trajectory is the smallest.
A noteworthy phenomenon is that even though L1 deviates from areas with high M n values, or even has a segment in the trajectory that is in a very small M n region, it still achieves a lower RMSE. One possible reason is that its path is short, so the divergence of the INS is small. The positioning accuracy is the comprehensive result of INS divergence and gravity-assisted correction, which cannot be determined solely by M n or the characteristic parameters of informative areas.

4.2. Test 2

Test 1 indicates that the RMSE of all trajectories decreases rapidly during the initial phase because the starting point is located in informative areas. Test 2 changed the starting point to ( 30 , 58 ) (start2 in Figure 2), situated at a relatively gentle seabed. As shown in Figure 7, this location has a smaller M n value, indicating that less gravity information can be used at the initial position. Consistent with test 1, in Figure 7, the black curve represents the planned trajectory, the gray curve represents the direct trajectory, and the blue curve represents the method1 trajectory. Similarly, we also designed L1–L5 as a comparison, with a horizontal spacing of approximately 5.5 km. Due to the distance from the informative areas, method1 fails at this test and only implements the shortest path planning of the A* algorithm without passing through any informative areas.
The simulation parameter settings are the same as Table 1. Figure 8 shows the RMSE of the position error for these trajectories, and the sum of RMSE values for each trajectory is presented in Figure 9.
In addition to the planned trajectory, L1, L2, and L3 all cross the area with large M n values on the left side in the initial stage, where L2 overlaps with the planned trajectory for a long time. In the magnified coordinate area, it can be seen that these four curves have a significantly faster descent speed at the beginning than the other four curves, including the straight line trajectory, method1 trajectory, L4, and L5. As shown in Figure 9, among all trajectories, the sum of RMSE for L2 and L3 is close to the planned trajectory, but their path length is longer, and the planned path is still the optimal choice. Due to the neglect of the relative value of information in the path planning method based on informative areas, available gravity information below the set threshold is discarded, and the setting of the threshold is vague and empirical, and will not be applicable to any sea area. Therefore, as shown in Figure 9, method1 exhibits the worst RMSE, even worse than the shortest path. On the contrary, the path planning method based on PCRB has clear information significance, considering not only the amount of gravity field information, but also the distance factor and INS drift rate, thus obtaining the optimal results.

4.3. The Impact of Changing the Measurement Noise on the Paths

In practice, the statistical characteristics of gyroscopes and accelerometers noise in inertial navigation systems are usually known and stable after careful calibration, so the process noise is stable. Therefore, the main factor to consider is the impact of gravity measurement errors. And since gravity measurement noise is affected by carrier motion, waves, and inaccurate map modeling, its variance is difficult to estimate accurately, so path planning should be considered to adapt to different measurement noise. The calculation of the sum of RMSE of two experimental trajectories is carried out by changing the standard deviation of the measurement noise R t to obtain Table 2.
In an overall view in Table 2 and Table 3, increasing the amount of measurement noise will increase the lower limit of positioning error, but will not change the ranking of the lower limit size of the curve, so the planned trajectory always has higher positioning accuracy than the other curves. Therefore, the planned trajectory is always optimal. And with the increase of the measurement noise, the improvement of the localization accuracy of the planned trajectory is more obvious. The optimality of the planned trajectory is not affected by gravimetric measurements, so that the planned trajectory can be navigated in one determined ocean mission to achieve the optimal navigation accuracy. In addition, the RMSE of a spatially close trajectory to the planned path is also close to the RMSE of the planned trajectory. Therefore, even if the real path deviates from the planned one by a small amount, it is possible to obtain a high positioning accuracy by gravity information.

5. Conclusions

This article proposed a method to plan a path that aims for the best positioning accuracy by using the Postiori Cramer-Rao bound of Gravity-aided Inertial Navigation System as the cost value in the A* algorithm. This path planning method is not limited by the ocean gravity field and can plan the trajectory with the minimum navigation error between any start and end points. The next work is to find the set of trajectories within a certain error requirement in which the carrier can achieve higher positioning accuracy without strictly following a certain trajectory, thereby improving the mobility of the carrier.

Author Contributions

Conceptualization, B.W.; methodology, B.W.; software, B.W.; validation, B.W.; formal analysis, B.W.; investigation, B.W. and T.C.; resources, T.C.; data curation, B.W.; writing—original draft preparation, B.W.; writing—review and editing, B.W. and T.C.; visualization, B.W.; supervision, T.C.; project administration, T.C.; funding acquisition, T.C. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the National Key R&D Program of China, Grant Nos. 2017YFC0601601.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

For the results and data generated during the study, please contact the corresponding author.

Conflicts of Interest

The authors declare no conflict of interest.

Abbreviations

The following abbreviations are used in this manuscript:
GAINSGravity-aided inertial navigation system
INSInertial Navigation System
PCRBPostiror Cramér-Rao bound
RMSERoot Mean Square Error

References

  1. Huang, H.; Tang, J.; Liu, C.; Zhang, B.; Wang, B. Variational Bayesian-Based Filter for Inaccurate Input in Underwater Navigation. IEEE Trans. Veh. Technol. 2021, 70, 8441–8452. [Google Scholar] [CrossRef]
  2. Bao, J.; Li, D.; Qiao, X.; Rauschenbach, T. Integrated navigation for autonomous underwater vehicles in aquaculture: A review. Inf. Process. Agric. 2020, 7, 139–151. [Google Scholar] [CrossRef]
  3. Jalal, F.; Nasir, F. Underwater Navigation, Localization and Path Planning for Autonomous Vehicles: A Review. In Proceedings of the 2021 International Bhurban Conference on Applied Sciences and Technologies (IBCAST), Islamabad, Pakistan, 12–16 January 2021; pp. 817–828. [Google Scholar] [CrossRef]
  4. Liu, H.; Wu, L.; Bao, L.; Li, Q.; Zhang, P.; Xi, M.; Wang, Y. Comprehensive Features Matching Algorithm for Gravity Aided Navigation. IEEE Geosci. Remote Sens. Lett. 2022, 19, 1–5. [Google Scholar] [CrossRef]
  5. Wang, Z.; Huang, Y.; Wang, M.; Wu, J.; Zhang, Y. A Computationally Efficient Outlier-Robust Cubature Kalman Filter for Underwater Gravity Matching Navigation. IEEE Trans. Instrum. Meas. 2022, 71, 1–18. [Google Scholar] [CrossRef]
  6. Wang, B.; Ma, Z.; Huang, L.; Deng, Z.; Fu, M. A Filtered-Marine Map-Based Matching Method for Gravity-Aided Navigation of Underwater Vehicles. IEEE/ASME Trans. Mechatronics 2022, 27, 4507–4517. [Google Scholar] [CrossRef]
  7. Gao, S.; Cai, T.; Fang, K. Gravity-Matching Algorithm Based on K-Nearest Neighbor. Sensors 2022, 22, 4454. [Google Scholar] [CrossRef]
  8. Stepanov, O.; Nosov, A. Algorithm for Planning an Informative Route for Map-Aided Navigation. In Proceedings of the 2021 28th Saint Petersburg International Conference on Integrated Navigation Systems (ICINS), Saint Petersburg, Russia, 31 May 2021–2 June 2021; pp. 1–5. [Google Scholar] [CrossRef]
  9. Liu, F.; Li, F.; Jing, X. Navigability Analysis of Local Gravity Map with Projection Pursuit-Based Selection Method by Using Gravitation Field Algorithm. IEEE Access 2019, 7, 75873–75889. [Google Scholar] [CrossRef]
  10. Feng, X.; Wang, B.; Deng, Z.; Fu, M. Internal path planning method for underwater vehicle with gravity aided navigation. In Proceedings of the 2016 35th Chinese Control Conference (CCC), Chengdu, China, 27–29 July 2016; pp. 5537–5541. [Google Scholar] [CrossRef]
  11. Yang, J.; Huo, J.; Xi, M.; He, J.; Li, Z.; Song, H.H. A Time-Saving Path Planning Scheme for Autonomous Underwater Vehicles with Complex Underwater Conditions. IEEE Internet Things J. 2023, 10, 1001–1013. [Google Scholar] [CrossRef]
  12. Wang, B.; Cai, T.; Fang, K. The Quantification Method of Matching Capability of Areas in Gravity-Aided Inertial Navigation. IEEE Sens. J. 2022, 22, 20958–20967. [Google Scholar] [CrossRef]
  13. Stepanov, O.A.; Nosov, A.S.; Toropov, A.B. Navigation informativity of geophysical fields in map-aided navigation. In Proceedings of the 2017 DGON Inertial Sensors and Systems (ISS), Karlsruhe, Germany, 19–20 September 2017; pp. 1–19. [Google Scholar] [CrossRef]
  14. Zhou, X.; Gao, F.; Fang, X.; Lan, Z. Improved Bat Algorithm for UAV Path Planning in Three-Dimensional Space. IEEE Access 2021, 9, 20100–20116. [Google Scholar] [CrossRef]
  15. Xu, C.; Duan, H.; Liu, F. Chaotic Artificial Bee Colony Approach to Uninhabited Combat Air Vehicle (UCAV) Path Planning. Aerosp. Sci. Technol. 2010, 14, 535–541. [Google Scholar] [CrossRef]
  16. Panda, M.; Das, B.; Subudhi, B.; Pati, B.B. A Comprehensive Review of Path Planning Algorithms for Autonomous Underwater Vehicles. Int. J. Autom. Comput. 2020, 17, 321–352. [Google Scholar] [CrossRef]
  17. Sang, H.; You, Y.; Sun, X.; Zhou, Y.; Liu, F. The hybrid path planning algorithm based on improved A* and artificial potential field for unmanned surface vehicle formations. Ocean Eng. 2021, 223, 108709. [Google Scholar] [CrossRef]
  18. Chong, Y.; Chai, H.; Li, Y.; Yao, J.; Xiao, G.; Guo, Y. Automatic Recognition of Geomagnetic Suitability Areas for Path Planning of Autonomous Underwater Vehicle. Mar. Geod. 2021, 44, 287–305. [Google Scholar] [CrossRef]
  19. Ma, Y.; Gong, Y.; Xiao, C.; Gao, Y.; Zhang, J. Path Planning for Autonomous Underwater Vehicles: An Ant Colony Algorithm Incorporating Alarm Pheromone. IEEE Trans. Veh. Technol. 2019, 68, 141–154. [Google Scholar] [CrossRef]
  20. Wang, L.; Liu, L.; Qi, J.; Peng, W. Improved Quantum Particle Swarm Optimization Algorithm for Offline Path Planning in AUVs. IEEE Access 2020, 8, 143397–143411. [Google Scholar] [CrossRef]
  21. Wang, B.; Zhu, Y.; Deng, Z.; Fu, M. The Gravity Matching Area Selection Criteria for Underwater Gravity-Aided Navigation Application Based on the Comprehensive Characteristic Parameter. IEEE/ASME Trans. Mechatronics 2016, 21, 2935–2943. [Google Scholar] [CrossRef]
  22. Wang, B.; Zhou, M.; Deng, Z.; Fu, M. Sum Vector-Difference-Based Matching Area Selection Method for Underwater Gravity-Aided Navigation. IEEE Access 2019, 7, 123616–123624. [Google Scholar] [CrossRef]
  23. Wang, B.; Li, T.; Deng, Z.; Fu, M. Wavelet Transform Based Morphological Matching Area Selection for Underwater Gravity Gradient-Aided Navigation. IEEE Trans. Veh. Technol. 2023, 72, 3015–3024. [Google Scholar] [CrossRef]
  24. Bergman, N. Recursive Bayesian Estimation: Navigation and Tracking Applications. Ph.D. Thesis, Linkoping University, Linköping, Sweden, 1999. [Google Scholar]
  25. Tichavsky, P.; Muravchik, C.; Nehorai, A. Posterior Cramer-Rao bounds for discrete-time nonlinear filtering. IEEE Trans. Signal Process. 1998, 46, 1386–1396. [Google Scholar] [CrossRef]
  26. Reynaud, S.; Louis, C. A Universal Navigability Map Building Approach for Improving Terrain-Aided-Navigation Accuracy. In Proceedings of the IEEE/ION Position, Location and Navigation Symposium, Indian Wells, CA, USA, 4–6 May 2010; pp. 888–896. [Google Scholar] [CrossRef]
  27. Zhong, X.; Premkumar, A.B.; Madhukumar, A.S. Particle Filtering and Posterior Cramér-Rao Bound for 2-D Direction of Arrival Tracking Using an Acoustic Vector Sensor. IEEE Sens. J. 2012, 12, 363–377. [Google Scholar] [CrossRef]
  28. Hernandez, M.; Farina, A. PCRB and IMM for Target Tracking in the Presence of Specular Multipath. IEEE Trans. Aerosp. Electron. Syst. 2020, 56, 2437–2449. [Google Scholar] [CrossRef]
  29. Lee, H.; Chun, J.; Jeon, K. Experimental Results and Posterior Cramér–Rao Bound Analysis of EKF-Based Radar SLAM with Odometer Bias Compensation. IEEE Trans. Aerosp. Electron. Syst. 2021, 57, 310–324. [Google Scholar] [CrossRef]
  30. Zhang, S.; Chen, D.; Fu, T.; Cao, H. Approximating Posterior Cramér–Rao Bounds for Nonlinear Filtering Problems Using Gaussian Mixture Models. IEEE Trans. Aerosp. Electron. Syst. 2021, 57, 984–1001. [Google Scholar] [CrossRef]
  31. OuYang, M.; Ma, Y. Path planning for gravity aided navigation based on improved A* algorithm. Chin. J. Geophys. 2020, 63, 4361–4368. [Google Scholar] [CrossRef]
  32. Liu, X.; Ma, D.; Yang, M.; Xia, X.; Guo, P. Modified Block A* Path-Planning Method for Hybrid-Driven Underwater Gliders. IEEE J. Ocean. Eng. 2022, 47, 20–31. [Google Scholar] [CrossRef]
  33. Anderson, R.C.; Davenport, J.A.; Jekeli, C. Determination of Gravity Data Spacing Required For Inertial Navigation. Navigation 2000, 47, 1–6. [Google Scholar] [CrossRef]
  34. Higham, N.J. Accuracy and Stability of Numerical Algorithms, 2nd ed.; Society for Industrial and Applied Mathematics: Philadelphia, PA, USA, 2002; p. 258. [Google Scholar] [CrossRef]
  35. Sandwell, D.; Garcia, E.; Soofi, K.; Wessel, P.; Chandler, M.; Smith, W.H.F. Toward 1-mGal Accuracy in Global Marine Gravity from CryoSat-2, Envisat, and Jason-1. Lead. Edge 2013, 32, 892–899. [Google Scholar] [CrossRef]
  36. Yoo, Y.M.; Park, C.G. Improvement of Terrain Referenced Navigation Using a Point Mass Filter with Grid Adaptation. Int. J. Control Autom. Syst. 2015, 13, 1173–1181. [Google Scholar] [CrossRef]
  37. Wang, H.; Wu, L.; Chai, H.; Xiao, Y.; Hsu, H.; Wang, Y. Characteristics of Marine Gravity Anomaly Reference Maps and Accuracy Analysis of Gravity Matching-Aided Navigation. Sensors 2017, 17, 1851. [Google Scholar] [CrossRef]
Figure 1. Hidden Markov Model for GAINS.
Figure 1. Hidden Markov Model for GAINS.
Jmse 11 00993 g001
Figure 2. Simulation map.
Figure 2. Simulation map.
Jmse 11 00993 g002
Figure 3. Informative areas of method1.
Figure 3. Informative areas of method1.
Jmse 11 00993 g003
Figure 4. Planned path, Shortest path, and trajectory L3, L4, …, L9 in Test 1.
Figure 4. Planned path, Shortest path, and trajectory L3, L4, …, L9 in Test 1.
Jmse 11 00993 g004
Figure 5. RMSE curves for each trajectory in Test 1.
Figure 5. RMSE curves for each trajectory in Test 1.
Jmse 11 00993 g005
Figure 6. Sum of RMSE for each trajectory in Test 1.
Figure 6. Sum of RMSE for each trajectory in Test 1.
Jmse 11 00993 g006
Figure 7. Planned path, Shortest path, and trajectories L1, L2, …, L5 in Test 2.
Figure 7. Planned path, Shortest path, and trajectories L1, L2, …, L5 in Test 2.
Jmse 11 00993 g007
Figure 8. RMSE curves of Test 2.
Figure 8. RMSE curves of Test 2.
Jmse 11 00993 g008
Figure 9. The sum of RMSE for each trajectory of Test 2.
Figure 9. The sum of RMSE for each trajectory of Test 2.
Jmse 11 00993 g009
Table 1. Simulation parameters settings.
Table 1. Simulation parameters settings.
Carrier velocity V5 m/s
Initial position covariance P ( x 0 ) d i a g ( [ 1 , 1 ] ) km 2 / s
Process noise covariance Q t d i a g ( [ 0.01 , 0.01 ] 2 ) m 2 / s
Measurement noise covariance R t 4 mGal 2
Map Spatial Resolution δ 1 km
Number of Monte Carlo runs1000
Table 2. Sum of RMSE of the trajectories in Test 1.
Table 2. Sum of RMSE of the trajectories in Test 1.
R t
(mGal)
Sum of RMSE (km)
PlannedShortestMethod1L1L2L3L4L5
118.725.221.019.719.820.925.027.4
230.438.034.431.131.431.737.640.8
353.467.156.457.255.258.266.069.1
Table 3. Sum of RMSE of the trajectories in Test 2.
Table 3. Sum of RMSE of the trajectories in Test 2.
R t
(mGal)
Sum of RMSE (km)
PlannedShortestMethod1L1L2L3L4L5
127.855.561.838.029.029.737.764.1
241.775.085.059.743.443.453.467.3
351.987.398.475.255.454.565.880.1
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.; Cai, T. Path Planning Method for Underwater Gravity-Aided Inertial Navigation Based on PCRB. J. Mar. Sci. Eng. 2023, 11, 993. https://doi.org/10.3390/jmse11050993

AMA Style

Wang B, Cai T. Path Planning Method for Underwater Gravity-Aided Inertial Navigation Based on PCRB. Journal of Marine Science and Engineering. 2023; 11(5):993. https://doi.org/10.3390/jmse11050993

Chicago/Turabian Style

Wang, Bo, and Tijing Cai. 2023. "Path Planning Method for Underwater Gravity-Aided Inertial Navigation Based on PCRB" Journal of Marine Science and Engineering 11, no. 5: 993. https://doi.org/10.3390/jmse11050993

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