赞
踩
点云配准是什么,维基百科上这样介绍:
Point cloud registration, is the process of finding a spatial transformation that aligns two point clouds. The purpose is to merge point clouds of multiple views into a globally consistent model.
在我的理解,有两个点集,source和target,target不变,source经过旋转(Rotation)和平移(Translation)甚至加上尺度(Scale)变换,使得变换后的source点集尽量和target点集重合,这个变换的过程就叫点集配准。 In the algorithm, target point cloud, is kept fixed, while the other one, the source, is transformed
to best match the reference. The algorithm iteratively revises the transformation (combination of
translation and rotation) needed to minimize the distance from the source to the reference point cloud.
而ICP是最广泛应用的配准方法,也就是KinectFusion论文中所提到的ICP( Iterative Closest Point ), 最近邻迭代算法。icp利用迭代一步步地算出正确对应关系。
Iterative Closest Point (ICP) is an algorithm employed to minimize the difference between two clouds of points.
下面几页PPT是ICP很好的解释。
- void PairwiseICP(const pcl::PointCloud<PointT>::Ptr &cloud_target, const pcl::PointCloud<PointT>::Ptr &cloud_source, pcl::PointCloud<PointT>::Ptr &output )
- {
- PointCloud<PointT>::Ptr src(new PointCloud<PointT>);
- PointCloud<PointT>::Ptr tgt(new PointCloud<PointT>);
-
- tgt = cloud_target;
- src = cloud_source;
-
- pcl::IterativeClosestPoint<PointT, PointT> icp;
- icp.setMaxCorrespondenceDistance(0.1);
- icp.setTransformationEpsilon(1e-10);
- icp.setEuclideanFitnessEpsilon(0.01);
- icp.setMaximumIterations (100);
-
- icp.setInputSource (src);
- icp.setInputTarget (tgt);
- icp.align (*output);
- // std::cout << "has converged:" << icp.hasConverged() << " score: " <<icp.getFitnessScore() << std::endl;
-
- output->resize(tgt->size()+output->size());
- for (int i=0;i<tgt->size();i++)
- {
- output->push_back(tgt->points[i]);
- }
- cout<<"After registration using ICP:"<<output->size()<<endl;
- }
- /** \brief @b IterativeClosestPoint provides a base implementation of the Iterative Closest Point algorithm.
- * The transformation is estimated based on Singular Value Decomposition (SVD).
- *
- * The algorithm has several termination criteria:
- *
- * <li>Number of iterations has reached the maximum user imposed number of iterations (via \ref setMaximumIterations)</li>
- * <li>The epsilon (difference) between the previous transformation and the current estimated transformation is smaller than an user imposed value (via \ref setTransformationEpsilon)</li>
- * <li>The sum of Euclidean squared errors is smaller than a user defined threshold (via \ref setEuclideanFitnessEpsilon)</li>
- * </ol>
- * Usage example:
- * ...
- * \author Radu B. Rusu, Michael Dixon
- **/
- // Repeat until convergence
- do
- {
- // Get blob data if needed
- PCLPointCloud2::Ptr input_transformed_blob;
- if (need_source_blob_)
- {
- input_transformed_blob.reset (new PCLPointCloud2);
- toPCLPointCloud2 (*input_transformed, *input_transformed_blob);
- }
- // Save the previously estimated transformation
- previous_transformation_ = transformation_;
-
- // Set the source each iteration, to ensure the dirty flag is updated
- correspondence_estimation_->setInputSource (input_transformed);
- if (correspondence_estimation_->requiresSourceNormals ())
- correspondence_estimation_->setSourceNormals (input_transformed_blob);
- // Estimate correspondences
- if (use_reciprocal_correspondence_)
- correspondence_estimation_->determineReciprocalCorrespondences (*correspondences_, corr_dist_threshold_);
- else
- correspondence_estimation_->determineCorrespondences (*correspondences_, corr_dist_threshold_);
-
- //...
-
- size_t cnt = correspondences_->size ();
- // Check whether we have enough correspondences
- if (cnt < min_number_correspondences_)
- {
- PCL_ERROR ("[pcl::%s::computeTransformation] Not enough correspondences found. Relax your threshold parameters.\n", getClassName ().c_str ());
- convergence_criteria_->setConvergenceState(pcl::registration::DefaultConvergenceCriteria<Scalar>::CONVERGENCE_CRITERIA_NO_CORRESPONDENCES);
- converged_ = false;
- break;
- }
-
- // Estimate the transform
- transformation_estimation_->estimateRigidTransformation (*input_transformed, *target_, *correspondences_, transformation_);
-
- // Tranform the data
- transformCloud (*input_transformed, *input_transformed, transformation_);
-
- // Obtain the final transformation
- final_transformation_ = transformation_ * final_transformation_;
-
- ++nr_iterations_;
-
- converged_ = static_cast<bool> ((*convergence_criteria_));
- }
- while (!converged_);
- template <typename PointSource, typename PointTarget, typename Scalar> inline void
- pcl::registration::TransformationEstimationSVD<PointSource, PointTarget, Scalar>::estimateRigidTransformation (
- ConstCloudIterator<PointSource>& source_it,
- ConstCloudIterator<PointTarget>& target_it,
- Matrix4 &transformation_matrix) const
- {
- // Convert to Eigen format
- const int npts = static_cast <int> (source_it.size ());
-
- if (use_umeyama_)
- {
- Eigen::Matrix<Scalar, 3, Eigen::Dynamic> cloud_src (3, npts);
- Eigen::Matrix<Scalar, 3, Eigen::Dynamic> cloud_tgt (3, npts);
-
- for (int i = 0; i < npts; ++i)
- {
- cloud_src (0, i) = source_it->x;
- cloud_src (1, i) = source_it->y;
- cloud_src (2, i) = source_it->z;
- ++source_it;
-
- cloud_tgt (0, i) = target_it->x;
- cloud_tgt (1, i) = target_it->y;
- cloud_tgt (2, i) = target_it->z;
- ++target_it;
- }
-
- // Call Umeyama directly from Eigen (PCL patched version until Eigen is released)
- transformation_matrix = pcl::umeyama (cloud_src, cloud_tgt, false);
- }
- else
- {
- source_it.reset (); target_it.reset ();
- // <cloud_src,cloud_src> is the source dataset
- transformation_matrix.setIdentity ();
-
- Eigen::Matrix<Scalar, 4, 1> centroid_src, centroid_tgt;
- // Estimate the centroids of source, target
- compute3DCentroid (source_it, centroid_src);
- compute3DCentroid (target_it, centroid_tgt);
- source_it.reset (); target_it.reset ();
-
- // Subtract the centroids from source, target
- Eigen::Matrix<Scalar, Eigen::Dynamic, Eigen::Dynamic> cloud_src_demean, cloud_tgt_demean;
- demeanPointCloud (source_it, centroid_src, cloud_src_demean);
- demeanPointCloud (target_it, centroid_tgt, cloud_tgt_demean);
-
- getTransformationFromCorrelation (cloud_src_demean, centroid_src, cloud_tgt_demean, centroid_tgt, transformation_matrix);
- }
- }
ICP有很多变种,有point-to-point的,也有point-to-plain的,一般后者的计算速度快一些,是基于法向量的,需要输入数据有较好的法向量,而法向量估计目前我对于自己的输入数据还没有很好的解决,具体使用时建议根据自己的需要及可用的输入数据选择具体方法。
两个点集的对应,输出通常是一个4×4刚性变换矩阵:代表旋转和平移,它应用于源数据集,结果是完全与目标数据集匹配。下图是“双对应”算法中一次迭代的步骤:
对两个数据源a,b匹配运算步骤如下:
关键点是场景中有特殊性质的部分,一本书的边角,书上印的字母P都可以称作关键点。PCL中提供的关键点算法如NARF,SIFT,FAST。你可以选用所有点或者它的子集作为关键点,但需要考虑的是按毎帧有300k点来算,就有300k^2种对应组合。
根据选取的关键点生成特征描述。把有用信息集合在向量里,进行比较。方法有:NARF, FPFH, BRIEF 或SIFT.
已知从两个不同的扫描图中抽取的特征向量,找出相关特征,进而找出数据中重叠的部分。根据特征的类型,可以选用不同的方法。
点匹配(point matching, 用xyz坐标作为特征),无论数据有无重组,都有如下方法:
特征匹配(feature matching, 用特征做为特征),只有下面两种方法:
除了搜索法,还有两种著名对应估计:
剔除错误估计,可用 RANSAC 算法,或减少数量,只用一部分对应关系。有一种特殊的一到多对应,即模型中一个点对应源中的一堆点。这种情况可以用最短路径对应或检查附近的其他匹配过滤掉。
Copyright © 2003-2013 www.wpsshop.cn 版权所有,并保留所有权利。