Public Types | Public Member Functions | Protected Member Functions | Protected Attributes
pcl::PCLBase< PointT > Class Template Reference

PCL base class. Implements methods that are used by all PCL objects. More...

#include <pcl_base.h>

Inheritance diagram for pcl::PCLBase< PointT >:
Inheritance graph
[legend]

List of all members.

Public Types

typedef pcl::PointCloud< PointTPointCloud
typedef PointCloud::ConstPtr PointCloudConstPtr
typedef PointCloud::Ptr PointCloudPtr
typedef PointIndices::ConstPtr PointIndicesConstPtr
typedef PointIndices::Ptr PointIndicesPtr

Public Member Functions

IndicesPtr const getIndices ()
 Get a pointer to the vector of indices used.
PointCloudConstPtr const getInputCloud ()
 Get a pointer to the input point cloud dataset.
const PointToperator[] (size_t pos)
 Override PointCloud operator[] to shorten code.
 PCLBase ()
 Empty constructor.
 PCLBase (const PCLBase &base)
 Copy constructor.
void setIndices (const IndicesPtr &indices)
 Provide a pointer to the vector of indices that represents the input data.
void setIndices (const IndicesConstPtr &indices)
 Provide a pointer to the vector of indices that represents the input data.
void setIndices (const PointIndicesConstPtr &indices)
 Provide a pointer to the vector of indices that represents the input data.
void setIndices (size_t row_start, size_t col_start, size_t nb_rows, size_t nb_cols)
 Set the indices for the points laying within an interest region of the point cloud.
virtual void setInputCloud (const PointCloudConstPtr &cloud)
 Provide a pointer to the input dataset.
virtual ~PCLBase ()
 destructor.

Protected Member Functions

bool deinitCompute ()
 This method should get called after finishing the actual computation.
bool initCompute ()
 This method should get called before starting the actual computation.

Protected Attributes

bool fake_indices_
 If no set of indices are given, we construct a set of fake indices that mimic the input PointCloud.
IndicesPtr indices_
 A pointer to the vector of point indices to use.
PointCloudConstPtr input_
 The input point cloud dataset.
bool use_indices_
 Set to true if point indices are used.

Detailed Description

template<typename PointT>
class pcl::PCLBase< PointT >

PCL base class. Implements methods that are used by all PCL objects.

Definition at line 71 of file pcl_base.h.


Member Typedef Documentation

template<typename PointT>
typedef pcl::PointCloud<PointT> pcl::PCLBase< PointT >::PointCloud

Reimplemented in pcl::ConditionalRemoval< PointT >, pcl::SACSegmentationFromNormals< PointT, PointNT >, pcl::SACSegmentationFromNormals< PointType, pcl::Normal >, pcl::EuclideanClusterExtraction< PointT >, pcl::EuclideanClusterExtraction< PointType >, pcl::VoxelGrid< PointT >, pcl::VoxelGrid< PointType >, pcl::ApproximateVoxelGrid< PointT >, pcl::ApproximateVoxelGrid< pcl::PointXYZRGBNormal >, pcl::ExtractPolygonalPrismData< PointT >, pcl::ExtractPolygonalPrismData< PointType >, pcl::StatisticalOutlierRemoval< PointT >, pcl::PassThrough< PointT >, pcl::PassThrough< PointInT >, pcl::PassThrough< pcl::PointXYZRGBA >, pcl::PassThrough< PointXYZRGBA >, pcl::PassThrough< PointType >, pcl::Filter< PointT >, pcl::Filter< pcl::PointXYZRGBNormal >, pcl::Filter< PointInT >, pcl::Filter< pcl::PointXYZRGBA >, pcl::Filter< PointXYZRGBA >, pcl::Filter< PointType >, pcl::SegmentDifferences< PointT >, pcl::ProjectInliers< PointT >, pcl::LabeledEuclideanClusterExtraction< PointT >, pcl::ProjectInliers< PointType >, pcl::RadiusOutlierRemoval< PointT >, pcl::SACSegmentation< PointT >, pcl::SACSegmentation< PointType >, pcl::ExtractIndices< PointT >, pcl::ExtractIndices< PointType >, pcl::FilterIndices< PointT >, pcl::FilterIndices< PointInT >, pcl::FilterIndices< pcl::PointXYZRGBA >, pcl::FilterIndices< PointXYZRGBA >, pcl::FilterIndices< PointType >, pcl::registration::ELCH< PointT >, pcl::OrganizedMultiPlaneSegmentation< PointT, PointNT, PointLT >, pcl::OrganizedMultiPlaneSegmentation< PointT, pcl::Normal, pcl::Label >, pcl::OrganizedMultiPlaneSegmentation< PointT, Normal, Label >, pcl::OrganizedConnectedComponentSegmentation< PointT, PointLT >, pcl::PCA< PointT >, pcl::CropBox< PointT >, pcl::RandomSample< PointT >, pcl::NormalSpaceSampling< PointT, NormalT >, pcl::BilateralFilter< PointT >, and pcl::CropHull< PointT >.

Definition at line 74 of file pcl_base.h.

template<typename PointT>
typedef PointCloud::ConstPtr pcl::PCLBase< PointT >::PointCloudConstPtr

Reimplemented in pcl::ConditionalRemoval< PointT >, pcl::SACSegmentationFromNormals< PointT, PointNT >, pcl::SACSegmentationFromNormals< PointType, pcl::Normal >, pcl::EuclideanClusterExtraction< PointT >, pcl::EuclideanClusterExtraction< PointType >, pcl::NormalEstimation< PointInT, PointOutT >, pcl::NormalEstimation< PointInT, pcl::Normal >, pcl::NormalEstimation< PointType, pcl::Normal >, pcl::VoxelGrid< PointT >, pcl::VoxelGrid< PointType >, pcl::ApproximateVoxelGrid< PointT >, pcl::ApproximateVoxelGrid< pcl::PointXYZRGBNormal >, pcl::ExtractPolygonalPrismData< PointT >, pcl::ExtractPolygonalPrismData< PointType >, pcl::StatisticalOutlierRemoval< PointT >, pcl::PassThrough< PointT >, pcl::PassThrough< PointInT >, pcl::PassThrough< pcl::PointXYZRGBA >, pcl::PassThrough< PointXYZRGBA >, pcl::PassThrough< PointType >, pcl::Filter< PointT >, pcl::Filter< pcl::PointXYZRGBNormal >, pcl::Filter< PointInT >, pcl::Filter< pcl::PointXYZRGBA >, pcl::Filter< PointXYZRGBA >, pcl::Filter< PointType >, pcl::SegmentDifferences< PointT >, pcl::ProjectInliers< PointT >, pcl::LabeledEuclideanClusterExtraction< PointT >, pcl::ProjectInliers< PointType >, pcl::RadiusOutlierRemoval< PointT >, pcl::SACSegmentation< PointT >, pcl::SACSegmentation< PointType >, pcl::ExtractIndices< PointT >, pcl::ExtractIndices< PointType >, pcl::registration::ELCH< PointT >, pcl::OrganizedMultiPlaneSegmentation< PointT, PointNT, PointLT >, pcl::OrganizedMultiPlaneSegmentation< PointT, pcl::Normal, pcl::Label >, pcl::OrganizedMultiPlaneSegmentation< PointT, Normal, Label >, pcl::OrganizedConnectedComponentSegmentation< PointT, PointLT >, pcl::PCA< PointT >, pcl::CropBox< PointT >, pcl::RandomSample< PointT >, pcl::NormalSpaceSampling< PointT, NormalT >, and pcl::CropHull< PointT >.

Definition at line 76 of file pcl_base.h.

template<typename PointT>
typedef PointCloud::Ptr pcl::PCLBase< PointT >::PointCloudPtr

Reimplemented in pcl::ConditionalRemoval< PointT >, pcl::MarchingCubes< PointNT >, pcl::SACSegmentationFromNormals< PointT, PointNT >, pcl::SACSegmentationFromNormals< PointType, pcl::Normal >, pcl::EuclideanClusterExtraction< PointT >, pcl::EuclideanClusterExtraction< PointType >, pcl::VoxelGrid< PointT >, pcl::VoxelGrid< PointType >, pcl::ApproximateVoxelGrid< PointT >, pcl::ApproximateVoxelGrid< pcl::PointXYZRGBNormal >, pcl::ExtractPolygonalPrismData< PointT >, pcl::ExtractPolygonalPrismData< PointType >, pcl::StatisticalOutlierRemoval< PointT >, pcl::PassThrough< PointT >, pcl::PassThrough< PointInT >, pcl::PassThrough< pcl::PointXYZRGBA >, pcl::PassThrough< PointXYZRGBA >, pcl::PassThrough< PointType >, pcl::Filter< PointT >, pcl::GridProjection< PointNT >, pcl::Filter< pcl::PointXYZRGBNormal >, pcl::Filter< PointInT >, pcl::Filter< pcl::PointXYZRGBA >, pcl::Filter< PointXYZRGBA >, pcl::Filter< PointType >, pcl::SegmentDifferences< PointT >, pcl::ProjectInliers< PointT >, pcl::LabeledEuclideanClusterExtraction< PointT >, pcl::ProjectInliers< PointType >, pcl::RadiusOutlierRemoval< PointT >, pcl::SACSegmentation< PointT >, pcl::SACSegmentation< PointType >, pcl::ExtractIndices< PointT >, pcl::ExtractIndices< PointType >, pcl::registration::ELCH< PointT >, pcl::OrganizedMultiPlaneSegmentation< PointT, PointNT, PointLT >, pcl::OrganizedMultiPlaneSegmentation< PointT, pcl::Normal, pcl::Label >, pcl::OrganizedMultiPlaneSegmentation< PointT, Normal, Label >, pcl::OrganizedConnectedComponentSegmentation< PointT, PointLT >, pcl::MarchingCubesRBF< PointNT >, pcl::PCA< PointT >, pcl::CropBox< PointT >, pcl::RandomSample< PointT >, pcl::MarchingCubesHoppe< PointNT >, pcl::OrganizedFastMesh< PointInT >, pcl::OrganizedFastMesh< PointType >, pcl::NormalSpaceSampling< PointT, NormalT >, pcl::Poisson< PointNT >, and pcl::CropHull< PointT >.

Definition at line 75 of file pcl_base.h.

template<typename PointT>
typedef PointIndices::ConstPtr pcl::PCLBase< PointT >::PointIndicesConstPtr
template<typename PointT>
typedef PointIndices::Ptr pcl::PCLBase< PointT >::PointIndicesPtr

Constructor & Destructor Documentation

template<typename PointT>
pcl::PCLBase< PointT >::PCLBase ( ) [inline]

Empty constructor.

Definition at line 82 of file pcl_base.h.

template<typename PointT>
pcl::PCLBase< PointT >::PCLBase ( const PCLBase< PointT > &  base) [inline]

Copy constructor.

Definition at line 85 of file pcl_base.h.

template<typename PointT>
virtual pcl::PCLBase< PointT >::~PCLBase ( ) [inline, virtual]

destructor.

Definition at line 93 of file pcl_base.h.


Member Function Documentation

template<typename PointT>
bool pcl::PCLBase< PointT >::deinitCompute ( ) [inline, protected]
template<typename PointT>
IndicesPtr const pcl::PCLBase< PointT >::getIndices ( ) [inline]

Get a pointer to the vector of indices used.

Definition at line 190 of file pcl_base.h.

template<typename PointT>
PointCloudConstPtr const pcl::PCLBase< PointT >::getInputCloud ( ) [inline]

Get a pointer to the input point cloud dataset.

Definition at line 107 of file pcl_base.h.

template<typename PointT>
bool pcl::PCLBase< PointT >::initCompute ( ) [inline, protected]

This method should get called before starting the actual computation.

Internally, initCompute() does the following:

  • checks if an input dataset is given, and returns false otherwise
  • checks whether a set of input indices has been given. Returns true if yes.
  • if no input indices have been given, a fake set is created, which will be used until:
    • either a new set is given via setIndices(), or
    • a new cloud is given that has a different set of points. This will trigger an update on the set of fake indices

Reimplemented in pcl::FeatureFromLabels< PointInT, PointLT, PointOutT >, pcl::IntegralImageNormalEstimation< PointInT, PointOutT >, pcl::IntegralImageNormalEstimation< pcl::PointXYZRGB, pcl::PointXYZRGBNormal >, pcl::IntegralImageNormalEstimation< PointType, pcl::Normal >, pcl::IntegralImageNormalEstimation< PointT, Normal >, pcl::IntegralImageNormalEstimation< PointT, pcl::Normal >, pcl::FeatureFromNormals< PointInT, PointNT, PointOutT >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::FPFHSignature33 >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::SHOT1344 >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::IntensityGradient >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::SHOT >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::PPFSignature >, pcl::FeatureFromNormals< PointType, pcl::Normal, pcl::FPFHSignature33 >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::SHOT352 >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::Boundary >, pcl::FeatureFromNormals< PointT, PointNT, PointFeature >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::PrincipalCurvatures >, pcl::FeatureFromNormals< pcl::PointXYZRGBNormal, pcl::PointXYZRGBNormal, pcl::Boundary >, pcl::FeatureFromNormals< PointInT, PointNT, pcl::PFHSignature125 >, pcl::tracking::ParticleFilterTracker< PointInT, StateT >, pcl::Feature< PointInT, PointOutT >, pcl::Feature< PointInT, pcl::Normal >, pcl::Feature< PointT, PointFeature >, pcl::Feature< PointInT, pcl::FPFHSignature33 >, pcl::Feature< PointInT, pcl::PPFSignature >, pcl::Feature< PointInT, pcl::MomentInvariants >, pcl::Feature< PointInT, pcl::PrincipalCurvatures >, pcl::Feature< pcl::PointXYZRGB, pcl::PointXYZRGBNormal >, pcl::Feature< pcl::PointXYZRGB, FeatureType >, pcl::Feature< PointInT, pcl::Histogram< 20 > >, pcl::Feature< PointType, pcl::Normal >, pcl::Feature< PointInT, pcl::PFHSignature125 >, pcl::Feature< PointSource, PointFeature >, pcl::Feature< PointT, Normal >, pcl::Feature< PointWithRange, BorderDescription >, pcl::Feature< PointT, pcl::Normal >, pcl::Feature< PointInT, pcl::Histogram< 32 > >, pcl::Feature< PointType, pcl::FPFHSignature33 >, pcl::Feature< PointWithRange, Narf36 >, pcl::Feature< PointInT, pcl::SHOT1344 >, pcl::Feature< PointInT, pcl::Histogram< 153 > >, pcl::Feature< pcl::PointXYZRGBNormal, pcl::Boundary >, pcl::Feature< PointInT, pcl::Boundary >, pcl::Feature< PointInT, pcl::SHOT352 >, pcl::Feature< PointInT, pcl::SHOT >, pcl::Feature< PointInT, pcl::IntensityGradient >, pcl::SpinImageEstimation< PointInT, PointNT, PointOutT >, pcl::SpinImageEstimation< PointInT, PointNT, pcl::Histogram< 153 > >, pcl::PCA< PointT >, pcl::VFHEstimation< PointInT, PointNT, PointOutT >, pcl::registration::ELCH< PointT >, pcl::tracking::KLDAdaptiveParticleFilterTracker< PointInT, StateT >, pcl::SHOTColorEstimationOMP< PointInT, PointNT, PointOutT, PointRFT >, pcl::ShapeContext3DEstimation< PointInT, PointNT, PointOutT >, pcl::ShapeContext3DEstimation< PointInT, PointNT, pcl::SHOT >, pcl::UniqueShapeContext< PointInT, PointOutT, PointRFT >, pcl::UniqueShapeContext< PointInT, pcl::SHOT, PointRFT >, pcl::Keypoint< PointInT, PointOutT >, pcl::Keypoint< PointWithRange, int >, pcl::Keypoint< PointInT, int >, pcl::Keypoint< pcl::PointXYZRGBA, int >, pcl::Keypoint< PointT, PointT >, pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >, pcl::MultiscaleFeaturePersistence< PointSource, PointFeature >, pcl::MultiscaleFeaturePersistence< PointType, pcl::FPFHSignature33 >, pcl::SIFTKeypoint< PointInT, PointOutT >, pcl::SHOTEstimationOMP< PointInT, PointNT, PointOutT, PointRFT >, pcl::SHOTEstimationBase< PointInT, PointNT, PointOutT, PointRFT >, pcl::SHOTEstimationBase< PointInT, PointNT, pcl::SHOT1344, PointRFT >, pcl::SHOTEstimationBase< PointInT, PointNT, pcl::SHOT352, PointRFT >, pcl::SmoothedSurfacesKeypoint< PointT, PointNT >, pcl::StatisticalMultiscaleInterestRegionExtraction< PointT >, pcl::tracking::Tracker< PointInT, StateT >, and pcl::SurfelSmoothing< PointT, PointNT >.

Definition at line 225 of file pcl_base.h.

template<typename PointT>
const PointT& pcl::PCLBase< PointT >::operator[] ( size_t  pos) [inline]

Override PointCloud operator[] to shorten code.

Note:
this method can be called instead of (*input_)[(*indices_)[pos]] or input_->points[(*indices_)[pos]]
Parameters:
posposition in indices_ vector

Definition at line 197 of file pcl_base.h.

template<typename PointT>
void pcl::PCLBase< PointT >::setIndices ( const IndicesPtr indices) [inline]

Provide a pointer to the vector of indices that represents the input data.

Parameters:
indicesa pointer to the vector of indices that represents the input data.

Definition at line 113 of file pcl_base.h.

template<typename PointT>
void pcl::PCLBase< PointT >::setIndices ( const IndicesConstPtr indices) [inline]

Provide a pointer to the vector of indices that represents the input data.

Parameters:
indicesa pointer to the vector of indices that represents the input data.

Definition at line 124 of file pcl_base.h.

template<typename PointT>
void pcl::PCLBase< PointT >::setIndices ( const PointIndicesConstPtr indices) [inline]

Provide a pointer to the vector of indices that represents the input data.

Parameters:
indicesa pointer to the vector of indices that represents the input data.

Definition at line 135 of file pcl_base.h.

template<typename PointT>
void pcl::PCLBase< PointT >::setIndices ( size_t  row_start,
size_t  col_start,
size_t  nb_rows,
size_t  nb_cols 
) [inline]

Set the indices for the points laying within an interest region of the point cloud.

Note:
you shouldn't call this method on unorganized point clouds!
Parameters:
row_startthe offset on rows
col_startthe offset on columns
nb_rowsthe number of rows to be considered row_start included
nb_colsthe number of columns to be considered col_start included

Definition at line 151 of file pcl_base.h.

template<typename PointT>
virtual void pcl::PCLBase< PointT >::setInputCloud ( const PointCloudConstPtr cloud) [inline, virtual]

Provide a pointer to the input dataset.

Parameters:
cloudthe const boost shared pointer to a PointCloud message

Reimplemented in pcl::PCA< PointT >.

Definition at line 103 of file pcl_base.h.


Member Data Documentation

template<typename PointT>
bool pcl::PCLBase< PointT >::fake_indices_ [protected]

If no set of indices are given, we construct a set of fake indices that mimic the input PointCloud.

Definition at line 213 of file pcl_base.h.

template<typename PointT>
IndicesPtr pcl::PCLBase< PointT >::indices_ [protected]

A pointer to the vector of point indices to use.

Definition at line 207 of file pcl_base.h.

template<typename PointT>
PointCloudConstPtr pcl::PCLBase< PointT >::input_ [protected]

The input point cloud dataset.

Definition at line 204 of file pcl_base.h.

template<typename PointT>
bool pcl::PCLBase< PointT >::use_indices_ [protected]

Set to true if point indices are used.

Definition at line 210 of file pcl_base.h.


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


pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:19:48