Public Types | Public Member Functions | Protected Member Functions | Private Attributes
pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT > Class Template Reference

#include <pfhrgb.h>

Inheritance diagram for pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >:
Inheritance graph
[legend]

List of all members.

Public Types

typedef boost::shared_ptr
< const PFHRGBEstimation
< PointInT, PointNT, PointOutT > > 
ConstPtr
typedef Feature< PointInT,
PointOutT >::PointCloudOut 
PointCloudOut
typedef boost::shared_ptr
< PFHRGBEstimation< PointInT,
PointNT, PointOutT > > 
Ptr

Public Member Functions

void computePointPFHRGBSignature (const pcl::PointCloud< PointInT > &cloud, const pcl::PointCloud< PointNT > &normals, const std::vector< int > &indices, int nr_split, Eigen::VectorXf &pfhrgb_histogram)
bool computeRGBPairFeatures (const pcl::PointCloud< PointInT > &cloud, const pcl::PointCloud< PointNT > &normals, int p_idx, int q_idx, float &f1, float &f2, float &f3, float &f4, float &f5, float &f6, float &f7)
 PFHRGBEstimation ()

Protected Member Functions

void computeFeature (PointCloudOut &output)
 Abstract feature estimation method.

Private Attributes

float d_pi_
 Float constant = 1.0 / (2.0 * M_PI)
int f_index_ [7]
 Placeholder for a histogram index.
int nr_subdiv_
 The number of subdivisions for each angular feature interval.
Eigen::VectorXf pfhrgb_histogram_
 Placeholder for a point's PFHRGB signature.
Eigen::VectorXf pfhrgb_tuple_
 Placeholder for a PFHRGB 7-tuple.

Detailed Description

template<typename PointInT, typename PointNT, typename PointOutT = pcl::PFHRGBSignature250>
class pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >

Definition at line 49 of file pfhrgb.h.


Member Typedef Documentation

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
typedef boost::shared_ptr<const PFHRGBEstimation<PointInT, PointNT, PointOutT> > pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::ConstPtr

Reimplemented from pcl::FeatureFromNormals< PointInT, PointNT, PointOutT >.

Definition at line 53 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
typedef Feature<PointInT, PointOutT>::PointCloudOut pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::PointCloudOut

Reimplemented from pcl::FeatureFromNormals< PointInT, PointNT, PointOutT >.

Definition at line 60 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
typedef boost::shared_ptr<PFHRGBEstimation<PointInT, PointNT, PointOutT> > pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::Ptr

Reimplemented from pcl::FeatureFromNormals< PointInT, PointNT, PointOutT >.

Definition at line 52 of file pfhrgb.h.


Constructor & Destructor Documentation

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::PFHRGBEstimation ( ) [inline]

Definition at line 63 of file pfhrgb.h.


Member Function Documentation

template<typename PointInT , typename PointNT , typename PointOutT >
void pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::computeFeature ( PointCloudOut output) [protected, virtual]

Abstract feature estimation method.

Parameters:
[out]outputthe resultant features

nr_subdiv^3 for RGB and nr_subdiv^3 for the angular features

Implements pcl::Feature< PointInT, PointOutT >.

Definition at line 143 of file pfhrgb.hpp.

template<typename PointInT , typename PointNT , typename PointOutT >
void pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::computePointPFHRGBSignature ( const pcl::PointCloud< PointInT > &  cloud,
const pcl::PointCloud< PointNT > &  normals,
const std::vector< int > &  indices,
int  nr_split,
Eigen::VectorXf &  pfhrgb_histogram 
)

Definition at line 64 of file pfhrgb.hpp.

template<typename PointInT , typename PointNT , typename PointOutT >
bool pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::computeRGBPairFeatures ( const pcl::PointCloud< PointInT > &  cloud,
const pcl::PointCloud< PointNT > &  normals,
int  p_idx,
int  q_idx,
float &  f1,
float &  f2,
float &  f3,
float &  f4,
float &  f5,
float &  f6,
float &  f7 
)

Definition at line 47 of file pfhrgb.hpp.


Member Data Documentation

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
float pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::d_pi_ [private]

Float constant = 1.0 / (2.0 * M_PI)

Definition at line 96 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
int pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::f_index_[7] [private]

Placeholder for a histogram index.

Definition at line 93 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
int pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::nr_subdiv_ [private]

The number of subdivisions for each angular feature interval.

Definition at line 84 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
Eigen::VectorXf pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::pfhrgb_histogram_ [private]

Placeholder for a point's PFHRGB signature.

Definition at line 87 of file pfhrgb.h.

template<typename PointInT , typename PointNT , typename PointOutT = pcl::PFHRGBSignature250>
Eigen::VectorXf pcl::PFHRGBEstimation< PointInT, PointNT, PointOutT >::pfhrgb_tuple_ [private]

Placeholder for a PFHRGB 7-tuple.

Definition at line 90 of file pfhrgb.h.


The documentation for this class was generated from the following files:


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:43:00