, including all inherited members.
| align(PointCloudSource &output) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| computeTransformation(PointCloudSource &output) | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline, protected, virtual] |
| converged_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| corr_dist_threshold_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| curvature_check_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| deinitCompute() | pcl::PCLBase< PointSource > | [protected] |
| end | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| epsilon_curvature_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| epsilon_z_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| estimateRigidTransformationSVD(const PointCloudSource &cloud_src, const PointCloudTarget &cloud_tgt, Eigen::Matrix4f &transformation_matrix) | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| fake_indices_ | pcl::PCLBase< PointSource > | [protected] |
| field_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| final_transformation_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| getClassName() const | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline, protected] |
| getFinalTransformation() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getFitnessScore(double max_range=std::numeric_limits< double >::max()) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getIndices() | pcl::PCLBase< PointSource > | |
| getInputCloud() | pcl::PCLBase< PointSource > | |
| getInputTarget() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getLastIncrementalTransformation() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getMaxCorrespondenceDistance() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getMaximumIterations() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| getTransformationEpsilon() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| indices_ | pcl::PCLBase< PointSource > | [protected] |
| initCompute() | pcl::PCLBase< PointSource > | [protected] |
| input_ | pcl::PCLBase< PointSource > | [protected] |
| IterativeClosestPointCorrespondencesCheck() | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| IterativeClosestPointCorrespondencesCheck(double radius, int max_nn, double epsilon_z, double epsilon_curvature, bool curvature_check) | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| KdTree typedef | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | |
| KdTreePtr typedef | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | |
| max_iterations_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| max_nn_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| min_number_correspondences_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| nr_iterations_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| operator[](size_t pos) | pcl::PCLBase< PointSource > | |
| PCLBase() | pcl::PCLBase< PointSource > | |
| PCLBase(const PCLBase &base) | pcl::PCLBase< PointSource > | |
| PointCloud typedef | pcl::PCLBase< PointSource > | |
| PointCloudConstPtr typedef | pcl::PCLBase< PointSource > | |
| PointCloudPtr typedef | pcl::PCLBase< PointSource > | |
| PointCloudSource typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| PointCloudSourceConstPtr typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| PointCloudSourcePtr typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| PointCloudTarget typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| PointCloudTargetConstPtr typedef | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | |
| PointCloudTargetPtr typedef | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | |
| PointIndicesConstPtr typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| PointIndicesPtr typedef | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| previous_transformation_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| radius_ | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| reg_name_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| RegistrationCorrespondencesCheck() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| searchForNeighbors(const PointCloudSource &cloud, int index, double radius, int max_nn, std::vector< int > &indices, std::vector< float > &distances) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline, protected] |
| setIndices(const IndicesPtr &indices) | pcl::PCLBase< PointSource > | |
| setIndices(const IndicesConstPtr &indices) | pcl::PCLBase< PointSource > | |
| setIndices(const PointIndicesConstPtr &indices) | pcl::PCLBase< PointSource > | |
| setIndices(size_t row_start, size_t col_start, size_t nb_rows, size_t nb_cols) | pcl::PCLBase< PointSource > | |
| setInputCloud(const PointCloudConstPtr &cloud) | pcl::PCLBase< PointSource > | [virtual] |
| setInputTarget(const PointCloudTargetConstPtr &cloud) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline, virtual] |
| setMaxCorrespondenceDistance(double distance_threshold) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| setMaximumIterations(int nr_iterations) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| setParameters(double radius, int max_nn, double epsilon_z, double epsilon_curvature, bool curvature_check, std::string field) | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| setPointRepresentation(const typename KdTree::PointRepresentationConstPtr &point_representation) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| setTransformationEpsilon(double epsilon) | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline] |
| start | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [private] |
| target_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| transformation_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| transformation_epsilon_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| tree_ | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [protected] |
| use_indices_ | pcl::PCLBase< PointSource > | [protected] |
| ~IterativeClosestPointCorrespondencesCheck() | pcl::IterativeClosestPointCorrespondencesCheck< PointSource, PointTarget > | [inline, virtual] |
| ~PCLBase() | pcl::PCLBase< PointSource > | [virtual] |
| ~RegistrationCorrespondencesCheck() | pcl::RegistrationCorrespondencesCheck< PointSource, PointTarget > | [inline, virtual] |