pcl::SIFTKeypoint< PointInT, PointOutT > Member List
This is the complete list of members for pcl::SIFTKeypoint< PointInT, PointOutT >, including all inherited members.
BaseClass typedefpcl::Keypoint< PointInT, PointOutT >
compute(PointCloudOut &output)pcl::Keypoint< PointInT, PointOutT > [inline]
computeScaleSpace(const PointCloudIn &input, KdTree &tree, const std::vector< float > &scales, Eigen::MatrixXf &diff_of_gauss)pcl::SIFTKeypoint< PointInT, PointOutT > [private]
ConstPtr typedefpcl::SIFTKeypoint< PointInT, PointOutT >
deinitCompute()pcl::PCLBase< PointInT > [protected]
detectKeypoints(PointCloudOut &output)pcl::SIFTKeypoint< PointInT, PointOutT > [protected, virtual]
detectKeypointsForOctave(const PointCloudIn &input, KdTree &tree, float base_scale, int nr_scales_per_octave, PointCloudOut &output)pcl::SIFTKeypoint< PointInT, PointOutT > [private]
fake_indices_pcl::PCLBase< PointInT > [protected]
findScaleSpaceExtrema(const PointCloudIn &input, KdTree &tree, const Eigen::MatrixXf &diff_of_gauss, std::vector< int > &extrema_indices, std::vector< int > &extrema_scales)pcl::SIFTKeypoint< PointInT, PointOutT > [private]
getClassName() const pcl::Keypoint< PointInT, PointOutT > [inline, protected]
getFieldValue_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
getIndices()pcl::PCLBase< PointInT > [inline]
getInputCloud()pcl::PCLBase< PointInT > [inline]
getKSearch()pcl::Keypoint< PointInT, PointOutT > [inline]
getRadiusSearch()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchMethod()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchParameter()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchSurface()pcl::Keypoint< PointInT, PointOutT > [inline]
indices_pcl::PCLBase< PointInT > [protected]
initCompute()pcl::SIFTKeypoint< PointInT, PointOutT > [protected, virtual]
input_pcl::PCLBase< PointInT > [protected]
k_pcl::Keypoint< PointInT, PointOutT > [protected]
KdTree typedefpcl::SIFTKeypoint< PointInT, PointOutT >
KdTreePtr typedefpcl::Keypoint< PointInT, PointOutT >
Keypoint()pcl::Keypoint< PointInT, PointOutT > [inline]
min_contrast_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
min_scale_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
name_pcl::Keypoint< PointInT, PointOutT > [protected]
nr_octaves_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
nr_scales_per_octave_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
operator[](size_t pos)pcl::PCLBase< PointInT > [inline]
out_fields_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
PCLBase()pcl::PCLBase< PointInT >
PCLBase(const PCLBase &base)pcl::PCLBase< PointInT >
PointCloud typedefpcl::PCLBase< PointInT >
PointCloudConstPtr typedefpcl::PCLBase< PointInT >
PointCloudIn typedefpcl::SIFTKeypoint< PointInT, PointOutT >
PointCloudInConstPtr typedefpcl::Keypoint< PointInT, PointOutT >
PointCloudInPtr typedefpcl::Keypoint< PointInT, PointOutT >
PointCloudOut typedefpcl::SIFTKeypoint< PointInT, PointOutT >
PointCloudPtr typedefpcl::PCLBase< PointInT >
PointIndicesConstPtr typedefpcl::PCLBase< PointInT >
PointIndicesPtr typedefpcl::PCLBase< PointInT >
Ptr typedefpcl::SIFTKeypoint< PointInT, PointOutT >
scale_idx_pcl::SIFTKeypoint< PointInT, PointOutT > [private]
search_method_pcl::Keypoint< PointInT, PointOutT > [protected]
search_method_surface_pcl::Keypoint< PointInT, PointOutT > [protected]
search_parameter_pcl::Keypoint< PointInT, PointOutT > [protected]
search_radius_pcl::Keypoint< PointInT, PointOutT > [protected]
searchForNeighbors(int index, double parameter, std::vector< int > &indices, std::vector< float > &distances) const pcl::Keypoint< PointInT, PointOutT > [inline]
SearchMethod typedefpcl::Keypoint< PointInT, PointOutT >
SearchMethodSurface typedefpcl::Keypoint< 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]
setKSearch(int k)pcl::Keypoint< PointInT, PointOutT > [inline]
setMinimumContrast(float min_contrast)pcl::SIFTKeypoint< PointInT, PointOutT >
setRadiusSearch(double radius)pcl::Keypoint< PointInT, PointOutT > [inline]
setScales(float min_scale, int nr_octaves, int nr_scales_per_octave)pcl::SIFTKeypoint< PointInT, PointOutT >
setSearchMethod(const KdTreePtr &tree)pcl::Keypoint< PointInT, PointOutT > [inline]
setSearchSurface(const PointCloudInConstPtr &cloud)pcl::Keypoint< PointInT, PointOutT > [inline, virtual]
SIFTKeypoint()pcl::SIFTKeypoint< PointInT, PointOutT > [inline]
surface_pcl::Keypoint< PointInT, PointOutT > [protected]
tree_pcl::Keypoint< PointInT, PointOutT > [protected]
use_indices_pcl::PCLBase< PointInT > [protected]
~Keypoint()pcl::Keypoint< PointInT, PointOutT > [inline, virtual]
~PCLBase()pcl::PCLBase< PointInT > [inline, virtual]


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