#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/surface/mls.h>
#include <pcl/features/fpfh.h>
#include <pcl/registration/ia_ransac.h>
#include <pcl/registration/icp_nl.h>
#include <pcl/point_representation.h>
#include <pcl/filters/voxel_grid.h>
#include <hrl_phri_2011/pcl_basic.h>
#include <hrl_phri_2011/hsl_rgb_conversions.h>
Go to the source code of this file.
Classes | |
class | pcl::DefaultPointRepresentation< PRGB > |
Namespaces | |
namespace | pcl |
Typedefs | |
typedef pcl::PointCloud < pcl::FPFHSignature33 > | FPFeatures |
typedef pcl::KdTree< PRGB > | KDTree |
typedef pcl::PointCloud < pcl::Normal > | PCNormals |
Functions | |
void | computeFPFH (const PCRGB::Ptr &in_pc, FPFeatures::Ptr &out_features) |
void | computeICPRegistration (const PCRGB::Ptr &target_pc, const PCRGB::Ptr &source_pc, Eigen::Affine3d &tf_mat, int max_iters=300, double color_weight=0.0005) |
void | computeNormals (const PCRGB::Ptr &in_pc, const KDTree::Ptr &in_kd_tree, PCNormals::Ptr &out_normals) |
void | computeSACRegistration (const PCRGB::Ptr &target_pc, const PCRGB::Ptr &source_pc) |
typedef pcl::PointCloud<pcl::FPFHSignature33> FPFeatures |
Definition at line 15 of file pcl_features.h.
Definition at line 13 of file pcl_features.h.
typedef pcl::PointCloud<pcl::Normal> PCNormals |
Definition at line 14 of file pcl_features.h.
void computeFPFH | ( | const PCRGB::Ptr & | in_pc, |
FPFeatures::Ptr & | out_features | ||
) |
Definition at line 15 of file pcl_features.cpp.
void computeICPRegistration | ( | const PCRGB::Ptr & | target_pc, |
const PCRGB::Ptr & | source_pc, | ||
Eigen::Affine3d & | tf_mat, | ||
int | max_iters = 300 , |
||
double | color_weight = 0.0005 |
||
) |
Definition at line 55 of file pcl_features.cpp.
void computeNormals | ( | const PCRGB::Ptr & | in_pc, |
const KDTree::Ptr & | in_kd_tree, | ||
PCNormals::Ptr & | out_normals | ||
) |
Definition at line 3 of file pcl_features.cpp.
void computeSACRegistration | ( | const PCRGB::Ptr & | target_pc, |
const PCRGB::Ptr & | source_pc | ||
) |
Definition at line 28 of file pcl_features.cpp.