Next Article in Journal
A Novel Composite Pitch Control Scheme for Floating Offshore Wind Turbines with Actuator Fault Consideration
Next Article in Special Issue
Distributed Lyapunov-Based Model Predictive Control for AUV Formation Systems with Multiple Constraints
Previous Article in Journal
Experimental Study on Mechanical Properties of Marine Mud Slurry Treated by Flocculation-Solidification-High Pressure Filtration Combined Method
Previous Article in Special Issue
Numerical Investigation on Interactive Hydrodynamic Performance of Two Adjacent Unmanned Underwater Vehicles (UUVs)
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

An Underwater Distributed SLAM Approach Based on Improved GMRBnB Framework

School of Marine Science and Technology, Northwestern Polytechnical University, Xi’an 710072, China
*
Author to whom correspondence should be addressed.
J. Mar. Sci. Eng. 2023, 11(12), 2271; https://doi.org/10.3390/jmse11122271
Submission received: 24 September 2023 / Revised: 28 October 2023 / Accepted: 27 November 2023 / Published: 29 November 2023
(This article belongs to the Special Issue Marine Autonomous Vehicles: Design, Test and Operation)

Abstract

:
Multi-vehicle collaborative mapping proves more efficient in constructing maps in unfamiliar underwater environments in comparison to single-vehicle methods. One of the pivotal hurdles of Simultaneous Localization and Mapping (SLAM) with multiple underwater vehicles is map registration. Due to the inadequate characteristics of the underwater grid maps, matching map features poses a challenge, and outliers between maps add to the complexity. We propose an algorithm to solve this problem. This approach employs the Gaussian Mixture Robust Branch and Bound (GMRBnB) algorithm with an interior point filtering technique. Feature point extraction, registration using the GMRBnB algorithm, inlier extraction based on density, and registration of the inlier are performed to obtain a more precise transformation matrix. The results of the simulation and experiments demonstrate that this technique heightens outlier tolerance and reinforces map registration accuracy. The proposed approach surpasses Iterative Closest Point (ICP) and Normal Distributions Transform (NDT) methods with respect to map registration quality.

1. Introduction

Autonomous Underwater Vehicles (AUVs) have become widely used in various applications including resource exploration [1], environmental surveillance [2], underwater rescue [3], and military operations [4]. AUVs require accurate positioning and the ability to map underwater environments in unknown and challenging conditions to ensure safe and functional operation. AUVs can increase their autonomy in task performance by integrating Simultaneous Localization and Mapping technology (SLAM). SLAM algorithms enable AUVs to determine the location of random beacons for navigation purposes [5], to perform 3D surveys of the underwater environment using multibeam sonar to preserve volumetric data of the free space, and to perform planning tasks [6]. Vision-based underwater SLAM estimates self-motion by extracting and matching features from successive images and backend position optimization [7,8]. However, despite the affordable cost of cameras, vision-based underwater SLAM suffers from significant limitations. Cameras possess limited detection range and can solely be operated in well-lit, hygienic settings. In contrast, sonar emits sound waves in single or multiple directions and analyses the strength and return time of each echo to acquire information concerning the surrounding environment. A representative device is shown in Figure 1. Sonar-based techniques are currently prevalent in the development of underwater SLAM [9].
Underwater map creation is a crucial purpose of underwater vehicles, with tasks such as underwater docking or search necessitating an accurate and efficient mapping process. However, undertaking such tasks poses an array of challenges for a solitary vehicle in vast underwater environments. These include unstructured scenes, sensor error accumulation, and the inability to utilize GPS signals [10], hence, achieving high precision requirements represents a considerable challenge for a single vehicle. In recent years, researchers have emphasized the study of multi-vehicle collaborative mapping, which entails registering local maps generated by individual vehicles to construct a global map. Given the limitations of underwater communication, it is more practical to construct underwater maps offline and align multiple submaps to create a large-scale underwater map. Map registration methods can be classified into two main types: those with known initial poses and those with unknown initial poses. In the instance of unknown initial poses, map registering is achieved primarily through intersection, optimization, and feature matching. Intersection methods use sensor measurements during encounters to calculate the transformation relationships between local maps through optimization algorithms. However, achieving exactitude in both sensor measurements and observation angles is crucial for these methods. Optimization-based techniques chiefly rely on artificial intelligence algorithms such as Genetic Algorithms to scan for overlapping regions between maps. On the other hand, feature matching-based methods predominantly utilize conventional geometric features such as points and lines. The main objective pertains to the circumstances of distributed underwater SLAM scenarios using current forward-looking sonar technology. Within this framework, optimal precision of underwater map registration is of the utmost importance. Specifically, in situations where real-time restrictions are not crucial, the accent is laid on achieving heightened levels of precision in registering underwater cartographic representations.

2. Related Work

SLAM, which utilizes visual cameras as the primary sensor, has demonstrated impressive results under well-illuminated conditions. To extract line features from continuous sonar data streams in underwater environments, the Hough transform is a viable method [11]. Additionally, bespoke feature extraction techniques can be devised to account for distortions arising from motion, continuous data streams, low scanning frequencies, and high noise levels [12].
Utilizing sonar for underwater SLAM provides significant advantages such as a wider range of applicability, longer detection distances, and it overcomes limitations associated with underwater optics [13]. This is achieved by extracting environmental features to construct a 2D grid map, utilizing forward-looking sonar. Furthermore, the data from several sensors, including Inertial Measurement Unit (IMU) and Doppler Velocity Log (DVL) data, can be fused to estimate the AUVs orientation. Preprocessing methods such as beam segmentation, noise elimination, and threshold filtering can be used to make Mechanical Scanning Imaging Sonar (MSIS) data appear similar to laser data, thus allowing for the use of established 2D SLAM frameworks [14]. A scan formation module that employs sliding windows can be used to input the created scans into a modified SLAM algorithm when dealing with slow-scanning sonars [15]. To minimize errors, an Extended Kalman Filter (EKF) technique is used to reduce errors in the relative motion vectors presented in the robot’s coordinate system. Sonar-Visual Inertial (SVIn) improves the robust initial method and incorporates depth measurements obtained from pressure sensors into tightly-coupled optimization formulations to address drift and localization loss. This enables the use of sonar data in the OKVIS framework [16]. An improved version, SVIn2, utilizes acoustic range data to strengthen reconstruction and localization. It combines depth information for sturdy initialization, scale refinement, and helps mitigate drift through tightly-coupled integration [17]. A neural network approach is taken in Ref. [18] for style transfer between sonar and image information, using Super Glue for acoustic feature matching. Calibration algorithms have been developed specifically for sonar and images to boost the precision of extrinsic calibration in low-light situations, resulting in enhanced robustness and localization accuracy [19].
Incorporating Kalman filtering and motion modellng is shown to yield smoother motion trajectories [20]. The inclusion of other geographic information, such as magnetic field data, reduces the odometry position drift considerably [21]. Ref. [22] presented a module and hierarchical approach to learning policies for exploring 3D environments, utilizing analytical path planners and a learned SLAM module, and employing both global and local policies. Multi-robot underwater SLAM presents significant challenges owing to the difficulty of underwater communication. This challenge makes it arduous for robots to exchange information. Consequently, special update strategies have been devised to collaboratively maintain a pose graph, transmitting the most relevant information within the constraints of communication bandwidth to optimize the quality of the collaborative map [23]. Measurement results can be condensed into small-scale acoustic data packets, providing precise localization and mapping outcomes in acoustic channels of low bandwidth, high noise levels, and unreliability [24]. The exchange of visual data between agents can be minimized by utilizing low-dimensional hashes, thereby curtailing data transmission time [25]. To facilitate inter-robot loop closure, Swarm SLAM employs a novel priority ordering method that reduces communication [26]. DRACo-SLAM attains resilience to erroneous loop closures and sustains low bandwidth demands for inter-robot communication by solely conveying scene descriptors between robots, employing the Pairwise Consistency Maximization (PCM) method [27].
In distributed SLAM, submap registration is a pivotal stage. Iterative Closest Point (ICP) proves unreliable in situations with deficient or degraded geometric features, which results in significant trajectory drift in graph optimization solutions. Given the uncertainty of the data in the underwater environment, a probabilistic implementation of ICP is utilized to align the data [28]. For the feature registration problem, the first globally optimal algorithm for rigid (Euclidean) registration of two 3D point sets was proposed by Ref. [29]. The 2D-3D point set registration problem is addressed in Ref. [30] through the use of a combined approach that integrates a global optimal rotation search and translational grid search. A branch-and-bound approach is used to investigate the solution space of 3D rigid motion. This led to achieving the global optimum for the 3D rigid Gaussian mixture alignment problem with L2 distance metric [31]. Another proposed solution method, Gaussian Mixture Robust Branch and Bound (GMRBnB), proved to be globally optimal with improved accuracy and robustness. The Gaussian Mixture Model (GMM) is utilized to build a dependable objective function. In addition, a new relaxation boundary is established, and an approach is put forward to surmount the issue of local minima that plagues traditional optimization methods. The GMRBnB algorithm’s sensitivity and dependence on initialization is also addressed. In this study, we utilize AUV to create grid maps of various regions using the SLAM algorithm. We subsequently register multiple grid maps, enhance the GMRBnB algorithm, and successfully accomplish the distributed creation of large-scale underwater maps.

3. Proposed Distributed SLAM Method

To achieve underwater distributed SLAM, this paper presents an enhanced algorithm based on GMRBnB that utilizes a single vehicle with multiple sensors for underwater SLAM. The collected data from various vehicles is then used for distributed SLAM to accomplish map construction of a vast underwater setting. The process of the algorithm is illustrated in Algorithm 1. The corresponding flow chart is shown in Figure 2.    
Algorithm 1: The overall algorithm process of Underwater Distributed SLAM
  Input: Data collected by BlueRov
  Output: A large scale grid map by registering multiple grid submaps
 1  Single underwater vehicle SLAM.
 2  Calculate the Oriented FAST and Rotated BRIEF (ORB) point of the submaps and save the 2D point set data.
 3  Use the GMRBnB algorithm to deduce the rotation and translation matrix, which is applied to the second point set, registering the two point sets.
 4  The registered point set should undergo the Nearest Neighbor Density Estimation (NNDE) method to determine the density. Set the threshold to identify the inlier that corresponds to regions of greater density.
 5  Save the interior points along with their corresponding points in the original point set. Next, conduct GMRBnB registration on the interior points to calculate a more precise transformation matrix prior to register the underwater maps.

3.1. Submap Construction

The process of submap construction utilizes the approach detailed in Ref. [32] for the construction of underwater grid maps. Acquisition of sonar images is followed by their transformation into sparse point cloud data, using threshold segmentation and distance-constrained filtering. Integration of data from DVL, IMU, and Mechanical Scanning Imaging Sonar (MFLS) sources is carried out to produce an accurate occupancy grid map. We set the grid resolution to 0.05 m.

3.2. Clustering Filtering and Density-Based Sampling for ORB Feature

The methodology is outlined in Algorithm 2. The ORB feature points are extracted and their corresponding GMM model is calculated. Employing voxel-based density sampling, a collection of evenly dispersed density points is acquired.    
Algorithm 2: Density Uniformization for ORB Feature Point Extraction
  Input: two submaps
  Output: ORB feature point set and its GMM model
 1  Load the submaps and extract ORB feature points.
 2  Cluster the feature points and remove the clear outlier.
 3  Calculate the mean distance between the feature points.
 4  Choose a suitable voxel size based on the mean distance and create a KD-tree.
 5  Conduct nearest neighbor search to produce a voxel grid and carry out density sampling in each voxel. Randomly select one point from each voxel to serve as a density sampling point.
 6  Proceed to compute the GMM for the ORB feature point set.
 7  Return ORB feature points and its GMM model.

3.3. GMRBnB Registration

The BnB algorithm, a discrete global optimization framework, is implemented to tackle non-convex and NP-hard problems, including registration problems. It navigates the complete solution space in pursuit of theoretically guaranteed global optima. The algorithm’s two guiding principles are recursive partitioning of the solution space through branching and bounding by calculating lower and upper bounds for optimal solutions in each confined sub-box.
The algorithm utilizes these boundaries to refine the solution space and remove sub-boxes that do not contain the optimal solution. Convergence occurs when the lower and upper limits for the optimal solution are adequately tight, reaching the predetermined threshold. The efficacy of this algorithm lies in the precise estimation of the lower and upper limits during branching.
f L ( B ) min E ( B ) f U ( B )
E ( B ) is the function that requires optimizing. f L ( B ) represents a lower estimate function of the objective function, while f U ( B ) represents an upper estimate function. Technical abbreviations such as BnB-based and objective function have to be explained upon first use. f U ( B ) is typically derived by substituting any value from the solution space into the objective function. The convergence of BnB-based algorithms is assured by the properties of the bounding functions.
lim σ ( B ) 0 f L ( B ) f U ( B ) = 0
σ ( B ) is the diameter of solution subspace B.
Based on the registration problem in this paper, the parameterization of the solution space is as follows. The rotation solution space is B = { ( θ , t ) , θ [ π , π ] , t [ t , t + ] } , and the partition strategy involves dividing the solution space along each dimension’s center, resulting in 2 3 = 8 subsets after one partition.
For the two-dimensional transformation solution space, considering the center as the origin, the relaxation upper bound R U ( B ) and lower bound R L ( B ) of the objective function for the GMM corresponding to sets X and Y are derived. The convergence of these bounds is also proven in Ref. [33].
The probability density of observing a point x given a GMM is defined as p ( x G ) = i = 1 k ω i N x μ i , σ i 2 , with mixture weights w i , means u i , variances σ i 2 and the number of gaussian components k. The distance between GMM G X = ω i X , X i , σ i X 2 i = 1 m and G Y = ω j Y , Y j , σ j Y 2 j = 1 n is D ( θ , t ) with a rigid transformation function T ( G , θ , t ) to represent the rotation and translation.    
D ( θ , t ) = R 2 p x T G X , θ , t p x G Y 2 d x
After expansion, mainly the cross term changes, all terms except for the point-to-point residuals are easy to calculate, so the focus is to limit the point-to-point L2 residuals e L , X i , Y j ( θ , t ) . The derivation is given and the final residual relationship is obtained [33].
e L , X i Y j ( θ , t ) = max Y j 2 X i 2 ρ , 0 , α β max min l , l + ρ , 0 , α > β
where α is the angle between a particular solution and the origin, β is the range of the rotation solution space, and  ρ is the radius of the translation relaxation circle.
l = Y j R θ X i 2 , l + = Y j R θ + X i 2
R U ( B ) = i = 1 m j = 1 n ω i ω j N exp e X i , Y j θ c , t c 2 2 σ i 2 + σ j 2
R L ( B ) = i = 1 m j = 1 n ω i ω j N exp e L , X i , Y j ( θ , t ) 2 2 σ i 2 + σ j 2
where e L , X i , Y j ( θ , t ) is the lower bound of residual e X i , Y j ( θ , t ) . The maximum error in Formula (6) is represented by the value of any solution space, serving as an upper bound for calculation purposes. In contrast, Formula (7) denotes the lower bound for a feasible solution, indicating the minimum error value within the solution space. During the iterative process, the solution space undergoes branching and reduction, which leads to a gradual decrease in the solution space. Consequently, the lower bound error exhibits a gradual increase. Formulas (6) and (7) will eventually converge as the differences between them gradually decrease. Once the difference reaches a particular threshold or number of iterations, the calculation terminates. Algorithm 3 presents the pseudocode for GMRBnB Registration.

3.4. GMRBnB with NNDE for the Inlier

Due to the inaccuracy of sensor measurements, registering submaps is challenging. The presence of outlier or noise causes deviations in the registration results. In theory, the removal of the outlier could improve the registration effect. This paper uses NNDE for outlier removal. For the preliminary registration outcomes, we apply NNDE for estimating the density of the feature points. For each data point, we search for its closest neighbors in the feature space utilizing a KD tree. We compute the mean distance between the nearest neighbor points, normalize the density estimation values through max-min normalization, and classify the data points as inliers or outliers based on the density threshold. Data points with density estimation values exceeding the threshold are designated as inliers, while those falling below the threshold are deemed as outliers. We identify the associated points in the original point sets and implement registration to achieve enhanced alignment. Algorithm 4 presents the pseudocode for this method.
Algorithm 3: Global Space Registration Algorithm using GMRBnB
Jmse 11 02271 i001
Algorithm 4: GMRBnB with NNDE for inlier registration
  Input: Original point sets A and B, initial transformation matrix from the first registration, density threshold.
  Output: Estimated inlier and ( θ , t ) .
 1  Spatial Data Structure Construction: The first step involves loading the point cloud data into a KDTree to efficiently speed up the nearest neighbor search process. Computation of Mean Distances to K Nearest Neighbors: The calculation of the average distances to the K closest points from each point is carried out. The optimal value for K is usually determined through experimentation whereby the K value that produces the most favorable inlier extraction outcomes is selected.
 2  Calculation of Density: Upon completion of density estimates, the outcomes are visualized as density maps.
 3  Selecting Density Thresholds: Density is computed by using the derivative of distances as a parameter for density.
 4  Visualization: Density thresholds, indicated by threshold values, are selected to differentiate between points located in high-density and low-density areas. Points in high-density regions are labeled as ‘inlier’, while points in low-density regions are considered ‘outlier’.
 5  To extract an inlier, a point indexing mechanism is used to identify the corresponding points in the original data, which then serve as the initial point set for further registration.
 6  Perform GMRBnB registration on the inlier.
 7  Rotate and translate the original submaps, register them, and include the registered submap in the submap queue.
 8  Choose two submaps from the submap queue and align them through registration.

4. Experimental Results and Analysis

To ascertain the efficacy of the proposed approach, synthetic and real-world data were employed in conducting experiments. In this paper, GMRBnB’s convergence and precision were tested through simulations, followed by its assessment based on NNDE interior point extraction. Subsequently, experiments were carried out in an actual lake environment, with the consistency of the algorithm confirmed through quantitative analysis of distributed SLAM map construction results.
The algorithms were implemented using MATLAB 2017B, PyCharm 2021.3.3 (Professional Edition), and Python 3.7, operating on an Ubuntu 18.04 LTS system with ROS1. All experiments were conducted on a laptop equipped with an Intel(R) Core(TM) i5-7300HQ CPU @ 2.50 GHz and 24 GB of memory.

4.1. Simulation Experiments

4.1.1. Convergence Validation

The range of convergence is impacted by the standard deviation σ of the Gaussian components that corresponds to the peak width of the Gaussian distribution, based on the characteristics of the objective function. Thus, after numerous trials and comparisons, the standard deviation σ of the Gaussian components was set to 0.1 in all experiments. For the GMRBnB experiments in this study, the convergence threshold ∈ was established at 0.01.
To exhibit the convergence of the suggested lower and upper limits, a duo of artificial measurement sets (with m = n = 50) served as input. The resultant convergence curve is illustrated in Figure 3, where the difference between the lower bound and upper bound is diminishing. With each iteration, the algorithm achieves the optimal solution.

4.1.2. Registration with Different Outlier and Noise Rates

In this section, the precision of the suggested algorithm is illustrated via four experiments employing synthetic data under varying conditions such as noise levels and outlier ratios.
The first measurement set is created by distributing m random points within a square [ 1 , 1 ] 2 . Random rotations within the [ π , π ] range and random translations within the [ 1 , 1 ] 2 range are applied to the measurement set to obtain the corresponding transformed measurement set Y. To simulate outlier, additional points are randomly added. The measurement set is perturbed by random noise addition to imitate noise levels. We register the point sets Y and X to obtain the rotation and translation, and calculate the error between them and the actual rotation and translation.
The findings are depicted in Figure 4. Each subfigure (a)–(d) showcases two digits representing the results attained prior and after registration via the proposed method and distinct parameter settings specified in the subcaptions. The origin point set is displayed in red while the target point set is displayed in black. The rotational error and translation error for each instance are as follow: (a) 0.024 and 0.0044, (b) 0.228 and 0.0087, (c) 0.323 and 0.0113, (d) 0.493 and 0.0127.

4.1.3. Registration with NNDE

The employment of a supplementary registration approach that eliminates anomalies is founded on a widely held view that outlier and noise can deeply affect the enrollment outcome of the GMRBnB algorithm. By eliminating certain anomalies and noise in advance, their interference can be lessened, which can result in more precise translation and rotation matrices and improved enrollment outcomes. To better align the experiments with real-world scenarios, we used the RPLIDAR S3 sensor from Slamtec Corporation for registration. The sensor operates at a scanning frequency of 10 Hz and has a ranging resolution of 10 millimeters. To introduce significant translational and rotational differences in the registration data, we selected data frames with a temporal separation of 10 frames. Due to the rising computational complexity resulting from expanding the number of features extracted for matching grid maps, and the exponential growth in computational load with the point count, we have decided to subsample the data from the LIDAR sensor. Please see Figure 5 for the illustrated results.

4.1.4. Analysis

The following conclusion was derived from the conducted experimentation:
  • As the outlier rate and noise level increase, the rotation error and translation error gradually increase. However, the algorithm still demonstrates accuracy with outlier and noise, as it converges;
  • Additionally, higher rates of outlier or noise levels adversely affect computation time due to their influence;
  • Eliminating the outlier through outlier filtering for the initial registration results can improve secondary registration results in some way.

4.2. Experiments in Real Environments

This section presents field experiments conducted to evaluate the proposed GMRBnB algorithm using inlier filtering and compare it with ICP and Normal Distributions Transform methods. The experiments were conducted at Lake Liquan in Shaanxi Province, China. The satellite map of the area is displayed, and the area is subdivided into three areas in Figure 6. Data is collected from each using a BlueRov in Figure 7. The sensor data is saved as a rosbag package, SLAM is performed on each sub-area, and a grid map is obtained. One AUV is used to simulate the collection of data by multiple AUVs in sub-areas. This approach avoids data errors due to differing AUV performance and sensor installation deviations, eliminates the requirement for sensor calibration, and reduces the cost and difficulty of experiments. During the experiment in Figure 7, a small watercraft was navigated towards the target environment where the BlueROV was controlled to conduct SLAM experiments underwater. The working frequency of m750d is selected as 1.2 MHz. The sensor possesses a maximum detection range of 40 m and a minimum detection range of 0.1 m, while the distance resolution stands at 2.5 mm. The sensor features a horizontal measurement angle of 130° and a vertical measurement angle of 20°.
Figure 8 displays the results for the registration of the grid map. We mark the boundaries of the submaps with a red dotted box to highlight them. The white color indicates the passable area, while the grey and green shade represents the unknown area where it is uncertain whether the grid can be accessed. The black areas in the lower left and upper right corners of the map indicate missing data when registering the submaps.
The resemblance between the map registering the outcome and the map produced from an individual mapping procedure can be assessed using measures such as Mean Squared Error (MSE) and Structural Similarity (SSIM). MSE is employed to indicate differences between images. It computes the squared value of the mean difference between corresponding pixels in two images. The smaller the MSE value, the more similar the two images are. SSIM is utilized to evaluate the similarity between the structure and quality of the two images considering not only brightness and contrast but also the structural information. The value of SSIM is within the range of −1 to 1. The closer the value is to 1, the more similar the images are.
Figure 9 illustrates the results, showing that the proposed method in this paper achieves higher SSIM values compared to ICP and NDT. Moreover, the MSE of our method is lower. Higher SSIM values indicate greater structural similarity between the reconstructed image and the ground truth, highlighting the accuracy and reliability of our method. Additionally, the lower MSE reinforces the effectiveness and precision of our method in minimizing reconstruction errors. These findings demonstrate that our method outperforms ICP and NDT in terms of these metrics. Multi-AUVs registration sequencing is an important issue as registration errors can accumulate. Our experiment demonstrated insignificant effects as only three maps were employed. However, if the AUV map registration encompasses more maps, sequential registration strategies ought to be deliberated to minimize the overall registration error of multiple maps. The proportion of overlap between AUV search regions is another critical aspect of multi-AUVs research, and a minimum level of overlap is necessary to guarantee reliable registration performance. We take consideration on this matter, yet have not come to a conclusion. The extent of overlap is linked to parameters such as the precision of single-vehicle SLAM, sensor functionality, and registration algorithm efficacy, and demands further quantitative analysis.

5. Conclusions

This study centers on the mapping of multi-vehicle distributed SLAM. The paper introduces a notion of mapping each vehicle individually in advance within a pre-determined search area and then combining these individual maps to generate a complete map while doing away with inter-vehicle communication. A 3-DOF based registration approach is suggested to tackle the point-set registration issue. The article outlines a distributed approach for constructing an underwater map, incorporating a dual-utilization of GMRBnB algorithm and an inlier selection strategy. Firstly, the grid map features of several vehicles are extracted and the GMRBnB algorithm is applied for the initial registration. The outcomes of this preliminary registration undergo inlier selection, grounded on density. Subsequently, another registration is executed, resulting in an improved transformation matrix. The algorithm overcomes the obstacles presented by inadequate feature quality by grid maps and probable anomalies in overlapping submap regions, hence successfully accomplishing registration. When compared with ICP and NDT methods, the algorithm performs better in terms of MSE and SSIM metrics. The proposed approach has proven successful in constructing underwater grid maps and is appropriate for distributed underwater grid map construction.

6. Future Work

This paper employs an enhanced GMRBnB algorithm to register the grid maps generated by multiple underwater vehicles into a larger underwater map. Future work involves enhancing the mapping accuracy of individual autonomous underwater vehicles. Challenges still exist in extracting complete environmental features due to noise and clutter interference, along with map drift caused by data matching failures. Secondly, it is recommended to add more sensors to enhance the efficiency of underwater vehicle SLAM. For instance, investigating the integration of cameras and image processing to enhance localization optimization may yield positive results. Additionally, refining the fundamental components of the GMRBnB algorithm, particularly by enhancing the upper and lower bounding functions, is crucial. The objective is to adjust these functions to allow for real-time execution on embedded platforms. Finally, the future work regarding collaborative efforts among multiple underwater vehicles in real-time is an important aspect. Possible strategies for advancing underwater mapping and navigation in the context of autonomous underwater vehicle operations could include vehicles ascending to the water surface or exchanging data through communication devices underwater, thus eliminating the need for offline processing.

Author Contributions

Methodology, D.X. and C.C.; Software, D.X.; Resources, F.Z. and C.C.; Writing—original draft, D.X.; Visualization, D.X.; Funding acquisition, F.Z. All authors have read and agreed to the published version of the manuscript.

Funding

This study was supported by the National Key R&D Program of China (2023YFC2808400).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The original contributions presented in the study are included in the article, further inquiries can be directed to the corresponding author.

Acknowledgments

Special thanks are given to Xin-Yi Li for his assistance throughout this work.

Conflicts of Interest

The authors declare that the research was conducted in the absence of any commercial or financial relationships that could be construed as a potential conflict of interest.

References

  1. Ohta, Y.; Yoshida, H.; Ishibashi, S.; Sugesawa, M.; Fan, F.H.; Tanaka, K. Seabed resource exploration performed by AUV “Yumeiruka”. In Proceedings of the OCEANS 2016 MTS/IEEE Monterey, Monterey, CA, USA, 19–23 September 2016; pp. 1–4. [Google Scholar]
  2. Hodne, L.M.; Leikvoll, E.; Yip, M.; Teigen, A.L.; Stahl, A.; Mester, R. Detecting and suppressing marine snow for underwater visual slam. In Proceedings of the IEEE/CVF Conference on Computer Vision and Pattern Recognition, New Orleans, LA, USA, 19–20 June 2022; pp. 5101–5109. [Google Scholar]
  3. Venkatesan, S. AUV for Search & Rescue at sea—An innovative approach. In Proceedings of the 2016 IEEE/OES Autonomous Underwater Vehicles (AUV), Tokyo, Japan, 6–9 November 2016; pp. 1–9. [Google Scholar]
  4. Hagen, P.E.; Storkersen, N.; Marthinsen, B.E.; Sten, G.; Vestgard, K. Military operations with HUGIN AUVs: Lessons learned and the way ahead. In Proceedings of the Europe Oceans 2005, Brest, France, 20–23 June 2005; Volume 2, pp. 810–813. [Google Scholar]
  5. Liu, M.; Dong, T.; Zhang, L. Underwater SLAM navigation algorithm based on random beacons. Syst. Eng. Electron. 2015, 37, 2830–2834. [Google Scholar]
  6. Suresh, S.; Sodhi, P.; Mangelson, J.G.; Wettergreen, D.; Kaess, M. Active SLAM using 3D submap saliency for underwater volumetric exploration. In Proceedings of the 2020 IEEE International Conference on Robotics and Automation (ICRA), Paris, France, 31 May–31 August 2020; pp. 3132–3138. [Google Scholar]
  7. Kim, A.; Eustice, R.M. Active visual SLAM for robotic area coverage: Theory and experiment. Int. J. Robot. Res. 2015, 34, 457–475. [Google Scholar] [CrossRef]
  8. Hong, S.; Kim, J.; Pyo, J.; Yu, S.C. A robust loop-closure method for visual SLAM in unstructured seafloor environments. Auton. Robot. 2016, 40, 1095–1109. [Google Scholar] [CrossRef]
  9. Wang, J.; Bai, S.; Englot, B. Underwater localization and 3D mapping of submerged structures with a single-beam scanning sonar. In Proceedings of the 2017 IEEE International Conference on Robotics and Automation (ICRA), Singapore, 29 May–3 June 2017; pp. 4898–4905. [Google Scholar]
  10. Guth, F.; Silveira, L.; Botelho, S.; Drews, P.; Ballester, P. Underwater SLAM: Challenges, state of the art, algorithms and a new biologically-inspired approach. In Proceedings of the 5th IEEE RAS/EMBS International Conference on Biomedical Robotics and Biomechatronics, Sao Paulo, Brazil, 12–15 August 2014; pp. 981–986. [Google Scholar]
  11. Ribas, D.; Ridao, P.; Tardós, J.D.; Neira, J. Underwater SLAM in a marina environment. In Proceedings of the 2007 IEEE/RSJ International Conference on Intelligent Robots and Systems, San Diego, CA, USA, 29 October–2 November 2007; pp. 1455–1460. [Google Scholar]
  12. Matsebe, O.; Mpofu, K.; Agee, J.T.; Ayodeji, S.P. Corner features extraction: Underwater SLAM in structured environments. J. Eng. Des. Technol. 2015, 13, 556–569. [Google Scholar] [CrossRef]
  13. Cheng, C.; Wang, C.; Yang, D.; Liu, W.; Zhang, F. Underwater SLAM Based on Forward-Looking Sonar. In Cognitive Systems and Signal Processing, Proceedings of the 5th International Conference, ICCSIP 2020, Zhuhai, China, 25–27 December 2020; Revised Selected Papers 5; Springer: Berlin/Heidelberg, Germany, 2021; pp. 584–593. [Google Scholar]
  14. Xu, Z.; Qiu, H.; Dong, M.; Wang, H.; Wang, C. Underwater Simultaneous Localization and Mapping Based on 2D-SLAM Framework. In Proceedings of the 2022 IEEE International Conference on Unmanned Systems (ICUS), Guangzhou, China, 28–30 October 2022; pp. 184–189. [Google Scholar]
  15. Chen, L.; Yang, A.; Hu, H.; Naeem, W. RBPF-MSIS: Toward rao-blackwellized particle filter SLAM for autonomous underwater vehicle with slow mechanical scanning imaging sonar. IEEE Syst. J. 2019, 14, 3301–3312. [Google Scholar] [CrossRef]
  16. Rahman, S.; Li, A.Q.; Rekleitis, I. Svin2: An underwater slam system using sonar, visual, inertial, and depth sensor. In Proceedings of the 2019 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Macau, China, 3–8 November 2019; pp. 1861–1868. [Google Scholar]
  17. Rahman, S.; Quattrini Li, A.; Rekleitis, I. SVIn2: A multi-sensor fusion-based underwater SLAM system. Int. J. Robot. Res. 2022, 41, 1022–1042. [Google Scholar] [CrossRef]
  18. Jang, H.; Yoon, S.; Kim, A. Multi-session underwater pose-graph slam using inter-session opti-acoustic two-view factor. In Proceedings of the 2021 IEEE International Conference on Robotics and Automation (ICRA), Xi’an, China, 30 May–5 June 2021; pp. 11668–11674. [Google Scholar]
  19. Xu, S.; Luczynski, T.; Willners, J.S.; Hong, Z.; Zhang, K.; Petillot, Y.R.; Wang, S. Underwater visual acoustic SLAM with extrinsic calibration. In Proceedings of the 2021 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Prague, Czech Republic, 27 September–1 October 2021; pp. 7647–7652. [Google Scholar]
  20. Andriyanov, N.; Vasiliev, K. Using local objects to improve estimation of mobile object coordinates and smoothing trajectory of movement by autoregression with multiple roots. In Intelligent Systems and Applications, Proceedings of the 2019 Intelligent Systems Conference (IntelliSys) Volume 2, London, UK, 5–6 September 2019; Springer: Berlin/Heidelberg, Germany, 2020; pp. 1014–1025. [Google Scholar]
  21. Viset, F.; Helmons, R.; Kok, M. An extended Kalman filter for magnetic field SLAM using Gaussian process regression. Sensors 2022, 22, 2833. [Google Scholar] [CrossRef] [PubMed]
  22. Chaplot, D.S.; Gandhi, D.; Gupta, S.; Gupta, A.; Salakhutdinov, R. Learning to explore using active neural slam. arXiv 2020, arXiv:2004.05155. [Google Scholar]
  23. Pfingsthorn, M.; Birk, A.; Bülow, H. An efficient strategy for data exchange in multi-robot mapping under underwater communication constraints. In Proceedings of the 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems, Taipei, Taiwan, 18–22 October 2010; pp. 4886–4893. [Google Scholar]
  24. Ma, T.; Zhang, W.; Li, Y.; Zhao, Y.; Zhang, Q.; Mei, X.; Fan, J. Communication-constrained cooperative bathymetric simultaneous localisation and mapping with efficient bathymetric data transmission method. J. Navig. 2022, 75, 1000–1016. [Google Scholar] [CrossRef]
  25. Bonin-Font, F.; Burguera, A. Towards multi-robot visual graph-SLAM for autonomous marine vehicles. J. Mar. Sci. Eng. 2020, 8, 437. [Google Scholar] [CrossRef]
  26. Lajoie, P.Y.; Beltrame, G. Swarm-SLAM: Sparse Decentralized Collaborative Simultaneous Localization and Mapping Framework for Multi-Robot Systems. arXiv 2023, arXiv:2301.06230. [Google Scholar] [CrossRef]
  27. McConnell, J.; Huang, Y.; Szenher, P.; Collado-Gonzalez, I.; Englot, B. DRACo-SLAM: Distributed Robust Acoustic Communication-efficient SLAM for Imaging Sonar Equipped Underwater Robot Teams. In Proceedings of the 2022 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Kyoto, Japan, 23–27 October 2022; pp. 8457–8464. [Google Scholar]
  28. Palomer, A.; Ridao, P.; Ribas, D. Multibeam 3D underwater SLAM with probabilistic registration. Sensors 2016, 16, 560. [Google Scholar] [CrossRef] [PubMed]
  29. Yang, J.; Li, H.; Campbell, D.; Jia, Y. Go-ICP: A Globally Optimal Solution to 3D ICP Point-Set Registration. IEEE Trans. Pattern Anal. Mach. Intell. 2016, 38, 2241–2254. [Google Scholar] [CrossRef] [PubMed]
  30. Liu, Y.; Dong, Y.; Song, Z.; Wang, M. 2D-3D Point Set Registration Based on Global Rotation Search. IEEE Trans. Image Process. 2019, 28, 2599–2613. [Google Scholar] [CrossRef] [PubMed]
  31. Campbell, D.; Petersson, L. GOGMA: Globally-Optimal Gaussian Mixture Alignment. In Proceedings of the 2016 IEEE Conference on Computer Vision and Pattern Recognition (CVPR), Las Vegas, NV, USA, 27–30 June 2016; pp. 5685–5694. [Google Scholar] [CrossRef]
  32. Cheng, C.; Wang, C.; Yang, D.; Liu, W.; Zhang, F. Underwater localization and mapping based on multi-beam forward looking sonar. Front. Neurorobot. 2022, 15, 189. [Google Scholar] [CrossRef] [PubMed]
  33. Li, X.; Liu, Y.; Lakshminarasimhan, V.; Cao, H.; Zhang, F.; Knoll, A. Globally Optimal Robust Radar Calibration in Intelligent Transportation Systems. IEEE Trans. Intell. Transp. Syst. 2023, 24, 6082–6095. [Google Scholar] [CrossRef]
Figure 1. Underwater vehicles and sonar. (a) BlueRov, (b) m750d sonar. The BlueROV has the capability of submerging to a depth of 100 m and can be equipped with multiple attachments, such as clamps or scanning sonar. The Oculus m750D multi-beam imaging sonar features two working frequencies: 750 kHz/1.2 MHz, with the detection range of 120 m/40 m, respectively.
Figure 1. Underwater vehicles and sonar. (a) BlueRov, (b) m750d sonar. The BlueROV has the capability of submerging to a depth of 100 m and can be equipped with multiple attachments, such as clamps or scanning sonar. The Oculus m750D multi-beam imaging sonar features two working frequencies: 750 kHz/1.2 MHz, with the detection range of 120 m/40 m, respectively.
Jmse 11 02271 g001
Figure 2. Framework of the GMRBnB method with the inlier selection. The process begins by extracting features from the submaps. If the density difference is significant, voxel downsampling must be applied. Next, the GMRBnB algorithm is employed to perform registration, followed by the use of the NNDE method for density calculation and detection of the inlier. The GMRBnB is again used to register the inlier to obtain a more precise transformation matrix. The final step involves registering the submaps.
Figure 2. Framework of the GMRBnB method with the inlier selection. The process begins by extracting features from the submaps. If the density difference is significant, voxel downsampling must be applied. Next, the GMRBnB algorithm is employed to perform registration, followed by the use of the NNDE method for density calculation and detection of the inlier. The GMRBnB is again used to register the inlier to obtain a more precise transformation matrix. The final step involves registering the submaps.
Jmse 11 02271 g002
Figure 3. Convergence curve of GMRBnB algorithm. The gap between the lower and upper bounds is converging to zero, and after hundreds of iterations, the proposed method can converge to the optimal solution.
Figure 3. Convergence curve of GMRBnB algorithm. The gap between the lower and upper bounds is converging to zero, and after hundreds of iterations, the proposed method can converge to the optimal solution.
Jmse 11 02271 g003
Figure 4. Registration results with different outlier rates and random noise levels. (a) The proportion of outlier is 0, and the proportion of random noise is 0, (b) The proportion of outlier is 33%, and the proportion of random noise is 0, (c) The proportion of outlier is 50%, and the proportion of random noise is 0, (d) The proportion of outlier is 50%, and the proportion of random noise is 5%.
Figure 4. Registration results with different outlier rates and random noise levels. (a) The proportion of outlier is 0, and the proportion of random noise is 0, (b) The proportion of outlier is 33%, and the proportion of random noise is 0, (c) The proportion of outlier is 50%, and the proportion of random noise is 0, (d) The proportion of outlier is 50%, and the proportion of random noise is 5%.
Jmse 11 02271 g004
Figure 5. GMRBnB registration via NNDE interior point extraction, (a) Source point set and target point set, (b) First registration result, (c) Inlier extraction using NNDE, (d) Second registration result.
Figure 5. GMRBnB registration via NNDE interior point extraction, (a) Source point set and target point set, (b) First registration result, (c) Inlier extraction using NNDE, (d) Second registration result.
Jmse 11 02271 g005
Figure 6. Satellite map of Liquan Lake.
Figure 6. Satellite map of Liquan Lake.
Jmse 11 02271 g006
Figure 7. Equipment and experiment, (a) is the BlueRov and m750d sonar, (b) is the experiment on the lake. We assembled the BlueRov and m750d in Figure 1 and controlled the BlueRov on the ship to conduct the experiments.
Figure 7. Equipment and experiment, (a) is the BlueRov and m750d sonar, (b) is the experiment on the lake. We assembled the BlueRov and m750d in Figure 1 and controlled the BlueRov on the ship to conduct the experiments.
Jmse 11 02271 g007
Figure 8. Registration quality results. (a) The first and second submaps registered result, (b) the second and third submaps registered result, (c) the result of registering (a,b).
Figure 8. Registration quality results. (a) The first and second submaps registered result, (b) the second and third submaps registered result, (c) the result of registering (a,b).
Jmse 11 02271 g008
Figure 9. Registration quality results. (a) MSE and (b) SSIM.
Figure 9. Registration quality results. (a) MSE and (b) SSIM.
Jmse 11 02271 g009
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

Zhang, F.; Xu, D.; Cheng, C. An Underwater Distributed SLAM Approach Based on Improved GMRBnB Framework. J. Mar. Sci. Eng. 2023, 11, 2271. https://doi.org/10.3390/jmse11122271

AMA Style

Zhang F, Xu D, Cheng C. An Underwater Distributed SLAM Approach Based on Improved GMRBnB Framework. Journal of Marine Science and Engineering. 2023; 11(12):2271. https://doi.org/10.3390/jmse11122271

Chicago/Turabian Style

Zhang, Feihu, Diandian Xu, and Chensheng Cheng. 2023. "An Underwater Distributed SLAM Approach Based on Improved GMRBnB Framework" Journal of Marine Science and Engineering 11, no. 12: 2271. https://doi.org/10.3390/jmse11122271

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