Next Article in Journal
Design, Implementation and Simulation of a Fringing Field Capacitive Humidity Sensor
Next Article in Special Issue
A Trajectory Planning Method for Autonomous Valet Parking via Solving an Optimal Control Problem
Previous Article in Journal
A Review of Inkjet Printed Graphene and Carbon Nanotubes Based Gas Sensors
Previous Article in Special Issue
Solving the Multi-Functional Heterogeneous UAV Cooperative Mission Planning Problem Using Multi-Swarm Fruit Fly Optimization Algorithm
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Distributed Radio Beacon/IMU/Altimeter Integrated Localization Scheme with Uncertain Initial Beacon Locations for Lunar Pinpoint Landing

1
School of Astronautics, Harbin Institute of Technology, Harbin 150001, China
2
Institute of Aerospace Systems Engineering, Beijing 100076, China
3
Aviation Ammunition Institute, NORINCO Group, Harbin 150001, China
*
Author to whom correspondence should be addressed.
Sensors 2020, 20(19), 5643; https://doi.org/10.3390/s20195643
Submission received: 2 August 2020 / Revised: 10 September 2020 / Accepted: 30 September 2020 / Published: 2 October 2020
(This article belongs to the Special Issue Advanced Perception-Planning Fusion Technology in Robotics)

Abstract

:
As a growing number of exploration missions have successfully landed on the Moon in recent decades, ground infrastructures, such as radio beacons, have attracted a great deal of attention in the design of navigation systems. None of the available studies regarding integrating beacon measurements for pinpoint landing have considered uncertain initial beacon locations, which are quite common in practice. In this paper, we propose a radio beacon/inertial measurement unit (IMU)/altimeter localization scheme that is sufficiently robust regarding uncertain initial beacon locations. This scheme was designed based on the sparse extended information filter (SEIF) to locate the lander and update the beacon configuration at the same time. Then, an adaptive iterated sparse extended hybrid filter (AISEHF) was devised by modifying the prediction and update stage of SEIF with a hybrid-form propagation and a damping iteration algorithm, respectively. The simulation results indicated that the proposed method effectively reduced the error in the position estimations caused by uncertain beacon locations and made an effective trade-off between the estimation accuracy and the computational efficiency. Thus, this method is a potential candidate for future lunar exploration activities.

1. Introduction

Safe and soft pinpoint landing (within 100 m at 3 σ from the target site [1]) on an extraterrestrial body has been a central objective since the beginning of human space exploration missions. To date, many manned and unmanned landers have successfully landed on moons (Apollo and Chang’E), planets (Curiosity and Opportunity) and asteroids (Rosetta and Hayabusa-2), with landing footprints in the scale of kilometers [2,3]. Among all these celestial bodies, a growing number of exploration missions will land on the Moon in the future, as it is the most suitable outpost for deep space exploration. A robotic lunar base followed by a human base will likely be constructed during these missions, which will be the first potential implementation of co-located pinpoint landing [4]. With the existence of these infrastructures, the natural consequence is to make use of more ground sources to enhance the current onboard navigation capability for lunar landing missions using, for instance, radio beacons.
Radiometric localization is an extensively used technology on Earth. Although there are many specific kinds of signals and modulations for different applications, the information provided by radio beacons can be divided into three categories [5]: (a) range measurements, (b) range rate measurements and (c) bearing measurements. All of these have drawn attention to improving the accuracy of pinpoint landing. In 2008, NASA proposed a radio measurement-enhanced navigation architecture based on lunar relay satellites (LRS) and lunar communication terminals (LCT) for the Autonomous Landing and Hazard Avoidance Technology (ALHAT) project [6]. By combining range and range rate measurements from LRS and LCT with other basic measurements of the ALHAT sensor suite, the landing accuracy could reach a level of 10 m at 3 σ [7].
Several studies regarding the optimization of beacon configurations have been presented, both in terms of the filter accuracy [7,8] and observabilities [9,10]. On this basis, Theil et al. from the German Space Center (Deutsches Zentrum für Luft- und Raumfahrt, DLR) investigated the impact of one to four ground beacons for the small integrated navigation for planetary exploration (SINPLEX) project of ESA [4,11]. In this research, bearing measurements, as well as range and range rate measurements, were utilized by the navigation filter to augment the navigation baseline of SINPLEX. Different cases of beacon locations and setups were compared in the Autonomous Terrain-Based Optical Navigation (ATON) project of DLR, which indicated that the impact of additional bearing measurements was quite small.
All studies listed above were based on a strong assumption that uncertainties only existed in the sensor measurements, which means that all beacons were stationary and their locations were precisely pre-determined. In fact, most ground beacons can only be located either by orbiters or by the deep space network on the order of hundreds of meters [12]. Without the protection of the atmosphere, the diurnal temperature variation on the Moon is more than 300 ° C. If radio beacons are stationary, meaning that they will be exposed to a harsh environment for a long time, the onboard electronic equipment will be fatally damaged. One possible solution is to maintain radio beacons in the lunar base and redeploy them before each landing mission. Such scenarios serve as a strong motivation to investigate a novel navigation scheme that can locate the lander and update all beacon locations at the same time, which is similar to the range-only simultaneous localization and mapping (RO-SLAM) approach in the field of robotics.
Almost all existing radio beacons/inertial measurement unit (IMU)-integrated navigation algorithms in pinpoint landing are formulated using the state by the covariance matrix Σ and the mean vector μ of the multivariate Gaussian distribution and tracked via the extended Kalman filter (EKF) [4,11,13,14,15] or unscented Kalman filter (UKF) [16,17]. However, the computational complexity and memory space of these algorithms are both quadratic to the dimension of state vectors [18], which makes them unsuitable for dealing with this SLAM-like localization problem.
A large amount of strategies for RO-SLAM [19,20,21,22,23,24] have been developed in recent decades, in which the sparse extended information filter (SEIF) proposed by Thrun et al. [18] has been widely used. Unlike Kalman filters, SEIF represents the state by the information matrix Λ = Σ 1 and the information vector η = Λ μ , which makes the update stage more efficient due to the natural sparseness of the information matrix [25]. A conditional sparsification operation is implemented before the prediction stage to maintain the sparse representation of Λ , which leads to a constant execution time online.
While SEIF has been demonstrated to be more efficient and scalable in many applications [26,27,28], the consistency and accuracy of SEIF may be worse than EKF due to three approximations [29]: (a) the linearization of the motion and measurement models, (b) the recovery of the mean vector by iterations and (c) the sparsification via approximated conditional independence. Several methods have been designed to refine the performance of SEIF, such as exactly SEIF (ESEIF) [30], exactly sparse delayed-state filter (ESDSF) [31] and hybrid SEIF (HSEIF) [32]; each method only addresses one aspect of the approximation errors.
Iterated versions of EKF and UKF can increase their consistency and robustness against approximation errors compared to the original versions [33]; however, the rate of convergence is frustrated due to the dense covariance matrix. Due to the sparseness of the information filter, the computational burden is no longer a problem for iterated SEIF. He et al. [34] proposed the first iterated SEIF (ISEIF) for autonomous underwater vehicles, which utilized the Gauss–Newton algorithm for measurement updates rather than the traditional linear combination of predictions and innovations. However, divergence may occur in the Gauss–Newton algorithm when the initial values are far from the optimal values or the coefficient matrix in the normal equation is approximately singular [35].
In addition to the efficiency, the update stage in SEIF is also additive, which makes it capable of deployment in distributed systems. Torres et al. [23] first proposed a distributed RO-SLAM scheme based on SEIF for an autonomous ground vehicle (AGV). The prediction stage and update stage are implemented on the AGV and surrounding beacons, respectively. Except for the traditional direct robot–beacon measurements, additional inter-beacon measurements are also integrated into the SEIF, which reduces uncertainty both in the map estimation and localization accuracy. This work was then extended to a 3D resource-constrained operation with an auxiliary selection tool which only integrates the most informative measurements into the SEIF [36]. Further analysis regarding the effect of inter-beacon measurements on the building of an information matrix followed in [37], validating the preservation of the main properties of SEIF.
Beacon initialization is another challenge in RO-SLAM due to the partial observability of range measurements. As a multi-mode problem, the initial estimation of beacon locations can be obtained either by delayed or undelayed initialization methods. The trilateration method [38,39,40] is the most simple and efficient delayed initialization method; however, it suffers from measurement noise and the odometry error of robots. Olson et al. [41] attempted to address this problem with a 2D probability grid, with a performance that was limited by the size and resolution of the grid.
The shortcomings of these two methods resulted in them being quickly replaced by another widely used delayed initialization method: particle filters (PFs) [23,36,37,42,43]. PFs model the probability density of the beacon location as a uniform distribution around the measurement circle, and then the weight of each particle is updated and finally converges to a single solution by accumulating successive range measurements. Even though PFs can provide more accurate results, their significant computational burden cannot be neglected, which leads to several corresponding investigations [44,45].
In contrast to the delay initialization method, the initial beacon location is modeled with a multi-hypothesis distribution, which makes it available to integrate range measurements from the start. Blanco et al. [46] first proposed a Gaussian mixture model (GMM)-based initialization strategy, which provides accurate results but makes the integration of inter-beacon measurements impossible as each beacon is inserted in an independent EKF. On the basis of this research, Felipe et al. [47] proposed a centralized EKF-based initialization framework, which allowed the integration of inter-beacon measurements, and they enhanced it with a outlier rejection filter [48,49]. Geneve et al. [50] proposed a short-delayed composite initialization method based on Euclidean parameterization and a two-hypothesis GMM, which showed a lower computational cost.
Based on all the existing studies listed above, a novel distributed radio beacon/IMU-integrated localization scheme based on an adaptive iterated sparse extended hybrid filter (AISEHF) is presented in this paper. To the best of our knowledge, this is the first time that beacon location errors have been taken into consideration in the integrated navigation architecture for lunar pinpoint landing. This scheme is inspired by the SEIF-based distributed framework sketched in [37] and the ISEIF proposed in [34], while several aspects have been modified according to the characteristics of lunar pinpoint landing:
  • Only lander-beacon range measurements are utilized as inter-beacon measurements and are easily blocked by obstacles, such as craters on the lunar surface.
  • A batch-least-squares trilateration algorithm similar to [39] was adopted for the initialization of beacon locations, as their prior rough estimations are available and the inertial measurement unit (IMU) used in our application is much more accurate than that used in the majority of RO-SLAM applications.
  • The navigation state between two successive measurements was propagated by a hybrid form of the “mean vector + information matrix” to avoid the frequent conversion from the information vector to the mean vector, which can improve the computational efficiency of the prediction stage.
  • An adaptive iteration algorithm with the damping factor was adopted in the update stage, which can both improve the accuracy and efficiency of the estimator.
The remainder of this paper is structured as follows. The problem formulation is given in Section 2. In Section 3, we detail the implementations of the proposed distributed localization scheme. In Section 4, we verify the performance of the proposed algorithm by simulations, which is followed by further discussions. Eventually, our conclusions are presented in Section 5.

2. Problem Formulation

As illustrated in Figure 1, the target application scenario of this paper is the final phase of the power descent, which is short both in terms of the flight time and downrange distance (commonly around 200 s and 5–10 km). Without generality, the landing frame ( L ) can be chosen as the navigation frame. The origin of the L frame o l is located at the targeted landing site, and three coordinate axes ( x l , y l , and z l ) are aligned with the geographic directions east, north and up (ENU), respectively. Another significant coordinate system is the body frame B , whose origin lies in the mass center of the lander, and the directions of the three axes are front–left–up (FLU); i.e., the x b axis points to the front along the body symmetric axis, the y b axis points to the left and is orthogonal to x b and the z b axis completes the right-handed orthogonal coordinate system. In addition, measurements of the laser altimeter are present in the sensor frame ( S ), whose origin and x s axis are the same as the B frame but whose y s axis and z s axis are opposite to y b and z b .
The kinematic equations of the lunar lander, defined with respect to the landing frame L , are given as follows: [51]:
p ˙ L = v L v ˙ L = C B L f i B [ 2 ω i m L ] v L + g L C ˙ B L = C B L [ ω i b B ]
where [ · ] is the skew symmetric operator; p L is the lander position; v L is the lander velocity; C B L is the rotation matrix from B to L ; f i B and ω i b B , respectively, denote the specific force and the angular rate sensed by IMU, whose further interpretations can be found in [52]; and g L is the gravity vector, whose magnitude is assumed to vary with the altitude as follows [51]:
g = g 0 1 + h / R m 2
where g 0 = 1.622 m/s 2 is the gravity constant at the lunar surface, h is the current altitude of the lander and R m is the radius of the Moon. The superscripts that denote the corresponding frame are omitted for notational convenience in the following parts if there is no confusion.
The beacon receiver is attached on the bottom of the lander, which makes it directly visible from the ground beacons. Several radio beacons are mounted on rovers and pre-deployed along the designed ground track of the landing mission, while their prior rough locations are determined by the onboard navigation systems of the rover. Due to the limited effect of bearing measurements, each beacon is assumed to be equipped with a range-only sensor whose measurements r l i are affected by independent Gaussian white noise v b :
r l i = r ¯ l i + v b , v b N 0 , σ b r ¯ l i = δ x 2 + δ y 2 + δ z 2 = x l x b i 2 + y l y b i 2 + z l z b i 2
where p l = x l , y l , z l and p b i = x b i , y b i , z b i , respectively, denote the positions of the lander and the ith beacon. In addition, only the lander-beacon range measurements are available, as there are too many obstacles (such as craters or huge rocks) on the lunar surface, which could heavily degrade the inter-beacon measurements. Considering the terrain accessibility of the rover, all ground beacons are assumed to be on the same horizontal plane. This coplanarity will lead to uncertainty in altitude estimation; thus, a laser altimeter is mounted next to the beacon receiver to offer additional range measurements r a :
r a = z l cos γ cos θ + v a , v a N 0 , σ a
where θ is the pitch angle, γ is the roll angle and v a is the Gaussian white noise.
The flow diagram of the proposed distributed localization scheme is shown in Figure 2, which can be divided into two parts: the lander and the beacon. The prediction stage is continuously conducted onboard based on the IMU measurements. After the visible beacons have been detected, a message that contains the current estimated lander position p ^ l will be transmitted to all visible beacons. When this message has been received by beacon b i , it will switch from the “Standby” mode to the “Initialization” mode, in which the beacon location is initialized by minimizing the following batch-least-squares cost function with N range measurements:
p b i * = arg min p b i k = 1 N r l i k p ^ l k p b i T p ^ l k p b i 2
where N can be pre-determined offline and Equation (5) can be solved by the nonlinear optimization methods given in [53] with prior rough beacon locations as initial values.
When the initialization of b i is convergent, it starts to work in the “Localization” mode. Its contribution (local information vector η ˜ t i and information matrix Λ ˜ t i ) to the update stage is calculated and sent back to the lander. Then, the locations of all visible beacons are inserted into the state vector, and their contributions are summed together as follows:
η ˜ t = η ^ t + i = 1 k S i η ˜ t i , Λ ˜ t = Λ ^ t + i = 1 k S i Λ ˜ t i S i T
where · ^ and · ˜ denote the variables obtained by the state prediction and measurement update, respectively. S i = 0 I 0 T is a projection matrix that allocates η ˜ t i and Λ ˜ t i at the corresponding position of η ˜ t and Λ ˜ t :
S i η ˜ t i = 0 η ˜ t i 0 , S i Λ ˜ t i S i T = 0 0 0 0 Λ ˜ t i 0 0 0 0 .
Finally, an iterated update was performed based on the global information vector η ˜ t and information matrix Λ ˜ t , which was followed by the sparsification step of SEIF when the number of visible beacons were out of bounds or some links in the information matrix were too weak [34].

3. Adaptive Iterated Sparse Extended Hybrid Filter

3.1. State Definition and Jacobians

Like EKF, the first-order Taylor series expansion was applied to linearize the state space model as follows in Equation (8) to deal with nonlinear propagation and measurement functions, where w t and v t + 1 are the white process noise and measurement noise, respectively.
ξ t + 1 = f ( ξ t , u t ) + w t F t ξ t + G t u t + w t , w t N 0 , Q t z t + 1 = h ( ξ t + 1 ) + v t + 1 H t + 1 ξ t + 1 + v t + 1 , v t + 1 N 0 , R t + 1
where ξ t = [ x t T , B T ] T denotes the state vector at time t comprised of the lander state x t = [ p l t T , v l t T ] T and the set of visible beacons locations B = [ p b 1 T , , p b n T ] T . As a navigation (or localization) filter, it is common to choose the specific force f i and gravity vector g as the control input u t = [ f i T , g T ] T .
As B is kept unchanged and is independent of x t , we compute the Jacobians F and G from the kinematic model (Equation (1) with respect to the x t , which is more efficient. The results are given as follows:
F = f ( ξ , u ) x = I Δ t I 0 I Δ t [ 2 ω i m L ]
G = f ( ξ , u ) u = 0 0 Δ t C B L Δ t I .
Similarly, based on the measurement function of Equation (3) and (4), the measurement Jacobian H is given in Equations (11)∼(13), where all entries that are not given are zero.
H = H l i H l j H a = r l i x t r l i p b i 0 0 r l j x t 0 r l j p b j 0 r a x t 0 0 0
H l i = δ x r l i δ y r l i δ z r l i δ x r l i δ y r l i δ z r l i
H a = 0 0 1 cos γ cos θ .

3.2. Temporal Alignment of Asynchronous Measurements

Signal transmission or triggering delays will lead to a temporal misalignment between measurements from different sensors, which cannot be ignored in the integrated localization scheme. As depicted in Figure 3, a virtual measurement method based on linear interpolations was adopted in our scheme to eliminated the temporal misalignment. Assuming there are j IMU measurements between every two sequential beacon measurements and the two closest IMU measurements to t k are denoted as m t k 1 / j i and m t k / 1 i , the virtual measurement at t k can be obtained as follows:
m t k i = t k / 1 t k t k / 1 t k 1 / j m t k 1 / j i + t k t k 1 / j t k / 1 t k 1 / j m t k / 1 i .
When all measurements are temporally aligned, the state prediction and measurement update stage of SEIF are then executed separately.

3.3. Hybrid State Prediction

The typical prediction stage in SEIF can be separated into two main processes [31]—state augmentation and state marginalization—assuming the state vector ξ t is subjected to the conditional distribution given, z t and u t 1 , as expressed in Equation (15):
p ( ξ t | z t , u t 1 ) N ( μ x t μ B , Σ x t x t Σ x t B Σ B x t Σ B B ) N 1 ( η x t η B , Λ x t x t Λ x t B Λ B x t Λ B B ) .
At time t + 1 , a new variable x t + 1 , which represents the newest lander state, is first inserted into the state vector ξ t , and the augmented distribution p x t , x t + 1 , B N 1 η ¯ t + 1 , Λ ¯ t + 1 is given as follows: 1.5
Λ ¯ t + 1 = Λ x t x t + F T Q t 1 F F T Q t 1 Λ x t B Q t 1 F Q t 1 0 Λ B x t 0 Λ B B = Λ ¯ t + 1 α α Λ ¯ t + 1 α β Λ ¯ t + 1 β α Λ ¯ t + 1 β β
η ¯ t + 1 = η x t F T Q t 1 f ( μ x t , u t ) F μ x t G u t Q t 1 f ( μ x t , u t ) F μ x t G u t η B = η ¯ t + 1 α η ¯ t + 1 β .
The propagated distribution p x t + 1 , B | z t , u t can then be recovered by marginalizing out x t from the joint distribution p x t , x t + 1 , B | z t , u t :
Λ ^ t + 1 = Λ ¯ t + 1 β β Λ ¯ t + 1 β α Λ ¯ t + 1 α α 1 Λ ¯ t + 1 α β
η ^ t + 1 = η ¯ t + 1 β Λ ¯ t + 1 β α Λ ¯ t + 1 α α 1 η ¯ t + 1 α .
From Equations (16) and (17), the recovery of μ t from η t must be performed before the state augmentation to re-linearize F and G [18]. This is not a problem for a synchronous application, as η t will be utilized in the following update stage, whereas in an asynchronous application, the prediction stage will be followed by several other prediction stages, meaning that the state recovery will be implemented several times. As the state recovery is commonly performed based on iterated algorithms, as with a pre-conditioned gradient, these extra steps will lead to an unnecessary computational burden.
Based on the analysis above, we proposed a hybrid form of the “mean vector + information matrix” for the prediction stage, which will be called the sparse extended hybrid filter (SEHF) in the following. SEHF propagates the uncertainty of ξ t using Λ t as with the typical SEIF, while the expectation of ξ t is propagated by μ t instead of η t as follows:
μ ^ t + 1 = F 0 0 I μ t + G 0 u t = F μ x t + G u t μ B .
Figure 4 shows a comparison of the typical form and our hybrid form prediction when there are two prediction stages between successive update stages. Clearly, in the hybrid form, the state recovery only needs to be performed once before the filter switches from the update stage to the prediction stage, regardless of the number of extra prediction stages, whereas it will increase with the number of extra prediction stages in the typical form. Although there is an extra operation in the hybrid form that constructs η t for the update stage, the corresponding computational cost is quite small, as this is a simple matrix multiplication.

3.4. Adaptive Iterated Measurement Update

3.4.1. Iterated Measurement Update

When the current measurement z t + 1 is achieved, the SEIF typically updates the new posterior p ξ t + 1 | z t + 1 , u t according to the chain rule based on existing distributions p ξ t + 1 | z t , u t N 1 η ^ t + 1 , Λ ^ t + 1 and p z t + 1 | ξ t + 1 N h ( ξ t + 1 ) , R t + 1 :
Λ ˜ t + 1 = Λ ^ t + 1 + H T R t + 1 1 H
η ˜ t + 1 = η ^ t + 1 + H T R t + 1 1 z t + 1 h ( μ ^ t + 1 ) + H μ ^ t + 1 .
Varying from solving the measurement update via a linear combination of the prediction and innovation in the traditional filter, the iterated filter models it as a nonlinear least squares (NLS) problem as follows:
ξ t + 1 = arg min ξ t + 1 1 2 z t + 1 h ( ξ t + 1 ) T R t + 1 1 z t + 1 h ( ξ t + 1 ) + 1 2 ξ t + 1 μ ^ t + 1 ) T Σ ^ t + 1 1 ξ t + 1 μ ^ t + 1 ) = arg min ξ t + 1 χ 2 ( ξ t + 1 )
where χ 2 ( ξ t + 1 ) is the objective function of the NLS problem and ξ t + 1 is the optimal value when χ 2 ( ξ t + 1 ) takes the minimum value, defined by the following matrices:
Z = z t + 1 μ ^ t + 1 , G ( ξ t + 1 ) = h ξ t + 1 ξ t + 1 , W = R t + 1 1 0 0 Σ ^ t + 1 1 .
The objective function χ 2 ( ξ t + 1 ) can be rewritten into the following a matrix form [33]:
χ 2 ( ξ t + 1 ) = 1 2 Z G ( ξ t + 1 ) T W Z G ( ξ t + 1 ) = 1 2 Z G ( ξ t + 1 ) T C T e T ( ξ t + 1 ) C Z G ( ξ t + 1 ) e ( ξ t + 1 ) = 1 2 e ( ξ t + 1 ) 2 .
Then, the iterative sequences of ξ t + 1 i and Λ t + 1 i can be achieved as follows [34]:
K i = H i T R 1 H i + Λ ^ t + 1 1 H i T R 1
ξ t + 1 i + 1 = μ ^ t + 1 + K i z k + 1 h ξ t + 1 i H i μ ^ t + 1 ξ t + 1 i
Λ t + 1 i = H i T R 1 H i + Λ ^ t + 1
where H i is the Jacobian of the measurement function at ξ t + 1 i .

3.4.2. Iterated Measurement Update with Damping Factor

The iterative form update equations given above are obtained by solving the following normal equation of the Gauss–Newton algorithm:
J i T J i Δ ξ t + 1 i = J i T e ( ξ t + 1 i ) = Δ r i
where J i represents the Jacobian of e ( ξ t + 1 ) with respect to ξ t + 1 evaluated at ξ t + 1 i . As the coefficient matrix J i T J i is only positive semidefinite, there is no guarantee that Δ ξ is always along the descent direction. Δ ξ would become unstable when the initial value was far away from the solution as the second derivative (Hessian) of the object function was approximated by the Jacobian. To address these issues, a damped Gauss–Newton algorithm was proposed by Levenberg and Marquardt, successivel [53]. In this method, a positive damping factor λ was added to the coefficient matrix of the normal equation, which is known as the damping factor:
J i T J i + λ I Δ ξ t + 1 i = Δ r i , λ > 0 .
Clearly, J i T J i + λ I is always positive and the method is equivalent to the steepest descent algorithm and the Gauss–Newton algorithm when μ I J i T J i and μ I J i T J i , respectively. With this modification, the iterative sequence of ξ t is modified as follows (see Appendix A for more details):
K i = H i T R 1 H i + Λ ^ t + 1 + λ I 1 H i T R 1
ξ t + 1 i + 1 = Γ t + 1 μ ^ t + 1 + K i z t + 1 h ( ξ t + 1 i ) H Γ t + 1 μ ^ t + 1 ξ t + 1 i Γ t + 1 = Λ ^ t + 1 λ I I + λ Λ ^ t + 1 1 Λ ^ t + 1 λ
As the uncertainty of ξ t will only be updated when the iteration converges [33], the update of Λ t is the same as Equation (28). As a hybrid form is adopted for the following prediction stages in our scheme, there is no need to convert μ t to η t , which further reduces the computational burden.

3.4.3. Damping Factor and Stopping Criteria

A proper value of λ is vital to the iteration. One possible solution is to choose the initial value of λ depending on the maximum value of the coefficient matrix:
λ 0 = τ · max ( d i a g ( J 0 T J 0 ) ) , τ [ 10 8 , 1 ]
and then update λ based on the gain ratio ρ at each iteration [54]:
λ = λ max 1 3 , 1 2 ρ 1 3 , ν = 2 ; ρ > 0 λ ν , ν = 2 ν ; ρ 0
where ρ is the ratio of the actual and approximated decrease of the objective function:
ρ = χ 2 ( ξ t + 1 i ) χ 2 ( ξ t + 1 i + Δ ξ t + 1 i ) ) L ( 0 ) L ( Δ ξ t + 1 i )
L ( 0 ) L ( Δ ξ t + 1 i ) = ( Δ ξ t + 1 i ) T J i T e ( ξ t + 1 i ) 1 2 ( Δ ξ t + 1 i ) T J i T J i Δ ξ t + 1 i = 1 2 ( Δ ξ t + 1 i ) T Δ r i + λ Δ ξ t + 1 i .
Another parameter of concern is the number of iterations, which balances the accuracy and efficiency of the iteration process. Commonly, this parameter is difficult to predetermine offline; thus, several adaptive stopping criteria are applied in the proposed algorithm. First, the iteration process should be terminated when the difference between two successive residuals is smaller than a threshold ϵ 1 , which reflects the global minimum:
Δ r i + 1 Δ r i < ϵ 1 .
Another stopping criterion is related to the local minimum; i.e., the increment Δ ξ t + 1 i is smaller than the threshold ϵ 2 :
Δ ξ t + 1 i < ϵ 2 .
Lastly, the maximum iterations k m a x should be settled in the case of a dead loop.
With all notations and definitions above, the complete working flow of the adaptive iterative update is summarized in Figure 5.

4. Results and Discussions

4.1. Simulation Scenario and Parameters

The simulation scenario is a final landing phase performed after the main break phase of the powered descent, as shown in Figure 6. The landing trajectory was simulated for 210 s with an initial position of 9797 , 0 , 5530 m, an initial velocity of 85 , 0 , 0 m/s and an initial attitude of 0 , 15 , 0 in degrees. Figure 7 presents the profile of the specific force and angular rate in detail. Ten beacons were deployed uniformly along both sides of the ground track in the simulation, and their true locations are listed in Table 1. An initial position error of 200 m was added to their true positions to simulate the prior rough locations obtained by rovers.
With respect to the navigation filter, the number of measurements K in the beacon initialization in Equation (5) was chosen to be 50. The attitude was propagated based on raw gyroscope measurements and periodically calibrated by the star tracker independently with a residual around 9.1 [4]. The residuals of the initial position and velocity were set to 300 m and 30 m/s, respectively. The 1 σ parameters of IMU, the laser altimeters and ground beacons are listed in Table 2, and their update frequencies are, respectively, settled to 200 Hz, 100 Hz, and 20 Hz.
Other parameters of the localization filter—i.e., the initial covariance matrix p 0 , the process noise covariance matrices Q t and the measurement noise covariance matrices R t + 1 —are given as follows:
p 0 = d i a g 1 × 10 4 , 1 × 10 4 , 1 × 10 4 , 1 × 10 2 , 1 × 10 2 , 1 × 10 2 , 1 × 10 4 , , 1 × 10 4 ( n + 6 ) × ( n + 6 )
Q k = d i a g 0.5 , 0.1 , 5 , 0.005 , 0.0001 , 0.001 6 × 6
R k + 1 = d i a g 1 × 10 4 , , 1 × 10 4 , 25 ( n + 1 ) × ( n + 1 )
where n is the number of available beacons.
The simulation system was implemented in C++ using the Robot Operating System (ROS) on a laptop with an Intel Core™i7-4790 @ 3.68 GHz and 8 GB RAM. Each sensor runs an independent ROS node to simulate the real interactions.

4.2. Simulation Results and Analyses

The estimation errors of the navigation state obtained by the proposed AISEHF-based distributed localization scheme are shown in Figure 8. It can be seen from the results that the residuals converged into the 1 σ uncertainty bound rapidly both in the triaxial position and velocity estimations with steady values less than 50 m and 5 m/s, which meet the demands of pinpoint landing.
Figure 9a presents the performance of the proposed method in the mapping of all ground beacons. Due to the initialization procedure, almost all beacon location errors converged within 50 s, and the average error was 32.41 m. From Figure 9b, there appears to be an offset between the estimated value and the true value both in the beacon locations and the ground track. This appearance is induced by the fact that there is neither an accurate initial position of the lander nor for ground beacons, which means that their absolute locations are not observable.
Then, the proposed scheme (Scheme 3) was further compared with another two schemes with the same sensor configurations: (a) the SEIF-based scheme proposed in [37] without inter-beacon measurements (Scheme 1) and (b) the ISEIF scheme proposed in [34] (Scheme 2). The performance of all three schemes was evaluated in 100 independent Monte Carlo runs. In each of the 100 runs, all random seeds (e.g., beacon locations and sensor noise) were changed randomly, while all parameters of estimator were kept unchanged. Two indicators—root-mean-square errors (RMSEs) and averaged RMSEs (ARMSEs), which are defined in Equation (42)—were adopted to acquire a fair result.
ϵ R M S E ( t ) = 1 K i = 1 K x ˜ t i x t i T x ˜ t i x t i n , x R n ϵ A R M S E = 1 T t = 0 T ϵ R M S E ( t )
where K is the number of Monte Carlo runs and T is the total time from the convergence to the end. x ˜ t i and x t i , respectively, denote the estimated and true state at time t in the i th run.
Figure 10 gives the position RMSEs and the average computational cost of the three schemes mentioned above from 100 independent Monte Carlo runs. The improvement of Scheme 3 in the position estimation was 4.55 % w.r.t. Scheme 2 and 8.11 % w.r.t. Scheme 3. The velocity RMSEs are not given here due to the fact that the iteration algorithm mainly focused on addressing the linearization error caused by the linear approximation of the measurement function, and it can be seen from Equations (12) and (13) that triaxial velocities make no contribution to the measurement function in this case.
The computational cost of Scheme 3 was 3.64 % more w.r.t. Scheme 1 and 18.96 % less w.r.t. Scheme 2. The performance of the three schemes is summarized in Table 3, indicating that Scheme 3 results in a good trade-off between position estimation accuracy and computational efficiency.
The influence of the beacon number n is given in Figure 11. From the results, the position ARMSE continued to decrease when n was lower than 10 and increased to a large error in the order of kilometers, while the computational cost continued to increase with n. We defined an indicator call cost–ARMSE percentage, which was equal to 100 / ( C o s t A R M S E ) to further illustrate the results and indicated that n = 10 was the most suitable configuration in our case.
Figure 12 gives the comparison of the proposed scheme under different initial location errors. We can infer from the results that the batch-least-square trilateration initialization algorithm achieved a consistent residual (around 40 m) regardless of the beacon initial location error in our application, which also led to a good robustness of the proposed localization scheme to the beacon initial noise. Extensive results with the initialization procedure disabled are further illustrated, which further prove the conclusion.
Finally, another 100 independent Monte Carlo runs were performed to evaluate the final drops of the proposed method, and the results are plotted in Figure 13, showing a circular error probable (CEP) of 37.52 m and a mean value of 35.66   m , 12.17   m . Another interesting point is that the distribution of the final drops in the north (11.60 m) was much larger than that in the east (1.58 m). One possible reason for this phenomenon may lie in the geometrical configuration of all ground beacons, which has a significant effect on the observability of the whole system.

5. Conclusions

In this article, a distributed localization scheme was proposed to handle the situation of having no accurate prior knowledge regarding the beacon configuration in lunar pinpoint landing. This scheme integrated onboard IMU/altimeter measurements together with lander-beacon range measurements within a SEIF-based framework. The prediction and update stages of SEIF were replaced by a hybrid-form propagation and a damping iteration algorithm, respectively, which led to the so-called AISEHF. The simulation results indicated that the proposed scheme could satisfy the navigation demands of lunar pinpoint landing and showed a robustness to uncertain initial beacon locations. The Monte Carlo simulation indicated that our scheme makes a good trade-off between estimation accuracy and computational efficiency compared with the existing algorithms.
Although the research in this paper has proved to be significant, there are still some questions that require further investigation, such as the augmentation of the current range-only measurements with the range-rate and the optimization of the geometrical pattern of all ground beacons. Several realistic problems, such as transmission loss and glint noise, should be taken into consideration and verified by experiments. Our work will be expanded to include these issues in the future.

Author Contributions

Conceptualization, Y.L. and R.M.; methodology, Y.L. and R.M.; software, Y.L.; validation, R.M., Y.L., and B.S.; data curation, R.L.; writing—original draft, Y.L.; writing—review and editing, R.M. and B.S.; project administration, Y.S.; funding acquisition, R.M. and Y.S. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by The Fourth Batch of Manned Space Pre-research Projects (Grant No. 18123060201).

Conflicts of Interest

The authors declare no conflict of interests.

Appendix A. Adaptive Iterated Update Algorithm

The detailed matrix form of J i is given as
J i = f ( ξ t + 1 ) ξ t + 1 ξ t + 1 i = C H i T , I T .
Substituting Equation (A1) into Equation (30) leads to
ξ t + 1 i + 1 = ξ t + 1 i + H i T R 1 H i + Λ ^ t + 1 + λ I 1 H i T , I R 1 0 0 Σ ^ t + 1 1 z t + 1 h ( ξ t + 1 i ) μ ^ t + 1 ξ t + 1 i = H i T R 1 H i + S 1 H i T R 1 z t + 1 h ( ξ t + 1 i ) + H i ξ t + 1 i + Σ ^ t + 1 1 μ ^ t + 1
where S = Λ ^ t + 1 + λ I . Expanding the above equation with the matrix inversion lemmas given in [33], we can achieve
K i = H i T R 1 H i + S 1 H i T R 1 ξ t + 1 i + 1 = K z t + 1 h ( ξ t + 1 i ) + H i ξ t + 1 i + H i T R 1 H i + S 1 Σ ^ t + 1 1 μ ^ t + 1 = Γ t + 1 μ ^ t + 1 + K i z t + 1 h ( ξ t + 1 i ) H Γ t + 1 μ ^ t + 1 ξ t + 1 i Γ t + 1 = Λ ^ t + 1 λ I I + λ Λ ^ t + 1 1 Λ ^ t + 1 λ Λ t + 1 i = H i T R 1 H i + Λ ^ t + 1 .

References

  1. Qin, T.; Zhu, S.; Cui, P.; Gao, A. An innovative navigation scheme of powered descent phase for Mars pinpoint landing. Adv. Space Res. 2014, 54, 1888–1900. [Google Scholar] [CrossRef]
  2. Yang, H.; Li, S.; Bai, X. Fast homotopy method for asteroid landing trajectory optimization using approximate initial costates. J. Guid. Control Dyn. 2019, 42, 585–597. [Google Scholar] [CrossRef]
  3. Bai, C.; Guo, J.; Zheng, H. Optimal Guidance for Planetary Landing in Hazardous Terrains. IEEE Trans. Aerosp. Electron. Syst. 2019, 99, 1–12. [Google Scholar] [CrossRef]
  4. Theil, S.; Bora, L. Multiple beacons for supporting lunar landing navigation. CEAS Space J. 2018, 10, 295–305. [Google Scholar] [CrossRef] [Green Version]
  5. Bora, L. Ground Beacons to Enhance Lunar Landing Autonomous Navigation Architectures. Master’s Thesis, Polytechnic University of Milan, Milan, Italy, April 2015. [Google Scholar]
  6. Davis, J.L.; Striepe, S.A.; Maddock, R.W.; Hines, G.D.; Johnson, A.E. Advances in POST2 End-to-End Descent and Landing Simulation for the ALHAT Project. In Proceedings of the AIAA/AAS Astrodynamics Specialist Conference & Exhibit, Honolulu, HI, USA, 18–21 August 2008. [Google Scholar]
  7. Christensen, D.; Geller, D. Terrain-Relative and beacon-relative navigation for lunar powered descent and landing. J. Astronaut. Sci. 2011, 58, 121–151. [Google Scholar] [CrossRef] [Green Version]
  8. Pastor, P.R.R.; Gay, R.; Striepe, S.; Bishop, R. Mars Entry Navigation from EKF Processing of Beacon Data. In Proceedings of the AAS/AIAA Astrodynamics Specialist Conference, Denver, CO, USA, 14–17 August 2000. [Google Scholar]
  9. Yu, Z.; Cui, P.; Zhu, S. Observability-based beacon configuration optimization for Mars entry navigation. J. Guid. Control Dyn. 2015, 38, 643–650. [Google Scholar] [CrossRef]
  10. Zhao, Z.; Yu, Z.; Cui, P. A beacon configuration optimization method based on Fisher information for Mars atmospheric entry. Acta Astronaut. 2017, 133, 467–475. [Google Scholar] [CrossRef]
  11. Theil, S.; Bora, L. Beacons for supporting lunar landing navigation. CEAS Space J. 2017, 9, 77–95. [Google Scholar] [CrossRef] [Green Version]
  12. Zhao, T.; Wenying, L.; Wu, Z. High-precision navigation nethod for Lunar landing based on radio Beacons/IMU. In Proceedings of the 9th China Satellite Navigation Conference, Harbin, China, 23–25 May 2018. [Google Scholar]
  13. Heise, D.T.S.G.; Steffes, S.R.; Theil, S. Filter design for small integrated navigator for planetary exploration. In Proceedings of the 61th Deutscher Luft- und Raumfahrtkongress, Berlin, Germany, 10–12 September 2012; Deutsche Gesellschaft für Luft- und Raumfahrt: Berlin, Germany, 2012. [Google Scholar]
  14. Yu, Z.; Cui, P.; Zhu, S. On the observability of Mars entry navigation using radiometric measurements. Adv. Space Res. 2014, 54, 1513–1524. [Google Scholar] [CrossRef]
  15. Wedler, A.; Hellerer, M.; Rebele, B.; Gmeiner, H.; Vodermayer, B.; Bellmann, T.; Barthelmes, S.; Rosta, R.; Lange, C.; Witte, L. ROBEX–Components and methods for the planetary exploration demonstration mission. In Proceedings of the 13th Symposium on Advanced Space Technologies in Robotics and Automation (ASTRA), Noordwijk, The Netherlands, 11–13 May 2015; ESAWebsite: Cologne, Germany, 2015. [Google Scholar]
  16. Shuang, L.; Peng, Y. Radio beacons/IMU integrated navigation for Mars entry. Adv. Space Res. 2011, 47, 1265–1279. [Google Scholar]
  17. Jiang, X.; Li, S.; Huang, X. Radio/FADS/IMU integrated navigation for Mars entry. Adv. Space Res. 2018, 61, 1342–1358. [Google Scholar] [CrossRef] [Green Version]
  18. Thrun, S.; Liu, Y.; Koller, D.; Ng, A.Y.; Ghahramani, Z.; Durrant-Whyte, H. Simultaneous localization and mapping with sparse extended information filters. Int. J. Rob. Res. 2004, 23, 693–716. [Google Scholar] [CrossRef]
  19. Paskin, M.A. Thin junction tree filters for simultaneous localization and mapping. In Proceedings of the International Joint Conference on Artificial Intelligence, Acapulco, Mexico, 9–15 August 2003; Available online: http://ai.stanford.edu/~paskin/pubs/Paskin2003a.pdf (accessed on 10 June 2020).
  20. Menegatti, E.; Danieletto, M.; Mina, M.; Pretto, A.; Bardella, A.; Zanconato, S.; Zanuttigh, P.; Zanella, A. Autonomous discovery, localization and recognition of smart objects through WSN and image features. In Proceedings of the 2010 IEEE Globecom Workshops, Miami, FL, USA, 6–10 December 2010; pp. 1653–1657. [Google Scholar]
  21. Boots, B.; Gordon, G. A spectral learning approach to range-only SLAM. In Proceedings of the International Conference on Machine Learning, Atlanta, GA, USA, 16–21 June 2013; pp. 19–26. Available online: http://proceedings.mlr.press/v28/boots13.pdf (accessed on 5 May 2020).
  22. Huang, J.; Millman, D.; Quigley, M.; Stavens, D.; Thrun, S.; Aggarwal, A. Efficient, generalized indoor wifi graphslam. In Proceedings of the 2011 IEEE international conference on robotics and automation, Shanghai, China, 9–13 May 2011; pp. 1038–1043. [Google Scholar]
  23. Torres-González, A.; Martinez-De Dios, J.R.; Ollero, A. Efficient robot-sensor network distributed SEIF range-only SLAM. In Proceedings of the 2014 IEEE International Conference on Robotics and Automation (ICRA), Hong Kong, China, 31 May–7 June 2014; pp. 1319–1326. [Google Scholar]
  24. Herranz, F.; Llamazares, Á.; Molinos, E.; Ocaña, M. A comparison of SLAM algorithms with range only sensors. In Proceedings of the 2014 IEEE International Conference on Robotics and Automation (ICRA), Hong Kong, China, 31 May–7 June 2014; pp. 4606–4611. [Google Scholar]
  25. Eustice, R.; Walter, M.; Leonard, J. Sparse extended information filters: Insights into sparsification. In Proceedings of the 2005 IEEE/RSJ International Conference on Intelligent Robots and Systems, Edmonton, AB, Canada, 2–6 August 2005; pp. 3281–3288. [Google Scholar]
  26. Walter, M.; Hover, F.; Leonard, J. SLAM for ship hull inspection using exactly sparse extended information filters. In Proceedings of the 2008 IEEE International Conference on Robotics and Automation, Pasadena, CA, USA, 19–23 May 2008; pp. 1463–1470. [Google Scholar]
  27. Wang, X.; Ma, L. Sparse extended information filter for feather-based SLAM. In Proceedings of the 2011 International Conference on Electronics, Communications and Control (ICECC), Ningbo, China, 9–11 September 2011; pp. 2290–2293. [Google Scholar]
  28. Zhang, H.; He, B.; Luan, N. Sparse Extended Information Filter for AUV SLAM: Insights into the Optimal Sparse Time. Appl. Mech. Mater. 2013, 427–429, 1670–1673. [Google Scholar] [CrossRef]
  29. Shen, Y.; Zhang, H.; He, B.; Yan, T.; Liu, Y. Autonomous Navigation Based on SEIF with Consistency Constraint for C-Ranger AUV. Math. Probl. Eng. 2015, 2015, 752360. [Google Scholar] [CrossRef] [Green Version]
  30. Walter, M.R.; Eustice, R.M.; Leonard, J.J. Exactly sparse extended information filters for feature-based SLAM. Int. J. Rob. Res. 2007, 26, 335–359. [Google Scholar] [CrossRef] [Green Version]
  31. Eustice, R.M.; Singh, H.; Leonard, J.J. Exactly Sparse Delayed-State Filters for View-Based SLAM. IEEE Trans. Rob. 2006, 22, 1100–1114. [Google Scholar] [CrossRef] [Green Version]
  32. Guo, J.; Zhao, C. An improved SLAM algorithm with sparse extended information filters. Pattern Recognit. Artif. Intell. 2009, 22, 263–269. [Google Scholar]
  33. Shojaei, K.; Mohammad Shahri, A. Experimental study of iterated kalman filters for simultaneous localization and mapping of autonomous mobile robots. J. Intell. Inf. Syst. Theory Appl. 2011, 63, 575–594. [Google Scholar] [CrossRef]
  34. He, B.; Liu, Y.; Dong, D.; Shen, Y.; Yan, T.; Nian, R. Simultaneous localization and mapping with iterative sparse extended information filter for autonomous vehicles. Sensors 2015, 15, 19852–19879. [Google Scholar] [CrossRef] [Green Version]
  35. Hao, Y.; Bogdan, M.W. Levenberg-Marquardt Training. In Industrial Electronics Handbook; CRC Press: Boca Raton, FL, USA, 2011; Chapter 12; pp. 1–15. [Google Scholar]
  36. Torres-González, A.; Martínez-de Dios, J.R.; Ollero, A. Robot-Beacon Distributed Range-Only SLAM for Resource-Constrained Operation. Sensors 2017, 17, 903. [Google Scholar] [CrossRef] [Green Version]
  37. Torres-González, A.; Martinez-de Dios, J.R.; Ollero, A. Range-only SLAM for robot-sensor network cooperation. Auton. Robot. 2018, 42, 649–663. [Google Scholar] [CrossRef]
  38. Leonard, J.J.; Rikoski, R.J.; Newman, P.M.; Bosse, M. Mapping Partially Observable Features from Multiple Uncertain Vantage Points. Int. J. Rob. Res. 2002, 21, 943–976. [Google Scholar] [CrossRef]
  39. Zhou, Y. An efficient least-squares trilateration algorithm for mobile robot localization. In Proceedings of the 2009 IEEE/RSJ International Conference on Intelligent Robots and Systems, St. Louis, MO, USA, 10–15 October 2009; pp. 3474–3479. [Google Scholar]
  40. Menegatti, E.; Zanella, A.; Zilli, S.; Zorzi, F.; Pagello, E. Range-only slam with a mobile robot and a wireless sensor networks. In Proceedings of the 2009 IEEE International Conference on Robotics and Automation, Kobe, Japan, 12–17 May 2009; pp. 8–14. [Google Scholar]
  41. Olson, E.; Leonard, J.J.; Teller, S. Robust range-only beacon localization. IEEE J. Oceanic Eng. 2006, 31, 949–958. [Google Scholar] [CrossRef] [Green Version]
  42. Caballero, F.; Merino, L.; Maza, I.; Ollero, A. A particle filtering method for wireless sensor network localization with an aerial robot beacon. In Proceedings of the 2008 IEEE International Conference on Robotics and Automation, Pasadena, CA, USA, 19–23 May 2008; pp. 596–601. [Google Scholar]
  43. Blanco, J.L.; González, J.; Fernández-Madrigal, J.A. A pure probabilistic approach to range-only SLAM. In Proceedings of the 2008 IEEE International Conference on Robotics and Automation, Pasadena, CA, USA, 19–23 May 2008; pp. 1436–1441. [Google Scholar]
  44. Yang, P. Efficient particle filter algorithm for ultrasonic sensor-based 2D range-only simultaneous localisation and mapping application. IET Wirel. Sens. Syst. 2012, 2, 394–401. [Google Scholar] [CrossRef]
  45. Wang, Z.M.; Du, Z.J. Simultaneous localization and mapping for mobile robot based on an improved particle filter algorithm. In Proceedings of the 2009 International Conference on Mechatronics and Automation, Changchun, China, 9–12 August 2009; pp. 1106–1110. [Google Scholar]
  46. Blanco, J.L.; Fernández-Madrigal, J.A.; González, J. Efficient probabilistic range-only SLAM. In Proceedings of the 2008 IEEE/RSJ International Conference on Intelligent Robots and Systems, Nice, France, 22–26 September 2008; pp. 1017–1022. [Google Scholar]
  47. Fabresse, F.R.; Caballero, F.; Maza, I.; Ollero, A. Undelayed 3d RO-SLAM based on gaussian-mixture and reduced spherical parametrization. In Proceedings of the 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems, Tokyo, Japan, 3–7 November 2013; pp. 1555–1561. [Google Scholar]
  48. Fabresse, F.R.; Caballero, F.; Maza, I.; Ollero, A. Robust range-only SLAM for aerial vehicles. In Proceedings of the 2014 International Conference on Unmanned Aircraft Systems (ICUAS), Orlando, FL, USA, 27–30 May 2014; pp. 750–755. [Google Scholar]
  49. Fabresse, F.R.; Caballero, F.; Maza, I.; Ollero, A. Robust Range-Only SLAM for Unmanned Aerial Systems. J. Intell. Rob. Syst. 2016, 84, 297–310. [Google Scholar] [CrossRef]
  50. Geneve, L.; Kermorgant, O.; Laroche, E. A composite beacon initialization for EKF range-only SLAM. In Proceedings of the IEEE International Conference on Intelligent Robots and Systems, Hamburg, Germany, 28 September–2 October 2015; pp. 1342–1348. [Google Scholar]
  51. Titterton, D.H.; Weston, J.L. Stmpdown Inertial Navigation Technology, 2nd ed.; The Institution of Electrical Engineers: London, UK, 2007. [Google Scholar]
  52. Crassidis, J.L. Sigma-point Kalman filtering for integrated GPS and inertial navigation. IEEE Trans. Aerosp. Electron. Syst. 2006, 42, 750–756. [Google Scholar] [CrossRef]
  53. Madsen, K.; Nielsen, H.B.; Tingleff, O. Methods for Non-Linear least Squares Problems. 2004. Available online: https://orbit.dtu.dk/en/publications/methods-for-non-linear-least-squares-problems-2nd-ed (accessed on 24 April 2020).
  54. Nielsen, H.B. Damping Parameter in Marquardt’s Method; Technical Report 2; Technical University of Denmark: Copenhagen, Denmark, 2004. [Google Scholar]
Figure 1. Overview of the proposed distributed radio beacon/inertial measurement unit (IMU)-integrated localization scheme and definitions of the landing frame L (east, north and up (ENU)) and the body frame B (front–left–up (FLU)).
Figure 1. Overview of the proposed distributed radio beacon/inertial measurement unit (IMU)-integrated localization scheme and definitions of the landing frame L (east, north and up (ENU)) and the body frame B (front–left–up (FLU)).
Sensors 20 05643 g001
Figure 2. The flow diagram of the tightly-coupled navigation system based on the adaptive iterated sparse extended hybrid filter (AISEHF).
Figure 2. The flow diagram of the tightly-coupled navigation system based on the adaptive iterated sparse extended hybrid filter (AISEHF).
Sensors 20 05643 g002
Figure 3. An example of processing asynchronous inertial measurement unit (IMU) and beacon measurements.
Figure 3. An example of processing asynchronous inertial measurement unit (IMU) and beacon measurements.
Sensors 20 05643 g003
Figure 4. Comparison of the typical form and our hybrid form prediction. Different processing steps between these two forms are marked with different colors depending on their computational burden.
Figure 4. Comparison of the typical form and our hybrid form prediction. Different processing steps between these two forms are marked with different colors depending on their computational burden.
Sensors 20 05643 g004
Figure 5. A schematic diagram of the adaptive iterative update with the damping factor.
Figure 5. A schematic diagram of the adaptive iterative update with the damping factor.
Sensors 20 05643 g005
Figure 6. Illustration of the simulation scenario with 10 radio beacons. (a) The simulation scenario visualized in OpenGL, where the red flag with yellow edges denotes the desired landing site and points in red and green, respectively, denote standby and working beacons. (b) The designed landing trajectory in the L frame.
Figure 6. Illustration of the simulation scenario with 10 radio beacons. (a) The simulation scenario visualized in OpenGL, where the red flag with yellow edges denotes the desired landing site and points in red and green, respectively, denote standby and working beacons. (b) The designed landing trajectory in the L frame.
Sensors 20 05643 g006
Figure 7. Control profiles of the designed trajectory in the simulation scenarios: (a) Triaxial specific force profile in the B frame. (b) Triaxial angular rate profile in the B frame.
Figure 7. Control profiles of the designed trajectory in the simulation scenarios: (a) Triaxial specific force profile in the B frame. (b) Triaxial angular rate profile in the B frame.
Sensors 20 05643 g007
Figure 8. Estimation errors from the proposed tightly-coupled navigation scheme. (a) Triaxial position errors with 3 σ uncertainty bound. (b) Triaxial velocity errors with the 3 σ uncertainty bound.
Figure 8. Estimation errors from the proposed tightly-coupled navigation scheme. (a) Triaxial position errors with 3 σ uncertainty bound. (b) Triaxial velocity errors with the 3 σ uncertainty bound.
Sensors 20 05643 g008
Figure 9. Performance of the proposed scheme in the mapping of the beacon configuration. (a) Residuals of all estimated beacon locations. (b) The beacon map and ground track before and after the estimation.
Figure 9. Performance of the proposed scheme in the mapping of the beacon configuration. (a) Residuals of all estimated beacon locations. (b) The beacon map and ground track before and after the estimation.
Sensors 20 05643 g009
Figure 10. Performance analyses of different localization schemes from 100 independent Monte Carlo runs. (a) Root-mean-square errors (RMSEs) in the position estimation. (b) Averaged computational cost.
Figure 10. Performance analyses of different localization schemes from 100 independent Monte Carlo runs. (a) Root-mean-square errors (RMSEs) in the position estimation. (b) Averaged computational cost.
Sensors 20 05643 g010
Figure 11. Comparison of the position estimation accuracy from different numbers of beacons.
Figure 11. Comparison of the position estimation accuracy from different numbers of beacons.
Sensors 20 05643 g011
Figure 12. Comparison of the position estimation accuracy from different numbers of beacons.
Figure 12. Comparison of the position estimation accuracy from different numbers of beacons.
Sensors 20 05643 g012
Figure 13. The circular error probable (CEP) of the proposed method from 100 independent Monte Carlo runs.
Figure 13. The circular error probable (CEP) of the proposed method from 100 independent Monte Carlo runs.
Sensors 20 05643 g013
Table 1. The true locations of all ground beacons.
Table 1. The true locations of all ground beacons.
Beacon IDLocations in L (m)Beacon IDLocations in L (m)
1 10,467.97 , 1353.06 , 0 2 [ 7647.32 , 1719.73 , 0 ]
3 7245.89 , 1587.17 , 0 4 5465.18 , 2107.20 , 0
5 5149.39 , 3005.92 , 0 6 2578.25 , 2027.77 , 0
7 2145.57 , 876.16 , 0 8 421.43 , 2305.71 , 0
9 676.64 , 2427.07 , 0 10 1649.64 , 1817.82 , 0
Table 2. Sensor parameters ( 1 σ ).
Table 2. Sensor parameters ( 1 σ ).
ParameterValueParameterValue
Accelerometer bias level 0.29   mg Gyro bias level 4.86 × 10 4   rad / s
Accelerometer random walk 8.97 × 10 2   m g / H z Gyro random walk 2.22 × 10 5   r a d / ( s · H z )
Accelerometer white noise 2.14 × 10 3   m g / ( s · H z ) Gyro white noise 4.98 × 10 6   r a d / ( s 2 · H z )
Beacon range noise 10   m Altimeter range noise 0.5   m
Table 3. The performance of different algorithms.
Table 3. The performance of different algorithms.
AlgorithmPosition Averaged RMSE (ARMSE) (m)Velocity ARMSE (m/s)CPU Times (ms)
Scheme 129.712.6920.26
Scheme 228.602.7526.06
Scheme 327.302.6820.93

Share and Cite

MDPI and ACS Style

Mu, R.; Li, Y.; Luo, R.; Su, B.; Shan, Y. A Distributed Radio Beacon/IMU/Altimeter Integrated Localization Scheme with Uncertain Initial Beacon Locations for Lunar Pinpoint Landing. Sensors 2020, 20, 5643. https://doi.org/10.3390/s20195643

AMA Style

Mu R, Li Y, Luo R, Su B, Shan Y. A Distributed Radio Beacon/IMU/Altimeter Integrated Localization Scheme with Uncertain Initial Beacon Locations for Lunar Pinpoint Landing. Sensors. 2020; 20(19):5643. https://doi.org/10.3390/s20195643

Chicago/Turabian Style

Mu, Rongjun, Yuntian Li, Rubin Luo, Bingzhi Su, and Yongzhi Shan. 2020. "A Distributed Radio Beacon/IMU/Altimeter Integrated Localization Scheme with Uncertain Initial Beacon Locations for Lunar Pinpoint Landing" Sensors 20, no. 19: 5643. https://doi.org/10.3390/s20195643

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