Point Cloud Library (PCL)
1.14.1-dev
|
Registration represents the base registration class for general purpose, ICP-like methods. More...
#include <pcl/registration/registration.h>
Public Member Functions | |
Registration () | |
Empty constructor. More... | |
~Registration () override=default | |
destructor. More... | |
void | setTransformationEstimation (const TransformationEstimationPtr &te) |
Provide a pointer to the transformation estimation object. More... | |
void | setCorrespondenceEstimation (const CorrespondenceEstimationPtr &ce) |
Provide a pointer to the correspondence estimation object. More... | |
virtual void | setInputSource (const PointCloudSourceConstPtr &cloud) |
Provide a pointer to the input source (e.g., the point cloud that we want to align to the target) More... | |
PointCloudSourceConstPtr const | getInputSource () |
Get a pointer to the input point cloud dataset target. More... | |
virtual void | setInputTarget (const PointCloudTargetConstPtr &cloud) |
Provide a pointer to the input target (e.g., the point cloud that we want to align the input source to) More... | |
PointCloudTargetConstPtr const | getInputTarget () |
Get a pointer to the input point cloud dataset target. More... | |
void | setSearchMethodTarget (const KdTreePtr &tree, bool force_no_recompute=false) |
Provide a pointer to the search object used to find correspondences in the target cloud. More... | |
KdTreePtr | getSearchMethodTarget () const |
Get a pointer to the search method used to find correspondences in the target cloud. More... | |
void | setSearchMethodSource (const KdTreeReciprocalPtr &tree, bool force_no_recompute=false) |
Provide a pointer to the search object used to find correspondences in the source cloud (usually used by reciprocal correspondence finding). More... | |
KdTreeReciprocalPtr | getSearchMethodSource () const |
Get a pointer to the search method used to find correspondences in the source cloud. More... | |
Matrix4 | getFinalTransformation () |
Get the final transformation matrix estimated by the registration method. More... | |
Matrix4 | getLastIncrementalTransformation () |
Get the last incremental transformation matrix estimated by the registration method. More... | |
void | setMaximumIterations (int nr_iterations) |
Set the maximum number of iterations the internal optimization should run for. More... | |
int | getMaximumIterations () |
Get the maximum number of iterations the internal optimization should run for, as set by the user. More... | |
void | setRANSACIterations (int ransac_iterations) |
Set the number of iterations RANSAC should run for. More... | |
double | getRANSACIterations () |
Get the number of iterations RANSAC should run for, as set by the user. More... | |
void | setRANSACOutlierRejectionThreshold (double inlier_threshold) |
Set the inlier distance threshold for the internal RANSAC outlier rejection loop. More... | |
double | getRANSACOutlierRejectionThreshold () |
Get the inlier distance threshold for the internal outlier rejection loop as set by the user. More... | |
void | setMaxCorrespondenceDistance (double distance_threshold) |
Set the maximum distance threshold between two correspondent points in source <-> target. More... | |
double | getMaxCorrespondenceDistance () |
Get the maximum distance threshold between two correspondent points in source <-> target. More... | |
void | setTransformationEpsilon (double epsilon) |
Set the transformation epsilon (maximum allowable translation squared difference between two consecutive transformations) in order for an optimization to be considered as having converged to the final solution. More... | |
double | getTransformationEpsilon () |
Get the transformation epsilon (maximum allowable translation squared difference between two consecutive transformations) as set by the user. More... | |
void | setTransformationRotationEpsilon (double epsilon) |
Set the transformation rotation epsilon (maximum allowable rotation difference between two consecutive transformations) in order for an optimization to be considered as having converged to the final solution. More... | |
double | getTransformationRotationEpsilon () |
Get the transformation rotation epsilon (maximum allowable difference between two consecutive transformations) as set by the user (epsilon is the cos(angle) in a axis-angle representation). More... | |
void | setEuclideanFitnessEpsilon (double epsilon) |
Set the maximum allowed Euclidean error between two consecutive steps in the ICP loop, before the algorithm is considered to have converged. More... | |
double | getEuclideanFitnessEpsilon () |
Get the maximum allowed distance error before the algorithm will be considered to have converged, as set by the user. More... | |
void | setPointRepresentation (const PointRepresentationConstPtr &point_representation) |
Provide a boost shared pointer to the PointRepresentation to be used when comparing points. More... | |
bool | registerVisualizationCallback (std::function< UpdateVisualizerCallbackSignature > &visualizerCallback) |
Register the user callback function which will be called from registration thread in order to update point cloud obtained after each iteration. More... | |
double | getFitnessScore (double max_range=std::numeric_limits< double >::max()) |
Obtain the Euclidean fitness score (e.g., mean of squared distances from the source to the target) More... | |
double | getFitnessScore (const std::vector< float > &distances_a, const std::vector< float > &distances_b) |
Obtain the Euclidean fitness score (e.g., mean of squared distances from the source to the target) from two sets of correspondence distances (distances between source and target points) More... | |
bool | hasConverged () const |
Return the state of convergence after the last align run. More... | |
void | align (PointCloudSource &output) |
Call the registration algorithm which estimates the transformation and returns the transformed source (input) as output. More... | |
void | align (PointCloudSource &output, const Matrix4 &guess) |
Call the registration algorithm which estimates the transformation and returns the transformed source (input) as output. More... | |
const std::string & | getClassName () const |
Abstract class get name method. More... | |
bool | initCompute () |
Internal computation initialization. More... | |
bool | initComputeReciprocal () |
Internal computation when reciprocal lookup is needed. More... | |
void | addCorrespondenceRejector (const CorrespondenceRejectorPtr &rejector) |
Add a new correspondence rejector to the list. More... | |
std::vector< CorrespondenceRejectorPtr > | getCorrespondenceRejectors () |
Get the list of correspondence rejectors. More... | |
bool | removeCorrespondenceRejector (unsigned int i) |
Remove the i-th correspondence rejector in the list. More... | |
void | clearCorrespondenceRejectors () |
Clear the list of correspondence rejectors. More... | |
Public Member Functions inherited from pcl::PCLBase< PointSource > | |
PCLBase () | |
Empty constructor. More... | |
PCLBase (const PCLBase &base) | |
Copy constructor. More... | |
virtual | ~PCLBase ()=default |
Destructor. More... | |
virtual void | setInputCloud (const PointCloudConstPtr &cloud) |
Provide a pointer to the input dataset. More... | |
PointCloudConstPtr const | getInputCloud () const |
Get a pointer to the input point cloud dataset. More... | |
virtual void | setIndices (const IndicesPtr &indices) |
Provide a pointer to the vector of indices that represents the input data. More... | |
virtual void | setIndices (const IndicesConstPtr &indices) |
Provide a pointer to the vector of indices that represents the input data. More... | |
virtual void | setIndices (const PointIndicesConstPtr &indices) |
Provide a pointer to the vector of indices that represents the input data. More... | |
virtual void | setIndices (std::size_t row_start, std::size_t col_start, std::size_t nb_rows, std::size_t nb_cols) |
Set the indices for the points laying within an interest region of the point cloud. More... | |
IndicesPtr | getIndices () |
Get a pointer to the vector of indices used. More... | |
IndicesConstPtr const | getIndices () const |
Get a pointer to the vector of indices used. More... | |
const PointSource & | operator[] (std::size_t pos) const |
Override PointCloud operator[] to shorten code. More... | |
Protected Member Functions | |
bool | searchForNeighbors (const PointCloudSource &cloud, int index, pcl::Indices &indices, std::vector< float > &distances) |
Search for the closest nearest neighbor of a given point. More... | |
virtual void | computeTransformation (PointCloudSource &output, const Matrix4 &guess)=0 |
Abstract transformation computation method with initial guess. More... | |
Protected Member Functions inherited from pcl::PCLBase< PointSource > | |
bool | initCompute () |
This method should get called before starting the actual computation. More... | |
bool | deinitCompute () |
This method should get called after finishing the actual computation. More... | |
Protected Attributes | |
std::string | reg_name_ |
The registration method name. More... | |
KdTreePtr | tree_ |
A pointer to the spatial search object. More... | |
KdTreeReciprocalPtr | tree_reciprocal_ |
A pointer to the spatial search object of the source. More... | |
int | nr_iterations_ {0} |
The number of iterations the internal optimization ran for (used internally). More... | |
int | max_iterations_ {10} |
The maximum number of iterations the internal optimization should run for. More... | |
int | ransac_iterations_ {0} |
The number of iterations RANSAC should run for. More... | |
PointCloudTargetConstPtr | target_ |
The input point cloud dataset target. More... | |
Matrix4 | final_transformation_ |
The final transformation matrix estimated by the registration method after N iterations. More... | |
Matrix4 | transformation_ |
The transformation matrix estimated by the registration method. More... | |
Matrix4 | previous_transformation_ |
The previous transformation matrix estimated by the registration method (used internally). More... | |
double | transformation_epsilon_ {0.0} |
The maximum difference between two consecutive transformations in order to consider convergence (user defined). More... | |
double | transformation_rotation_epsilon_ {0.0} |
The maximum rotation difference between two consecutive transformations in order to consider convergence (user defined). More... | |
double | euclidean_fitness_epsilon_ |
The maximum allowed Euclidean error between two consecutive steps in the ICP loop, before the algorithm is considered to have converged. More... | |
double | corr_dist_threshold_ |
The maximum distance threshold between two correspondent points in source <-> target. More... | |
double | inlier_threshold_ {0.05} |
The inlier distance threshold for the internal RANSAC outlier rejection loop. More... | |
bool | converged_ {false} |
Holds internal convergence state, given user parameters. More... | |
unsigned int | min_number_correspondences_ {3} |
The minimum number of correspondences that the algorithm needs before attempting to estimate the transformation. More... | |
CorrespondencesPtr | correspondences_ |
The set of correspondences determined at this ICP step. More... | |
TransformationEstimationPtr | transformation_estimation_ |
A TransformationEstimation object, used to calculate the 4x4 rigid transformation. More... | |
CorrespondenceEstimationPtr | correspondence_estimation_ |
A CorrespondenceEstimation object, used to estimate correspondences between the source and the target cloud. More... | |
std::vector< CorrespondenceRejectorPtr > | correspondence_rejectors_ |
The list of correspondence rejectors to use. More... | |
bool | target_cloud_updated_ {true} |
Variable that stores whether we have a new target cloud, meaning we need to pre-process it again. More... | |
bool | source_cloud_updated_ {true} |
Variable that stores whether we have a new source cloud, meaning we need to pre-process it again. More... | |
bool | force_no_recompute_ {false} |
A flag which, if set, means the tree operating on the target cloud will never be recomputed. More... | |
bool | force_no_recompute_reciprocal_ {false} |
A flag which, if set, means the tree operating on the source cloud will never be recomputed. More... | |
std::function< UpdateVisualizerCallbackSignature > | update_visualizer_ |
Callback function to update intermediate source point cloud position during it's registration to the target point cloud. More... | |
Protected Attributes inherited from pcl::PCLBase< PointSource > | |
PointCloudConstPtr | input_ |
The input point cloud dataset. More... | |
IndicesPtr | indices_ |
A pointer to the vector of point indices to use. More... | |
bool | use_indices_ |
Set to true if point indices are used. More... | |
bool | fake_indices_ |
If no set of indices are given, we construct a set of fake indices that mimic the input PointCloud. More... | |
Registration represents the base registration class for general purpose, ICP-like methods.
Definition at line 57 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::ConstPtr = shared_ptr<const Registration<PointSource, PointTarget, Scalar> > |
Definition at line 67 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::CorrespondenceEstimation = pcl::registration::CorrespondenceEstimationBase<PointSource, PointTarget, Scalar> |
Definition at line 91 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::CorrespondenceEstimationConstPtr = typename CorrespondenceEstimation::ConstPtr |
Definition at line 94 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::CorrespondenceEstimationPtr = typename CorrespondenceEstimation::Ptr |
Definition at line 93 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::CorrespondenceRejectorPtr = pcl::registration::CorrespondenceRejector::Ptr |
Definition at line 69 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::KdTree = pcl::search::KdTree<PointTarget> |
Definition at line 70 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::KdTreePtr = typename KdTree::Ptr |
Definition at line 71 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::KdTreeReciprocal = pcl::search::KdTree<PointSource> |
Definition at line 73 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::KdTreeReciprocalPtr = typename KdTreeReciprocal::Ptr |
Definition at line 74 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::Matrix4 = Eigen::Matrix<Scalar, 4, 4> |
Definition at line 59 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudSource = pcl::PointCloud<PointSource> |
Definition at line 76 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudSourceConstPtr = typename PointCloudSource::ConstPtr |
Definition at line 78 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudSourcePtr = typename PointCloudSource::Ptr |
Definition at line 77 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudTarget = pcl::PointCloud<PointTarget> |
Definition at line 80 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudTargetConstPtr = typename PointCloudTarget::ConstPtr |
Definition at line 82 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointCloudTargetPtr = typename PointCloudTarget::Ptr |
Definition at line 81 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::PointRepresentationConstPtr = typename KdTree::PointRepresentationConstPtr |
Definition at line 84 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::Ptr = shared_ptr<Registration<PointSource, PointTarget, Scalar> > |
Definition at line 66 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::TransformationEstimation = typename pcl::registration:: TransformationEstimation<PointSource, PointTarget, Scalar> |
Definition at line 86 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::TransformationEstimationConstPtr = typename TransformationEstimation::ConstPtr |
Definition at line 89 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::TransformationEstimationPtr = typename TransformationEstimation::Ptr |
Definition at line 88 of file registration.h.
using pcl::Registration< PointSource, PointTarget, Scalar >::UpdateVisualizerCallbackSignature = void(const pcl::PointCloud<PointSource>&, const pcl::Indices&, const pcl::PointCloud<PointTarget>&, const pcl::Indices&) |
The callback signature to the function updating intermediate source point cloud position during it's registration to the target point cloud.
[in] | cloud_src | - the point cloud which will be updated to match target |
[in] | indices_src | - a selector of points in cloud_src |
[in] | cloud_tgt | - the point cloud we want to register against |
[in] | indices_tgt | - a selector of points in cloud_tgt |
Definition at line 103 of file registration.h.
|
inline |
Empty constructor.
Definition at line 109 of file registration.h.
|
overridedefault |
destructor.
|
inline |
Add a new correspondence rejector to the list.
[in] | rejector | the new correspondence rejector to concatenate |
Code example:
Definition at line 515 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::correspondence_rejectors_.
|
inline |
Call the registration algorithm which estimates the transformation and returns the transformed source (input) as output.
[out] | output | the resultant input transformed point cloud dataset |
Definition at line 168 of file registration.hpp.
|
inline |
Call the registration algorithm which estimates the transformation and returns the transformed source (input) as output.
[out] | output | the resultant input transformed point cloud dataset |
[in] | guess | the initial gross estimation of the transformation |
Definition at line 175 of file registration.hpp.
References pcl::PointCloud< PointT >::header, and pcl::PointCloud< PointT >::resize().
|
inline |
Clear the list of correspondence rejectors.
Definition at line 541 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::correspondence_rejectors_.
|
protectedpure virtual |
Abstract transformation computation method with initial guess.
Implemented in pcl::IterativeClosestPoint< PointXYZRGBA, PointXYZRGBA, float >, and pcl::GeneralizedIterativeClosestPoint< PointXYZRGBA, PointXYZRGBA >.
References pcl::Registration< PointSource, PointTarget, Scalar >::setInputSource().
|
inline |
Abstract class get name method.
Definition at line 485 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::reg_name_.
Referenced by pcl::RegistrationVisualizer< PointSource, PointTarget, Scalar >::setRegistration().
|
inline |
Get the list of correspondence rejectors.
Definition at line 522 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::correspondence_rejectors_.
|
inline |
Get the maximum allowed distance error before the algorithm will be considered to have converged, as set by the user.
See setEuclideanFitnessEpsilon
Definition at line 412 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::euclidean_fitness_epsilon_.
|
inline |
Get the final transformation matrix estimated by the registration method.
Definition at line 259 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::final_transformation_.
|
inline |
Obtain the Euclidean fitness score (e.g., mean of squared distances from the source to the target) from two sets of correspondence distances (distances between source and target points)
[in] | distances_a | the first set of distances between correspondences |
[in] | distances_b | the second set of distances between correspondences |
Definition at line 122 of file registration.hpp.
|
inline |
Obtain the Euclidean fitness score (e.g., mean of squared distances from the source to the target)
[in] | max_range | maximum allowable distance between a point and its correspondence in the target (default: double::max) |
Definition at line 134 of file registration.hpp.
References pcl::isXYZFinite(), and pcl::transformPointCloud().
|
inline |
Get a pointer to the input point cloud dataset target.
Definition at line 189 of file registration.h.
References pcl::PCLBase< PointSource >::input_.
|
inline |
Get a pointer to the input point cloud dataset target.
Definition at line 202 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::target_.
|
inline |
Get the last incremental transformation matrix estimated by the registration method.
Definition at line 267 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_.
|
inline |
Get the maximum distance threshold between two correspondent points in source <-> target.
If the distance is larger than this threshold, the points will be ignored in the alignment process.
Definition at line 346 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::corr_dist_threshold_.
|
inline |
Get the maximum number of iterations the internal optimization should run for, as set by the user.
Definition at line 285 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::max_iterations_.
|
inline |
Get the number of iterations RANSAC should run for, as set by the user.
Definition at line 301 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::ransac_iterations_.
|
inline |
Get the inlier distance threshold for the internal outlier rejection loop as set by the user.
Definition at line 324 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::inlier_threshold_.
|
inline |
Get a pointer to the search method used to find correspondences in the source cloud.
Definition at line 251 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::tree_reciprocal_.
|
inline |
Get a pointer to the search method used to find correspondences in the target cloud.
Definition at line 226 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::tree_.
|
inline |
Get the transformation epsilon (maximum allowable translation squared difference between two consecutive transformations) as set by the user.
Definition at line 367 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_epsilon_.
|
inline |
Get the transformation rotation epsilon (maximum allowable difference between two consecutive transformations) as set by the user (epsilon is the cos(angle) in a axis-angle representation).
Definition at line 390 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_rotation_epsilon_.
|
inline |
Return the state of convergence after the last align run.
Definition at line 463 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::converged_.
bool pcl::Registration< PointSource, PointTarget, Scalar >::initCompute |
Internal computation initialization.
Definition at line 75 of file registration.hpp.
bool pcl::Registration< PointSource, PointTarget, Scalar >::initComputeReciprocal |
Internal computation when reciprocal lookup is needed.
Definition at line 105 of file registration.hpp.
|
inline |
Register the user callback function which will be called from registration thread in order to update point cloud obtained after each iteration.
[in] | visualizerCallback | reference of the user callback function |
Definition at line 432 of file registration.h.
References pcl::PCLBase< PointSource >::input_, pcl::Registration< PointSource, PointTarget, Scalar >::target_, and pcl::Registration< PointSource, PointTarget, Scalar >::update_visualizer_.
Referenced by pcl::RegistrationVisualizer< PointSource, PointTarget, Scalar >::setRegistration().
|
inline |
Remove the i-th correspondence rejector in the list.
[in] | i | the position of the correspondence rejector in the list to remove |
Definition at line 531 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::correspondence_rejectors_.
|
inlineprotected |
Search for the closest nearest neighbor of a given point.
cloud | the point cloud dataset to use for nearest neighbor search |
index | the index of the query point |
indices | the resultant vector of indices representing the k-nearest neighbors |
distances | the resultant distances from the query point to the k-nearest neighbors |
Definition at line 663 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::tree_.
|
inline |
Provide a pointer to the correspondence estimation object.
(e.g., regular, reciprocal, normal shooting etc.)
[in] | ce | is the pointer to the corresponding correspondence estimation object |
Code example:
Definition at line 174 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::correspondence_estimation_.
|
inline |
Set the maximum allowed Euclidean error between two consecutive steps in the ICP loop, before the algorithm is considered to have converged.
The error is estimated as the sum of the differences between correspondences in an Euclidean sense, divided by the number of correspondences.
[in] | epsilon | the maximum allowed distance error before the algorithm will be considered to have converged |
Definition at line 402 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::euclidean_fitness_epsilon_.
|
inlinevirtual |
Provide a pointer to the input source (e.g., the point cloud that we want to align to the target)
[in] | cloud | the input point cloud source |
Reimplemented in pcl::IterativeClosestPoint< PointSource, PointTarget, Scalar >, pcl::IterativeClosestPoint< PointSource, PointTarget, float >, and pcl::JointIterativeClosestPoint< PointSource, PointTarget, Scalar >.
Definition at line 47 of file registration.hpp.
References pcl::PCLBase< PointT >::setInputCloud().
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::computeTransformation(), and pcl::IterativeClosestPoint< PointSource, PointTarget, Scalar >::setInputSource().
|
inlinevirtual |
Provide a pointer to the input target (e.g., the point cloud that we want to align the input source to)
[in] | cloud | the input point cloud target |
Reimplemented in pcl::PPFRegistration< PointSource, PointTarget >, pcl::NormalDistributionsTransform< PointSource, PointTarget, Scalar >, pcl::IterativeClosestPoint< PointSource, PointTarget, Scalar >, pcl::IterativeClosestPoint< PointSource, PointTarget, float >, and pcl::JointIterativeClosestPoint< PointSource, PointTarget, Scalar >.
Definition at line 61 of file registration.hpp.
Referenced by pcl::IterativeClosestPoint< PointSource, PointTarget, Scalar >::setInputTarget(), and pcl::NormalDistributionsTransform< PointSource, PointTarget, Scalar >::setInputTarget().
|
inline |
Set the maximum distance threshold between two correspondent points in source <-> target.
If the distance is larger than this threshold, the points will be ignored in the alignment process.
[in] | distance_threshold | the maximum distance threshold between a point and its nearest neighbor correspondent in order to be considered in the alignment process |
Definition at line 336 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::corr_dist_threshold_.
|
inline |
Set the maximum number of iterations the internal optimization should run for.
[in] | nr_iterations | the maximum number of iterations the internal optimization should run for |
Definition at line 277 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::max_iterations_.
|
inline |
Provide a boost shared pointer to the PointRepresentation to be used when comparing points.
[in] | point_representation | the PointRepresentation to be used by the k-D tree |
Definition at line 422 of file registration.h.
|
inline |
Set the number of iterations RANSAC should run for.
[in] | ransac_iterations | is the number of iterations RANSAC should run for |
Definition at line 294 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::ransac_iterations_.
|
inline |
Set the inlier distance threshold for the internal RANSAC outlier rejection loop.
The method considers a point to be an inlier, if the distance between the target data index and the transformed source index is smaller than the given inlier distance threshold. The value is set by default to 0.05m.
[in] | inlier_threshold | the inlier distance threshold for the internal RANSAC outlier rejection loop |
Definition at line 316 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::inlier_threshold_.
|
inline |
Provide a pointer to the search object used to find correspondences in the source cloud (usually used by reciprocal correspondence finding).
[in] | tree | a pointer to the spatial search object. |
[in] | force_no_recompute | If set to true, this tree will NEVER be recomputed, regardless of calls to setInputSource. Only use if you are extremely confident that the tree will be set correctly. |
Definition at line 239 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::force_no_recompute_reciprocal_, pcl::Registration< PointSource, PointTarget, Scalar >::source_cloud_updated_, and pcl::Registration< PointSource, PointTarget, Scalar >::tree_reciprocal_.
|
inline |
Provide a pointer to the search object used to find correspondences in the target cloud.
[in] | tree | a pointer to the spatial search object. |
[in] | force_no_recompute | If set to true, this tree will NEVER be recomputed, regardless of calls to setInputTarget. Only use if you are confident that the tree will be set correctly. |
Definition at line 215 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::force_no_recompute_, pcl::Registration< PointSource, PointTarget, Scalar >::target_cloud_updated_, and pcl::Registration< PointSource, PointTarget, Scalar >::tree_.
|
inline |
Set the transformation epsilon (maximum allowable translation squared difference between two consecutive transformations) in order for an optimization to be considered as having converged to the final solution.
[in] | epsilon | the transformation epsilon in order for an optimization to be considered as having converged to the final solution. |
Definition at line 358 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_epsilon_.
|
inline |
Provide a pointer to the transformation estimation object.
(e.g., SVD, point to plane etc.)
[in] | te | is the pointer to the corresponding transformation estimation object |
Code example:
Definition at line 145 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_estimation_.
|
inline |
Set the transformation rotation epsilon (maximum allowable rotation difference between two consecutive transformations) in order for an optimization to be considered as having converged to the final solution.
[in] | epsilon | the transformation rotation epsilon in order for an optimization to be considered as having converged to the final solution (epsilon is the cos(angle) in a axis-angle representation). |
Definition at line 380 of file registration.h.
References pcl::Registration< PointSource, PointTarget, Scalar >::transformation_rotation_epsilon_.
|
protected |
Holds internal convergence state, given user parameters.
Definition at line 613 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::hasConverged().
|
protected |
The maximum distance threshold between two correspondent points in source <-> target.
If the distance is larger than this threshold, the points will be ignored in the alignment process.
Definition at line 603 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getMaxCorrespondenceDistance(), pcl::SampleConsensusInitialAlignment< PointSource, PointTarget, FeatureT >::SampleConsensusInitialAlignment(), and pcl::Registration< PointSource, PointTarget, Scalar >::setMaxCorrespondenceDistance().
|
protected |
A CorrespondenceEstimation object, used to estimate correspondences between the source and the target cloud.
Definition at line 629 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::setCorrespondenceEstimation().
|
protected |
The list of correspondence rejectors to use.
Definition at line 632 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::addCorrespondenceRejector(), pcl::Registration< PointSource, PointTarget, Scalar >::clearCorrespondenceRejectors(), pcl::Registration< PointSource, PointTarget, Scalar >::getCorrespondenceRejectors(), and pcl::Registration< PointSource, PointTarget, Scalar >::removeCorrespondenceRejector().
|
protected |
The set of correspondences determined at this ICP step.
Definition at line 621 of file registration.h.
|
protected |
The maximum allowed Euclidean error between two consecutive steps in the ICP loop, before the algorithm is considered to have converged.
The error is estimated as the sum of the differences between correspondences in an Euclidean sense, divided by the number of correspondences.
Definition at line 597 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getEuclideanFitnessEpsilon(), and pcl::Registration< PointSource, PointTarget, Scalar >::setEuclideanFitnessEpsilon().
|
protected |
The final transformation matrix estimated by the registration method after N iterations.
Definition at line 573 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getFinalTransformation().
|
protected |
A flag which, if set, means the tree operating on the target cloud will never be recomputed.
Definition at line 644 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodTarget().
|
protected |
A flag which, if set, means the tree operating on the source cloud will never be recomputed.
Definition at line 648 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodSource().
|
protected |
The inlier distance threshold for the internal RANSAC outlier rejection loop.
The method considers a point to be an inlier, if the distance between the target data index and the transformed source index is smaller than the given inlier distance threshold. The default value is 0.05.
Definition at line 610 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getRANSACOutlierRejectionThreshold(), and pcl::Registration< PointSource, PointTarget, Scalar >::setRANSACOutlierRejectionThreshold().
|
protected |
The maximum number of iterations the internal optimization should run for.
The default value is 10.
Definition at line 563 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getMaximumIterations(), pcl::SampleConsensusInitialAlignment< PointSource, PointTarget, FeatureT >::SampleConsensusInitialAlignment(), pcl::SampleConsensusPrerejective< PointSource, PointTarget, FeatureT >::SampleConsensusPrerejective(), and pcl::Registration< PointSource, PointTarget, Scalar >::setMaximumIterations().
|
protected |
The minimum number of correspondences that the algorithm needs before attempting to estimate the transformation.
The default value is 3.
Definition at line 618 of file registration.h.
|
protected |
The number of iterations the internal optimization ran for (used internally).
Definition at line 558 of file registration.h.
|
protected |
The previous transformation matrix estimated by the registration method (used internally).
Definition at line 580 of file registration.h.
|
protected |
The number of iterations RANSAC should run for.
Definition at line 566 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getRANSACIterations(), and pcl::Registration< PointSource, PointTarget, Scalar >::setRANSACIterations().
|
protected |
The registration method name.
Definition at line 548 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getClassName(), pcl::NormalDistributionsTransform2D< PointSource, PointTarget >::NormalDistributionsTransform2D(), pcl::SampleConsensusInitialAlignment< PointSource, PointTarget, FeatureT >::SampleConsensusInitialAlignment(), and pcl::SampleConsensusPrerejective< PointSource, PointTarget, FeatureT >::SampleConsensusPrerejective().
|
protected |
Variable that stores whether we have a new source cloud, meaning we need to pre-process it again.
This way, we avoid rebuilding the reciprocal kd-tree for the source cloud every time the determineCorrespondences () method is called.
Definition at line 641 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodSource().
|
protected |
The input point cloud dataset target.
Definition at line 569 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getInputTarget(), and pcl::Registration< PointSource, PointTarget, Scalar >::registerVisualizationCallback().
|
protected |
Variable that stores whether we have a new target cloud, meaning we need to pre-process it again.
This way, we avoid rebuilding the kd-tree for the target cloud every time the determineCorrespondences () method is called.
Definition at line 637 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodTarget().
|
protected |
The transformation matrix estimated by the registration method.
Definition at line 576 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getLastIncrementalTransformation().
|
protected |
The maximum difference between two consecutive transformations in order to consider convergence (user defined).
Definition at line 585 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getTransformationEpsilon(), and pcl::Registration< PointSource, PointTarget, Scalar >::setTransformationEpsilon().
|
protected |
A TransformationEstimation object, used to calculate the 4x4 rigid transformation.
Definition at line 625 of file registration.h.
Referenced by pcl::SampleConsensusInitialAlignment< PointSource, PointTarget, FeatureT >::SampleConsensusInitialAlignment(), pcl::SampleConsensusPrerejective< PointSource, PointTarget, FeatureT >::SampleConsensusPrerejective(), and pcl::Registration< PointSource, PointTarget, Scalar >::setTransformationEstimation().
|
protected |
The maximum rotation difference between two consecutive transformations in order to consider convergence (user defined).
Definition at line 590 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getTransformationRotationEpsilon(), and pcl::Registration< PointSource, PointTarget, Scalar >::setTransformationRotationEpsilon().
|
protected |
A pointer to the spatial search object.
Definition at line 551 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getSearchMethodTarget(), pcl::Registration< PointSource, PointTarget, Scalar >::searchForNeighbors(), and pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodTarget().
|
protected |
A pointer to the spatial search object of the source.
Definition at line 554 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::getSearchMethodSource(), and pcl::Registration< PointSource, PointTarget, Scalar >::setSearchMethodSource().
|
protected |
Callback function to update intermediate source point cloud position during it's registration to the target point cloud.
Definition at line 653 of file registration.h.
Referenced by pcl::Registration< PointSource, PointTarget, Scalar >::registerVisualizationCallback().