Next Article in Journal
An Algorithm with Iteration Uncertainty Eliminate Based on Geomagnetic Fingerprint under Mobile Edge Computing for Indoor Localization
Previous Article in Journal
Unstable Object Points during Measurements—Deformation Analysis Based on Pseudo Epoch Approach
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

High-Accuracy Relative Pose Measurement of Noncooperative Objects Based on Double-Constrained Intersurface Mutual Projections

School of Instrument Science and Engineering, Harbin Institute of Technology, Harbin 150001, China
*
Author to whom correspondence should be addressed.
These authors contributed equally to this work.
Sensors 2022, 22(23), 9029; https://doi.org/10.3390/s22239029
Submission received: 24 October 2022 / Revised: 16 November 2022 / Accepted: 17 November 2022 / Published: 22 November 2022
(This article belongs to the Section Sensing and Imaging)

Abstract

:
Relative pose measurement for noncooperative objects is an important part of 3D shape recognition and motion tracking. The methods based on scanning point clouds have better environmental adaptability and stability than image-based methods. However, the discrete points obtained from a continuous surface are sparse, which leads to point-to-point dislocations in the overlapping area and seriously reduces the accuracy. Therefore, this paper proposed a relative-pose-measurement algorithm based on double-constrained intersurface mutual projections. First, the initial corresponding set was constructed using mutual projections between the areas with similar feature descriptors, and then the final corresponding set was determined through the rigid-transformation-consistency constraint to improve the accuracy of the matchings and achieve a high-accuracy relative pose measurement. In the Stanford dataset, the rotation error and translation error were reduced by 19.3% and 13.4%, respectively. Furthermore, based on the proposed evaluation method, which separated the error of the pose-measurement algorithm from that of the instrument, the experiments were carried out with a self-made swept-frequency interferometer. The rotation error was reduced by 39.8%, and the surface deviation was reduced by 4.9%, which further proved the advancement of the method.

1. Introduction

With the development of sensor technology, in application fields such as space on-orbit service, intelligent robots, automatic driving, UAVs, etc., it is challenging and important to complete object detection and use the captured information to calculate the position and attitude parameters. The pose-measurement methods for noncooperative objects based on the image method [1,2] can solve the 3D pose by extracting matching points from 2D images. It has the characteristics of good flexibility and low cost, but it is difficult to maintain the stability of the measurement results under the influence of interference factors such as light changes and a weak texture structure. On the other hand, with the continuous development of noncontact 3D measurement equipment such as LIDAR and laser scanners, point-cloud measurements are becoming more accurate and the amount of data is increasing. How to use the point cloud information obtained by the existing 3D scanning system to design a more robust and accurate pose measurement algorithm has become an important part of high-accuracy pose measurement for noncooperative objects. In the actual pose measurement process, it is usually necessary to register the partial overlapping point cloud data in different states. The relative pose-measurement method based on point clouds mainly includes auxiliary methods applied to cooperative objects and automatic methods applied to noncooperative objects. Auxiliary methods usually use artificial markers [3], rotating platforms [4], attitude sensors [5], and other auxiliary equipment to register the point clouds. However, the auxiliary measurement method has great limitations. Some measuring objects are not allowed to paste marker points, and the measurement efficiency is also greatly affected. The instruments must be calibrated accurately using the rotating platform and the attitude sensor, and extra inaccuracies will be introduced by the auxiliary devices used in the calibration. In noncooperative posture measurement, the automatic technique has gained increasing attention, which has the advantages of requiring no manual prior knowledge and high efficiency, extracting the similar structural features of the point cloud overlapping area, and solving the coordinate transformation matrix.
For the automatic measurement of the relative pose for noncooperative point clouds, Besl et al. [6] proposed an iterative closest point (ICP) algorithm based on point-to-point registration, which constructs the corresponding relationship through the nearest neighbor search, and then singular value decomposition (SVD) is used to minimize the Euclidean distance between the corresponding pairs to achieve the solution of the relative pose matrix. Chetverikov [7] improved the construction process of matching point pairs in the traditional ICP algorithm and used the proportion of overlapping regions of adjacent frame point clouds as prior information to filter corresponding pairs to achieve a better registration effect. He [8] et al. proposed a noncooperative pose-tracking method based on the geometric characteristics of point clouds, which improved the accuracy of matchings according to the density, normal vector, and other characteristics of the point clouds. Chen [9] et al. recognized the plane features on noncooperative objects and solved the relative pose of the feature points using the ICP algorithm. The plane feature extraction operation improved the accuracy and efficiency of the pose measurement. Zhu [10] et al. used a combination of local and global constraints to remove outliers in the initial matchings, which improved the accuracy of the matching pairs. Li [11] et al. proposed a rough registration algorithm based on principal component analysis combined with bounding boxes and FPFH descriptors, which overcame the problem that the ICP algorithm had high requirements for the initial values. Recently, He [12] et al. proposed a pose-measurement method based on geometric characteristics and used a random-sampling persistence algorithm to eliminate abnormal matching pairs, which improved the robustness of the relative pose measurement.
However, in the actual measurement process, the point cloud obtained by the discrete sampling of the laser scanning system is sparse, and the final matching points of the point-to-point pose measurement algorithm cannot one-by-one correspond to the actual measured surface, which results in the existence of pose-measurement errors. Low [13] investigated how to reduce the total distances between points and a tangent plane using the ICP approach. The object function included the normal vector, and the normal vector angle and the Euclidean distance were both minimized via least-squares optimization. Generalized ICP [14] was proposed to take into account the normal vector information. The influence of the sparsity on the discrete point cloud was somewhat reduced by this method, but it was not appropriate for complicated surface structures. On this basis, Jacopo [15] proposed the Normal ICP method to filter the matching pairs through the similarity of local area curvature, and minimize the distance from the point to the plane and the angle between the normal vector when solving the transformation matrix. Pengyu [16] used CoBigICP to expand GICP. The geometric information of the local corresponding region was introduced into the optimization function, and the registration effect is better. Although the above methods reduce the influence of point cloud sparsity by constructing an objective function to minimize the distance from the point to the tangent plane, the registration effect for some objects with complex surface morphology is not good. In this regard, the 3D-NDT method proposed by Das [17] used the probability density function to model the distance between points and realized the soft matching of correspondence. Evangelidis [18,19] proposed a point-cloud pose-measurement method based on the Gaussian mixture model. The target point cloud was represented by the Gaussian mixture model (GMM), and the transformation matrix was solved step by step by the Expectation Maximization (EM) algorithm. Choi [20] introduced the color information of matching point pairs into the probability cost function and constructed the probability distribution of the corresponding local area for the adjacent point set. However, the measurement equipment was required to provide RGB color information of the point cloud. Liu Tong [21] built a 3D model by fitting the target point cloud with a B-spline surface and gradually optimized the distance from the point to the 3D model in the registration process to improve the registration accuracy. However, this method required the fitting of closed surfaces and the high integrity of the target point cloud, so it could not be applied to the relative pose measurement for noncooperative objects with large nonoverlapping areas. Huang [22] proposed a variant ICP method based on an adaptive moving least squares (MLS) surface. MLS surface fitting was carried out in the local area of sparse point clouds, and the distance between points was replaced by the distance from the point to the projection of the MLS surface in the minimization objective function. Moreover, Huang further improved the fitting ability of traditional MLS surfaces to complex surfaces through a heterogeneous Gaussian kernel function and improved the registration accuracy. However, this method could not determine whether the projection area was accurate during the construction of the corresponding pairs, which led to lower accuracy of the final matchings or even the inability to obtain the correct matching pairs, which affected the final relative pose measurement’s accuracy.
In summary, to improve the accuracy of pose measurement, many researchers have conducted much research, but most of them mainly focused on improving the accuracy of the point-to-point pose measurement. There are few studies on nonpoint-to-point high-accuracy pose measurement for sparse point clouds, and there are still some problems in the existing methods, which cannot meet the actual measurement requirements. To overcome the influence of point-cloud sparsity on pose-measurement accuracy, this paper proposes a relative pose-measurement algorithm based on double-constrained intersurface mutual projections. First, the scanning interferometer was used to obtain the high-accuracy point-cloud information for the noncooperative objects, and then the similarity of the feature descriptor in the high-dimensional feature space was used to determine the bidirectional projection areas from the surface to the surface. Then, the position of the projection point was solved iteratively along the direction of the weighted normal vector to obtain the correspondences. Finally, the more accurate matching pairs were selected by the consistency constraints of rigid body transformation, and the relative pose matrix was calculated to achieve high-accuracy measurement of the relative pose for noncooperative objects. The innovation points of this paper are summarized as follows:
(1)
A heterogeneous moving least squares surface (HMLS) was constructed in the local mutual-projection area of point clouds to generate more accurate matchings, which reduced the impact of point-cloud sparsity on point-cloud pose measurement.
(2)
The similarity constraints of feature descriptors and the consistency constraints of rigid body transformation were applied to the selection of matching point pairs, and the accuracy of pose measurement for pairwise point clouds was improved;
(3)
An evaluation method for separating the pose-measurement error from the instrument error was proposed. Based on the Stanford dataset validation experiment, the actual noncooperative pose measurement experiments were further carried out through the self-made 3D swept-frequency interferometer, which reflected the significant advantages of the proposed method.
The main structure of this paper is as follows. Section 2 first analyzes the problems of the traditional ICP algorithm and describes the details of the relative pose-measurement algorithm based on double-constrained intersurface mutual projections. Section 3 provides the experimental results and the analytical discussions thereof. Section 4 concludes the work of this paper.

2. Method

The traditional ICP pose-measurement algorithm defines the target point cloud P R 3 × M 1 as the reference frame, and its pose state is fixed. The source point cloud is defined as Q R 3 × M 2 , and its rotation matrix R R 3 × 3 and translation matrix t R 3 × 1 relative to the reference frame are the transformation parameters to be solved. M 1 and M 2 are the number of target points and source points, respectively. The corresponding set { ( p i , q i ) } i = 1 N is determined according to the Euclidean-distance-nearest principle between points. N is the number of correspondences in the overlapping area, which can be calculated according to the overlap rate. Take the sum of the squares of the point distances as the optimization function:
R * , t * = argmin R , t 1 N i = 1 N p i ( R q i + t ) 2
R * and t * represent the rotation matrix and translation matrix of the source point cloud relative to the target point cloud, respectively. The point-to-point registration will seriously affect the accuracy of the relative position and attitude measurement due to the problem of dislocation for point clouds under different scanning angles. In contrast, the surface-to-surface registration method can fit the local shape of dense objects and make full use of the current point cloud structure information to improve registration accuracy. The main steps in proposing the method are as follows.
First, the point cloud of the noncooperative object was obtained by a 3D swept frequency interferometer. Then, after calculating the feature descriptor and normal vector of the point cloud, the multiscale feature descriptor was used to construct the initial corresponding set, and the mutual-projection area was determined according to the corresponding relationships. Local surface fitting was carried out for the point clouds, and the original points were mutually projected to establish a new corresponding set. Finally, the rigid-transformation consistent-distance constraint was used to filter the sets to obtain the final matchings and solve the coordinate-transformation matrix.

2.1. Principle of Point-Cloud Measurement for Noncooperative Objects

The measurement principle of the point cloud for noncooperative object is shown in Figure 1. The infrared laser emitted by the swept-frequency-interferometry ranging module was incident on the reflector. With the point of incidence as the origin, the coordinate system of the measurement system was established. We set the distance from the origin to the measured target as R m . The scanning angles of the 2D turntable were the azimuth β and pitch α . In the scanning process, the 2D turntable read the values of the azimuth and pitch angles in real time and recorded the distance from the origin to the measured point measured by the swept-frequency-interferometry ranging module. Finally, Equation (2) was used to convert the 3D point cloud of the object from the polar coordinate system to the Cartesian coordinate system. After the current viewing angle scanning was completed, the target cloud P R 3 × M 1 and the source cloud Q R 3 × M 2 were obtained with the changing pose of the measured objects. M 1 and M 2 were the number of points of the target point cloud and source point cloud, respectively.
{ x = R m sin α cos β y = R m sin α sin β z = R m cos α

2.2. Projection from a Point to the MLS Surface

Local surface fitting is an important step in projection tasks. Amenta [23] set e ( y , a ) as the energy function of the MLS surface. A point y outside the surface was projected along the normal vector a of the corresponding local area. We defined the set of projection points that minimized the energy function as the MLS surface. { p k } k = 1 K was set as the k-nearest neighbors of the source point cloud relative to the target point cloud; Figure 2 shows the constructed MLS surface. The expression of the isosurface S ( y ) was:
S ( y ) = min   e ( y , a ) = min   e ( q m + t a , a ) = min ( ( k = 1 K ( q m + t a p k ) T a ) 2 θ ( q m + t a p k ) )
The initial point q 0 moved to the projection point y = q = q m + t a on the corresponding surface by minimizing the energy function e ( y , a ) along the weighted normal vector n ( q 0 ) of the K-neighborhood point set; the scalar t represented the single approximation step size. When   d S ( y ) / d t was zero, the energy function e ( y , a ) reached the minimum value. Then, the weighted normal vector a = n ( q m ) was introduced to transform the energy function into a function with a single-variable parameter. After that, Brent’s [24] algorithm was used to solve for the value of t in the nonlinear minimization function e ( t , n ( q m ) ) . Finally, the position of the projection point q = q m + t n ( q m ) was updated. When the difference between two adjacent projection points was less than the threshold δ = q m + 1 q m , the iteration was terminated. For some objects with smooth surfaces, we usually set parameter δ to 10 6 .
The first term of the summation equation in the energy function represented the normal distance between the current iteration point q m + 1 and the nearest neighbor point p k , and θ ( ) represented the weighting function. a was the projection direction represented by the weighted normal vectors (3) of K adjacent points in the local surface region during each iteration.
a = n ( q m ) = k = 1 K n p k θ ( q m p k ) k = 1 K n p k θ ( q m p k )
The Gaussian kernel function θ ( ) in the above MLS surface projection process has two different expressions. The Gaussian kernel function used in the traditional MLS surface is isotropic and can only describe the local surface with a single feature. However, the surface topography of real objects has anisotropic characteristics. When the flatness and steepness of the local point cloud in different directions are different, the traditional MLS surface projection results will have a large deviation. Therefore, the principal curvature parameters k 1 and k 2 in two orthogonal directions were introduced to construct the heterogeneous Gaussian kernel function. The heterogeneous Gaussian kernel function was defined as Equation (6), and the function widths could be expressed as h 1 = 1 / ( β k 1 ) and h 2 = 1 / ( β k 2 ) . β was a scale factor that could indirectly control the width of the kernel function and affect the projection accuracy. The next section will discuss the influence of this parameter through experiments. v 1 and v 2 were the principal directions of curvatures k1 and k2, respectively.
θ ( q m + 1 p k ) = exp ( q m + 1 p k 2 / h 2 )
θ ( q m + 1 p k ) = exp ( β 2 ( k 1 2 [ ( q m + 1 p k ) v 1 ] 2 + k 2 2 [ ( q m + 1 p k ) v 2 ] 2 ) )

2.3. Local Feature Similarity Constraint

The above point-to-HMLS surface projection steps could generate new corresponding points on the local surface, but there was no corresponding determination mechanism to constrain the construction of the corresponding projection area. Inaccurate projection areas are prone to lead to inaccurate location information of projection points. Therefore, the feature similarity constraint was used to construct the intersurface mutual-projection regions. First, the multiscale feature descriptors D P R 9 × M 1 and D Q R 9 × M 1 of the target point cloud P and source point cloud Q were calculated as in reference [25]. This feature descriptor first determined the neighborhood point sets under different scale radii and then performed a principal component analysis on the point sets. The eigenvalues of different neighborhood point sets after the principal component analysis were normalized to obtain feature descriptors with a high robustness, high scale invariance, and high rotation invariance.
As shown in Figure 3, in the overlapping region of the target cloud and the source cloud, the MLS surfaces S ( q ) and S ( p ) were used to fit the local neighborhood. q j represented a point in the source cloud, and the KD-tree algorithm was used to build the nearest-neighbor index of the target cloud to obtain the initial correspondence ( q j , p j ) , as shown in the matching point pairs connected by the dotted lines in the figure. Then, the local projection area of q j relative to the target cloud was fitted by { p j k } k = 1 K .
However, the projection region correspondence constructed by the single Euclidean distance nearest condition was not reliable. Therefore, according to the local feature similarity constraint, the correct corresponding point p i of q j was supposed to be in the neighborhood { p j k } k = 1 K . We set the neighborhood point set of the projection area corresponding to point q j as { p j k } k = 1 K and the corresponding feature descriptor as D p j . Then { D p j k } k = 1 K represented the feature descriptor set of the neighborhood points. The neighborhood point p i that was nearest to the Euclidean distance of D p j in the feature space was taken as the new corresponding point of q j to build a new correspondence ( q j , p i ) , as shown by the solid line in Figure 3. To reduce the influence of outliers and noise points caused by measurement errors on the relative pose measurement, threshold ε 1 was set to filter the minimum Euclidean distance in the feature space, as shown in Equation (6). When the minimum value was less than ε 1 , the relationship was considered a correct matching, and bidirectional projection areas ( p i , { q j k } k = 1 K ) and ( q j , { p i k } k = 1 K ) were obtained. Otherwise, the corresponding points were removed from the initial set. The selection of threshold ε 1 should not only filter outliers and noise points, but also should ensure the number of final matching pairs. The threshold ε 1 should be selected within the appropriate range. According to [25] and the previous test, we set ε 1 to 0.01.
D q j D p i < ε 1

2.4. Distance Constraint of an Intersurface Mutual Projection

The accuracy of matching pairs seriously affects the final relative pose-measurement results. Therefore, after the mutual projection of points to local surfaces, it was necessary to further use the rigid-transformation-consistency distance constraint to further filter the constructed intersurface mutual-projection point pairs.
As shown in Figure 4, the corresponding point pair ( p i , q j ) was obtained by the similarity constraints of the feature descriptors in the target cloud P and the source cloud Q . Then, the normal vector information and Equation (2) were used to project the two points to the corresponding regions { q j k } k = 1 K and { p i k } k = 1 K , respectively, and obtain two pairs of new corresponding points ( p i , p i ) and ( q j , q j ) . If the relationships ( p i , p i ) and ( q j , q j ) were correct, they should have satisfied the constraint of rigid-transformation consistency p i q j = q j p i . In the actual pose-measurement process, the condition that the distance of corresponding point pairs be completely equal was too strict. Therefore, the constraint condition was changed as follows:
| p i q j q j p i p i q j + q j p i | ε 2
If the relative difference of the matching was less than the threshold ε 2 , the relationships were regarded as the correct correspondences and added to the final matching point set. Otherwise, the corresponding relation was ignored. We set ε 2 to 0.005 according to the same principle as ε 1 in Section 2.3.

2.5. Relative Pose Measurement Based on Double-Constrained Intersurface Mutual Projections

To improve the accuracy of the relative-pose-measurement algorithm for noncooperative objects, the specific steps of the surface-to-surface registration algorithm based on double constrained intersurface mutual projections were as follows:
1. The swept-frequency interferometer was used to measure the noncooperative object, and the point cloud information was obtained according to Equation (2);
2. We preprocessed the input target cloud P R 3 × M 1 and source cloud Q R 3 × M 2 . According to [25], we calculated the multiscale feature descriptors D P and D Q , principal curvatures k P and k Q , and normal vectors n P and n Q ;
3. The point number N in the overlapping area was determined according to the overlap rate parameter of the adjacent frames. The initial set of corresponding points { ( p i , q i ) l } i = 1 N was constructed by the k-nearest neighbor search. Point q i in the source point cloud corresponded to the neighborhood point set { q i k } k = 1 K of the target point cloud. According to the similarity of the feature descriptor and Equation (7), the corresponding pair set { ( p i , q j ) l } i = j = 1 N under the similarity constraint of the feature descriptor was obtained. Thus, the bidirectional projection regions { ( p i , { q j k } k = 1 K ) l } i = 1 N and { ( q j , { p i k } k = 1 K ) l } j = 1 N were constructed.
4. We used Equation (3) to realize the mutual projection between each point and the corresponding area. In the projection process, the heterogeneous Gaussian kernel (6) was used to approach the step size step by step. Then, we constructed new corresponding sets { ( p i , p i ) l } i = 1 N and { ( q j , q j ) l } j = 1 N ;
5. We filtered the corresponding set with the rigid-transformation-consistent constraint (8) and added the correspondences ( p i , p i ) and ( q j , q j ) that satisfied the distance constraint to the final matching sets P = { p i , q j | i = 1 , , N , j = 1 , N } and Q = { p i , q j | i = 1 , , N , j = 1 , N } ;
6. We solved the coordinate-transformation matrix R l + 1 and t l + 1 based on Equation (1) and updated the source point cloud Q l + 1 = R l + 1 Q l + t l + 1 iteratively until the convergence condition was satisfied.
The above algorithm looped through steps 2 to 5 until the difference in the transformation matrix was sufficiently small. When the number l of iterations exceeded the maximum number L , the pairwise registration process would end. L could prevent the algorithm from a failure to converge caused by a slight fluctuation in the registration results of the adjacent frames. The implementation details of the algorithm are shown in Algorithm 1.
Algorithm 1: Relative pose measurement based on double-constrained projection
Input: Source point cloud Q and target point cloud P measured by the swept frequency interferometer
Output: Transformation R and t that aligns P and Q
1     Initial pose R 0 , t 0 and maximum number of iterations L;
2     Compute D P , D Q , k P , k Q , n P , n Q ;
3     Initial q = 0;
4   While  R , t are not converged or l < L do
5        Initial set of corresponding points { ( p i , q i ) l } i = 1 N by kd-tree;
6        for i = 1:N do
7            if  D q j D p i < ε 1
8                  Build bidirectional projection region: { ( p i , { q j k } k = 1 K ) l } i = 1 N and { ( q j , { p i k } k = 1 K ) l } j = 1 N ;
9            end
10           Point to HMLS surface projection: { ( p i , p i ) q } i = 1 N and { ( q j , q j ) q } j = 1 N ;
11           if  | p i q j q j p i p i q j + q j p i | ε 2
12                  Preserve the current corresponding point P and Q ;
13         else
14            Delete the current corresponding point;
15         end
16       end
17       Compute R q , t q through the final set of points P and Q ;
18       Update the source point cloud: Q l + 1 = R l + 1 Q l + t l + 1
19       l = l + 1;
20 end
21 return R , t ;

3. Experiment and Analysis

3.1. Simulation of Relative Pose Measurement

To verify the advancement of the proposed pose-measurement algorithm based on double-constrained intersurface mutual projections, in the Stanford 3D scanning dataset (Available online: http://graphics.stanford.edu/data/3Dscanrep/ accessed on 10 October 2022), the first two perspectives on the Bunny, Dragon, Armadillo, and Happy Buddha models were used for the relative pose-measurement experiment. Each dataset contained partially overlapping point clouds and the true relative transformation of each frame. The accuracy of the pose measurement was measured via the rotation error E R (°) and the translation error E t (mm):
E R = cos 1 ( t r a c e ( R R G T 1 ) 1 2 ) 180 π ,   E t = t t G T 2
R G T and t G T were the respective real relative-rotation-transformation parameters and relative-translation-transformation parameters given in the Stanford dataset. R and t represented the relative-rotation-transformation parameters and relative-translation-transformation parameters solved by different algorithms. The overlapping area proportion of each pair of point clouds in the Bunny, Dragon, Armadillo, and Happy Buddha datasets were approximately 75%, 60%, 60%, and 60%, respectively; and the true relative rotation transformation angles were approximately 45°, 24°, 24°, and 24°, respectively. TriICP [6], point-to-plane ICP [13], GMM [19], CoBigICP [16], and HMLS_ICP [22] were used to conduct the relative pose-measurement experiment for noncooperative objects and compared it with the proposed algorithm. The Point-to-Plane ICP and TriICP algorithms were implemented through the open-source PCL library, which is based on the C++ development platform. The number of neighborhood points set in the Point-to-Plane ICP algorithm to solve the normal vector was 30. The overlap rate of point clouds with different viewing angles set in the TriICP algorithm was 60%. The effects of the GMM algorithm and CoBigICP algorithm were verified by the open-source code provided by Evalida [19] and Pengyu [16], respectively. The HMLS_ ICP algorithm mainly included two steps: solving the orthogonal curvature of the local point and projecting points onto HMLS surfaces. The reproduction process of this algorithm mainly referred to [22]. The proposed algorithm set the projection threshold, the similarity threshold of the feature descriptor ε 1 , and the relative distance threshold of the consistency-constraint parameter of the rigid transformation ε 2 to 10−6 m, 0.01, and 0.005, respectively. The registration effect of the Bunny, Dragon, Armadillo, and Happy Buddha data is shown in Figure 5, in which the red point cloud represents the target point cloud, and the green point cloud represents the source point cloud.
First, the point clouds were roughly aligned using the algorithm proposed by Lei [25], and then different relative-pose-measurement algorithms were used for comparison. The initial values of the pose error and the pose-measurement error for different algorithms are shown in Table 1. The results with the lowest error are in bold. The table shows that the accuracies of the TriICP and Point-to-Plane ICP were better. The Point-to-Plane ICP algorithm realized point-to-plane registration by minimizing the distance between points in the normal vector direction. Although it could improve the relative rotation accuracy, the relative translation error increased, and the overall registration effect was worse than that of the TriICP algorithm. GMM replaced the Euclidean distance between points with a probability density function, so the correspondence between points was no longer absolute. Table 1 shows that the overlap rate of the point-cloud data had a great impact on the algorithm. CoBigICP also used local planes to represent point clouds, so the effect of pose measurement was poor when registering objects with complex surfaces. Although the point-cloud-registration method based on an HMLS surface obtained good pose-measurement results on objects with smooth surfaces such as Bunny, the pose-measurement error was large for objects with large surface undulations. The proposed algorithm filtered the projection area and matching point pairs using the feature-descriptor-similarity constraint and rigid-body-transformation consistency constraint, and it could improve the accuracy of the pose measurements on the basis of improving the accuracy of the matching pairs. The results showed that the rotation error of the proposed method was 19.6% lower than that of the traditional TriICP point-to-point pose-measurement algorithm while keeping the translation error unchanged. Compared with the existing optimal nonpoint-to-point method (HMLS-ICP), the average rotation error was reduced by 19.3%, and the translation error was reduced by 13.4%. However, the translation error of the proposed method in the Happy Buddha model was slightly larger than that of the other methods This was mainly because there were many areas with sharp surface fluctuations in the original Happy Buddha point clouds, which led to a decline in accuracy of the projection points in the process of manual projection for the proposed algorithm, thus affecting the pose-measurement results.
We used an Intel (R) I7 11800H 2.3 GHz CPU to measure the relative position and attitude of the Bunny dataset. The calculation times of the different algorithms were recorded as shown in Table 2. Compared with the TriICP, Point-to-Plane ICP, and CoBigICP algorithms, the proposed method had a higher measurement accuracy, but it required a greater number of nonlinear optimization operations, which resulted in an increased calculation time. This problem also existed for GMM and HMLS-ICP. The objective function of the GMM algorithm was the most complex, so the calculation time was longer than that of HMLS-ICP. Due to the interface mutual projection, the calculation time of the proposed algorithm was doubled compared with that of HMLS-ICP, but was roughly the same as that of the GMM algorithm. In future research work, we will further improve the operation efficiency of the proposed algorithm through algorithm optimization and hardware acceleration.

3.2. Experiment of Swept-Frequency Interferometry

Different from traditional laser-scanning equipment based on the time-of-flight (TOF) method, the 3D swept-frequency interferometer uses swept-frequency interferometry based on a frequency-modulated continuous wave (FMCW). By measuring the frequency difference between the transmitted light wave and the reflected echo of the object, the distance information between the measured target and the instrument can be calculated. This method has the characteristics of a large field of view and noncontact measurement; it is more suitable for the 3D pose measurement of noncooperative objects. To accurately evaluate the accuracy of the pose-measurement algorithm, avoid the influence of the measurement instrument’s own errors on the pose-measurement result, and separate the instrument error from the pose-measurement algorithm error, we proposed a method for pose-measurement evaluation. The self-made 3D swept-frequency interferometer was used to measure the relative pose of the Agriba gypsum model. Under the same visual angle, the red area and green areas of the gypsum model (as shown in Figure 6a) were scanned and measured twice in different steps, and all the point clouds were used as the original reference point clouds (as shown in Figure 6b). The red area was used as the target cloud, and the green area was used as the source cloud to perform the coordinate transformation, which was set manually. The relative pose was then calculated. The measured coordinate-transformation parameters were compared with the setting parameters, and the relative-pose-measurement accuracy of the dual-view point cloud was calculated. The transformed point cloud was compared with the reference point cloud after the same reconstruction, and the surface topography deviation was calculated.
The transformation results of 10° for the source cloud are shown in Figure 7a, in which it can be seen that the pose of the source cloud was shifted. After coarse registration, the transformation matrixes were solved using the TriICP, the HMLS-ICP, and the proposed algorithms. The relative pose-measurement results are shown in Figure 7b–d. Both the TrICP algorithm and the proposed algorithm could further improve the accuracy of the pose-measurement accuracy on the basis of coarse registration. In the pose-measurement experiments with different rotation angles, the registration results for the rotation-transformation parameters and translation-transformation parameters are shown in Table 3. In the actual process of the relative-pose-measurement experiment of the swept-frequency interferometer, the results of the position and attitude measurements using this algorithm and the HMLS-ICP algorithm were better than those of the TriICP algorithm. This was because the surface-to-surface registration algorithm could better overcome the sparsity of point clouds and improve the registration accuracy. Compared with HMLS-ICP, the rotation error of this algorithm was reduced by 39.8% while the translation was clearly increased, which showed that proposed algorithm had a higher advantage in the pose-measurement field that was more sensitive to rotation errors. In the following section, we will further verify the advancement of the algorithm through surface-deviation experiments. Furthermore, the registration results for different initial poses were almost the same, which verified the stability of the proposed algorithm.

3.3. Surface-Deviation Experiment

The relative pose of the source point cloud solved via point-cloud registration was used to transform its own coordinates, which allowed it to be registered to the target point cloud’s coordinate system so that the reconstructed point cloud of two frames could be obtained. Then, to further obtain the surface deviation in the pose-measurement results, the same surface-reconstruction algorithm was used for the reconstruction point cloud of different algorithms to obtain the triangular mesh representation. Then, we calculated the normal distance between a single triangular mesh patch and the neighboring points of the reference point cloud obtained in Section 3.2. The minimum normal distance was taken as the surface deviation value of the triangular patch. Finally, we calculated the surface deviation root-mean-square error (RMSE) value of the triangular mesh patches. Relative to the reference point cloud, the surface-deviation RMSE in the TriICP reconstructed cloud was 0.279 mm, and the maximum deviation was 1.155 mm. As shown in Figure 8a, there were large red areas with high deviations. The surface-deviation RMSE calculated using HMLS-ICP was 0.263 mm, and the maximum deviation was 1.182 mm. However, the surface-deviation RMSE of the proposed algorithm was 0.232 mm, and the maximum deviation was 1.139 mm. The RMSE value was 4.9% lower than that of HMLS-ICP. As shown in Figure 8c, the high deviation in the red area was less and was uniformly distributed, such as on the forehead and nose, which are marked with yellow boxes. Therefore, the experimental results verified the superiority of the proposed algorithm in improving the registration accuracy.

4. Conclusions

In the process of the relative pose measurement of noncooperative objects, image-based methods usually have certain limitations regarding the shape or texture of the object and are greatly affected by changes in the light intensity. In contrast, the method based on point clouds can better use the geometric information of objects and has better adaptability and stability. However, the sparsity of the discrete points measured by the 3D scanning system is inevitable. In this paper, to solve the problem that the existing point-to-point methods cannot meet the high-accuracy requirement due to this phenomenon, a relative pose-measurement method for noncooperative objects based on double-constrained intersurface mutual projections was proposed, which provided a new method for realizing surface-to-surface pose measurements. The method first searched for the bidirectional projection area through the similarity of multiscale feature descriptors, then performed point-to-surface projection and constructed a new corresponding set. Finally, the distance constraint of an intersurface mutual projection was used to filter the matching point pairs, which improved the accuracy of the final matchings and reduced the impact of point-cloud sampling sparsity on the pose measurements. Through the Stanford dataset and the self-made 3D swept-frequency interferometer, the relative-pose-measurement experiments were carried out, and the comparison results with the existing algorithms were given; these showed good advancement and practicality and verified that the proposed method had broad application prospects.

Author Contributions

Y.G.: Data Curation, Writing—Original Draft Preparation; G.L. (Guangmin Li): Conceptualization, Methodology, Software; G.L. (Guodong Liu): Writing—Reviewing and Editing; B.L.: Supervision. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the National Natural Science Foundation of China (Grant No. 51875139).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Acknowledgments

The authors would like to acknowledge the Stanford 3D Scanning Repository for making their datasets available to us and the PCL library for the open-source project. We also thank Pengyu Yin of Xi’an Jiaotong University and Georgios D. Evangelidis of the University of Patras for providing the source code.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Wang, F.; Dong, H.; Chen, Y.; Zheng, N. An Accurate Non-Cooperative Method for Measuring Textureless Spherical Target Based on Calibrated Lasers. Sensors 2016, 16, 2097. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  2. Zhang, L.; Wu, D.-M.; Ren, Y. Pose Measurement for Non-Cooperative Target Based on Visual Information. IEEE Access 2019, 7, 106179–106194. [Google Scholar] [CrossRef]
  3. Li, F.; Hitchens, C.; Stoddart, D. A performance evaluation method to compare the multi-view point cloud data registration based on ICP algorithm and reference marker. Opt. Acta Int. J. Opt. 2018, 65, 30–37. [Google Scholar] [CrossRef] [Green Version]
  4. Byun, J.H.; Han, T.D. Axis Bound Registration of Pan-Tilt RGB-D Scans for Fast and Accurate Reconstruction. Pattern Recognit. Lett. 2020, 138, 138–145. [Google Scholar] [CrossRef]
  5. Shi, C.; Zhang, L.; Wei, H.; Liu, S. Attitude-sensor-aided in-process registration of multi-view surface measurement. Measurement 2011, 44, 663–673. [Google Scholar] [CrossRef]
  6. Besl, P.; Mckay, N. A method for registration of 3-D shapes. IEEE Trans. Pattern Anal. Mach. Intell. 1992, 2, 239–256. [Google Scholar] [CrossRef] [Green Version]
  7. Chetverikov, D.; Stepanov, D.; Krsek, P. Robust Euclidean alignment of 3D point sets: The trimmed iterative closest point algorithm. Image Vis. Comput. 2005, 23, 299–309. [Google Scholar] [CrossRef]
  8. He, Y.; Liang, B.; He, J.; Li, S. Non-cooperative spacecraft pose tracking based on point cloud feature. Acta Astronaut. 2017, 139, 213–221. [Google Scholar] [CrossRef]
  9. Chen, Z.; Li, L.; Niu, K.; Wu, Y.; Hua, B. Pose measurement of non-cooperative spacecraft based on point cloud. In Proceedings of the 2018 IEEE CSAA Guidance, Navigation and Control Conference (CGNCC), Xiamen, China, 10–12 August 2018; pp. 1–6. [Google Scholar]
  10. Zhu, A.; Yang, J.; Cao, Z.; Wang, L.; Gu, Y. Pose estimation for non-cooperative targets using 3D feature correspondences grouped via local and global constraints. In Proceedings of the MIPPR 2019: Pattern Recognition and Computer Vision, Wuhan, China, 2–3 November 2019; Volume 11430, pp. 78–85. [Google Scholar]
  11. Li, R.; Yang, B.; Lu, Q. Rough registration method for point cloud of spatial non-cooperative target by improving FPFH. In Proceedings of the Sixth Symposium on Novel Photoelectronic Detection Technology and Application 2020, Beijing, China, 3–5 December 2019. [Google Scholar]
  12. He, Y.; Yang, J.; Xiao, K.; Sun, C.; Chen, J. Pose Tracking of Spacecraft Based on Point Cloud DCA Features. IEEE Sens. J. 2022, 22, 5834–5843. [Google Scholar] [CrossRef]
  13. Low, K. Linear least-squares optimization for point-toplane ICP surface registration. Technical report, TR04-004. Univ. North Carol. 2004, 4, 1–3. [Google Scholar]
  14. Segal, A.; Hhnel, D.; Thrun, S. Generalized-ICP. In Robotics: Science and Systems V.; University of Washington: Seattle, WA, USA, 2009. [Google Scholar]
  15. Serafin, J.; Grisetti, G. NICP: Dense Normal Based Point Cloud Registration. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots & Systems, Hamburg, Germany, 28 September–3 October 2015; pp. 742–749. [Google Scholar]
  16. Yin, P.; Wang, D.; Du, S.; Ying, S.; Gao, Y.; Zheng, N. CoBigICP: Robust and Precise Point Set Registration using Correntropy Metrics and Bidirectional Correspondence. In Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 25–29 October 2020. [Google Scholar]
  17. Das, A.; Waslander, S.L. Scan registration using segmented region growing NDT. Int. J. Robot. Res. 2014, 33, 1645–1663. [Google Scholar] [CrossRef]
  18. Evangelidis, G.D.; Horaud, R. Joint Alignment of Multiple Point Sets with Batch and Incremental Expectation-Maximization. IEEE Trans. Pattern Anal. Mach. Intell. 2016, 40, 1397–1410. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  19. Evangelidis, G.D.; Kounades-Bastian, D.; Horaud, R.; Psarakis, E.Z. A Generative Model for the Joint Registration of Multiple Point Sets. In European Conference on Computer Vision; Springer International Publishing: Cham, Switzerland, 2014. [Google Scholar]
  20. Choi, O.; Park, M.-G.; Hwang, Y. Iterative K-Closest Point Algorithms for Colored Point Cloud Registration. Sensors 2020, 20, 5331. [Google Scholar] [CrossRef] [PubMed]
  21. Liu, T.; Liu, W.; Qiao, L.; Luo, T.; Peng, X. Point set registration based on implicit surface fitting with equivalent distance. In Proceedings of the IEEE International Conference on Image Processing, Anchorage, AK, USA, 27–30 September 2015. [Google Scholar]
  22. Huang, Y.; Zhang, L.; Tan, Z.; Wang, Q.; Chen, L. Adaptive Moving Least-Squares Surfaces For Multiple Point Clouds Registration. In Proceedings of the ASME 2011 International Design Engineering Technical Conferences & Computers and Information in Engineering Conference, Washington, DC, USA, 28–31 August 2011. [Google Scholar]
  23. Amenta, N.; Yong, J.K. Defining point-set surfaces. ACM Trans. Graph. 2004, 23, 264–270. [Google Scholar] [CrossRef] [Green Version]
  24. Gegenfurtner, K. Praxis: Brent’s Algorithm for Function Minimization. Behav. Res. Methods 1992, 24, 560–564. [Google Scholar] [CrossRef]
  25. Lei, H.; Jiang, G.; Quan, L. Fast Descriptors and Correspondence Propagation for Robust Global Point Cloud Registration. IEEE Trans. Image Process. 2017, 26, 3614–3623. [Google Scholar] [CrossRef] [PubMed]
Figure 1. Schematic diagram of the point-cloud measurement principle for noncooperative objects.
Figure 1. Schematic diagram of the point-cloud measurement principle for noncooperative objects.
Sensors 22 09029 g001
Figure 2. Projection of a point to the moving least squares (MLS) surface.
Figure 2. Projection of a point to the moving least squares (MLS) surface.
Sensors 22 09029 g002
Figure 3. Local feature similarity constraint.
Figure 3. Local feature similarity constraint.
Sensors 22 09029 g003
Figure 4. Distance constraint of intersurface mutual projection.
Figure 4. Distance constraint of intersurface mutual projection.
Sensors 22 09029 g004
Figure 5. Original point-cloud data and registration rendering. The red point cloud represents the target point cloud, and the green point cloud represents the source point cloud. (a) Bunny; (b) Dragon; (c) Armadillo; (d) Happy Buddha.
Figure 5. Original point-cloud data and registration rendering. The red point cloud represents the target point cloud, and the green point cloud represents the source point cloud. (a) Bunny; (b) Dragon; (c) Armadillo; (d) Happy Buddha.
Sensors 22 09029 g005
Figure 6. Schematic diagram of swept-frequency-interference pose-measurement experiment.
Figure 6. Schematic diagram of swept-frequency-interference pose-measurement experiment.
Sensors 22 09029 g006
Figure 7. Results of the relative pose measurements using real point-cloud data.
Figure 7. Results of the relative pose measurements using real point-cloud data.
Sensors 22 09029 g007
Figure 8. The deviations in surfaces reconstructed using different results of relative pose measurements of the reference cloud. (a) Surface deviation of TriICP; (b) surface deviation of HMLS-ICP; (c) surface deviation.
Figure 8. The deviations in surfaces reconstructed using different results of relative pose measurements of the reference cloud. (a) Surface deviation of TriICP; (b) surface deviation of HMLS-ICP; (c) surface deviation.
Sensors 22 09029 g008
Table 1. Rotation errors and translation errors (°/mm) for different algorithms. (The results with the lowest error are in bold.)
Table 1. Rotation errors and translation errors (°/mm) for different algorithms. (The results with the lowest error are in bold.)
BunnyDragonArmadilloHappy BuddhaAverage
Initial0.8851/0.2710.4973/0.2561.2223/0.5550.7526/0.7830.8393/0.466
TriICP0.1182/0.0610.0524/0.1290.0780/0.0900.1869/0.3550.1089/0.159
Point-to-Plane ICP0.0525/0.1860.0791/0.1910.1180/0.1570.1867/0.3620.1091/0.224
GMM0.1625/1.0360.4528/0.3240.3615/0.3660.5484/0.2040.3813/0.483
CoBigICP0.0784/0.0230.1152/0.2670.1927/0.3860.4669/0.3010.2133/0.244
HMLS-ICP0.0528/0.0180.0771/0.1890.1216/0.1770.1826/0.3640.1085/0.187
Proposed0.0699/0.0560.0381/0.1250.0615/0.1020.1810/0.3660.0876/0.162
Table 2. Registration time (s) of different algorithms.
Table 2. Registration time (s) of different algorithms.
TriICPPoint-to-Plane ICPGMMCoBigICPHMLS-ICPProposed
1.6200.2336605.91.680360.3672.7
Table 3. Rotation errors and translation errors (°/mm) under different transformation angles. (The results with the lowest error are in bold.)
Table 3. Rotation errors and translation errors (°/mm) under different transformation angles. (The results with the lowest error are in bold.)
10°15°Average
Initial0.2696/0.4450.3779/0.3940.2935/0.5810.3277/0.710
TriICP0.1118/0.1900.1289/0.1970.1118/0.1980.1175/0.195
HMLS-ICP0.0597/0.1970.0556/0.1950.0586/0.2050.0579/0.199
Proposed0.0362/0.2070.0351/0.2070.0331/0.2160.0348/0.210
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Gan, Y.; Li, G.; Liu, G.; Lu, B. High-Accuracy Relative Pose Measurement of Noncooperative Objects Based on Double-Constrained Intersurface Mutual Projections. Sensors 2022, 22, 9029. https://doi.org/10.3390/s22239029

AMA Style

Gan Y, Li G, Liu G, Lu B. High-Accuracy Relative Pose Measurement of Noncooperative Objects Based on Double-Constrained Intersurface Mutual Projections. Sensors. 2022; 22(23):9029. https://doi.org/10.3390/s22239029

Chicago/Turabian Style

Gan, Yu, Guangmin Li, Guodong Liu, and Binghui Lu. 2022. "High-Accuracy Relative Pose Measurement of Noncooperative Objects Based on Double-Constrained Intersurface Mutual Projections" Sensors 22, no. 23: 9029. https://doi.org/10.3390/s22239029

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