pcl::FPFHEstimation< PointInT, PointNT, PointOutT > Member List
This is the complete list of members for pcl::FPFHEstimation< PointInT, PointNT, PointOutT >, including all inherited members.
BaseClass typedefpcl::Feature< PointInT, PointOutT >
compute(PointCloudOut &output)pcl::Feature< PointInT, PointOutT >
computeFeature(PointCloudOut &output)pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected, virtual]
computePairFeatures(const pcl::PointCloud< PointInT > &cloud, const pcl::PointCloud< PointNT > &normals, int p_idx, int q_idx, float &f1, float &f2, float &f3, float &f4)pcl::FPFHEstimation< PointInT, PointNT, PointOutT >
computePointSPFHSignature(const pcl::PointCloud< PointInT > &cloud, const pcl::PointCloud< PointNT > &normals, int p_idx, int row, const std::vector< int > &indices, Eigen::MatrixXf &hist_f1, Eigen::MatrixXf &hist_f2, Eigen::MatrixXf &hist_f3)pcl::FPFHEstimation< PointInT, PointNT, PointOutT >
computeSPFHSignatures(std::vector< int > &spf_hist_lookup, Eigen::MatrixXf &hist_f1, Eigen::MatrixXf &hist_f2, Eigen::MatrixXf &hist_f3)pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
ConstPtr typedefpcl::FPFHEstimation< PointInT, PointNT, PointOutT >
d_pi_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
deinitCompute()pcl::Feature< PointInT, PointOutT > [protected, virtual]
fake_indices_pcl::PCLBase< PointInT > [protected]
fake_surface_pcl::Feature< PointInT, PointOutT > [protected]
Feature()pcl::Feature< PointInT, PointOutT > [inline]
feature_name_pcl::Feature< PointInT, PointOutT > [protected]
FeatureFromNormals()pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [inline]
fpfh_histogram_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
FPFHEstimation()pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [inline]
getClassName() const pcl::Feature< PointInT, PointOutT > [inline, protected]
getIndices()pcl::PCLBase< PointInT > [inline]
getInputCloud()pcl::PCLBase< PointInT > [inline]
getInputNormals() const pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [inline]
getKSearch() const pcl::Feature< PointInT, PointOutT > [inline]
getNrSubdivisions(int &nr_bins_f1, int &nr_bins_f2, int &nr_bins_f3)pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [inline]
getRadiusSearch() const pcl::Feature< PointInT, PointOutT > [inline]
getSearchMethod() const pcl::Feature< PointInT, PointOutT > [inline]
getSearchParameter() const pcl::Feature< PointInT, PointOutT > [inline]
getSearchSurface() const pcl::Feature< PointInT, PointOutT > [inline]
hist_f1_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
hist_f2_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
hist_f3_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
indices_pcl::PCLBase< PointInT > [protected]
initCompute()pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [protected, virtual]
input_pcl::PCLBase< PointInT > [protected]
k_pcl::Feature< PointInT, PointOutT > [protected]
KdTree typedefpcl::Feature< PointInT, PointOutT >
KdTreePtr typedefpcl::Feature< PointInT, PointOutT >
normals_pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [protected]
nr_bins_f1_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
nr_bins_f2_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
nr_bins_f3_pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [protected]
operator[](size_t pos)pcl::PCLBase< PointInT > [inline]
PCLBase()pcl::PCLBase< PointInT >
PCLBase(const PCLBase &base)pcl::PCLBase< PointInT >
PointCloud typedefpcl::PCLBase< PointInT >
PointCloudConstPtr typedefpcl::PCLBase< PointInT >
PointCloudN typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudNConstPtr typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudNPtr typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudOut typedefpcl::FPFHEstimation< PointInT, PointNT, PointOutT >
PointCloudPtr typedefpcl::PCLBase< PointInT >
PointIndicesConstPtr typedefpcl::PCLBase< PointInT >
PointIndicesPtr typedefpcl::PCLBase< PointInT >
Ptr typedefpcl::FPFHEstimation< PointInT, PointNT, PointOutT >
search_method_surface_pcl::Feature< PointInT, PointOutT > [protected]
search_parameter_pcl::Feature< PointInT, PointOutT > [protected]
search_radius_pcl::Feature< PointInT, PointOutT > [protected]
searchForNeighbors(size_t index, double parameter, std::vector< int > &indices, std::vector< float > &distances) const pcl::Feature< PointInT, PointOutT > [inline, protected]
searchForNeighbors(const PointCloudIn &cloud, size_t index, double parameter, std::vector< int > &indices, std::vector< float > &distances) const pcl::Feature< PointInT, PointOutT > [inline, protected]
SearchMethod typedefpcl::Feature< PointInT, PointOutT >
SearchMethodSurface typedefpcl::Feature< PointInT, PointOutT >
setIndices(const IndicesPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(const IndicesConstPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(const PointIndicesConstPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(size_t row_start, size_t col_start, size_t nb_rows, size_t nb_cols)pcl::PCLBase< PointInT > [virtual]
setInputCloud(const PointCloudConstPtr &cloud)pcl::PCLBase< PointInT > [virtual]
setInputNormals(const PointCloudNConstPtr &normals)pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [inline]
setKSearch(int k)pcl::Feature< PointInT, PointOutT > [inline]
setNrSubdivisions(int nr_bins_f1, int nr_bins_f2, int nr_bins_f3)pcl::FPFHEstimation< PointInT, PointNT, PointOutT > [inline]
setRadiusSearch(double radius)pcl::Feature< PointInT, PointOutT > [inline]
setSearchMethod(const KdTreePtr &tree)pcl::Feature< PointInT, PointOutT > [inline]
setSearchSurface(const PointCloudInConstPtr &cloud)pcl::Feature< PointInT, PointOutT > [inline]
surface_pcl::Feature< PointInT, PointOutT > [protected]
tree_pcl::Feature< PointInT, PointOutT > [protected]
use_indices_pcl::PCLBase< PointInT > [protected]
weightPointSPFHSignature(const Eigen::MatrixXf &hist_f1, const Eigen::MatrixXf &hist_f2, const Eigen::MatrixXf &hist_f3, const std::vector< int > &indices, const std::vector< float > &dists, Eigen::VectorXf &fpfh_histogram)pcl::FPFHEstimation< PointInT, PointNT, PointOutT >
~Feature()pcl::Feature< PointInT, PointOutT > [inline, virtual]
~FeatureFromNormals()pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [inline, virtual]
~PCLBase()pcl::PCLBase< PointInT > [inline, virtual]


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:40:56