pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > Member List
This is the complete list of members for pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >, including all inherited members.
BaseClass typedefpcl::Keypoint< PointInT, PointOutT >
calculateNormalCovar(const std::vector< int > &neighbors, float *coefficients) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
compute(PointCloudOut &output)pcl::Keypoint< PointInT, PointOutT > [inline]
CURVATURE enum valuepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
deinitCompute()pcl::PCLBase< PointInT > [inline, protected]
detectKeypoints(PointCloudOut &output)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected, virtual]
fake_indices_pcl::PCLBase< PointInT > [protected]
getClassName() const pcl::Keypoint< PointInT, PointOutT > [inline, protected]
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]
HARRIS enum valuepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
HarrisKeypoint3D(ResponseMethod method=HARRIS, float radius=0.01f, float threshold=0.0f)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [inline]
indices_pcl::PCLBase< PointInT > [protected]
initCompute()pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected, virtual]
input_pcl::PCLBase< PointInT > [protected]
k_pcl::Keypoint< PointInT, PointOutT > [protected]
KdTree typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
KdTreePtr typedefpcl::Keypoint< PointInT, PointOutT >
Keypoint()pcl::Keypoint< PointInT, PointOutT > [inline]
LOWE enum valuepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
method_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
name_pcl::Keypoint< PointInT, PointOutT > [protected]
NOBLE enum valuepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
nonmax_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
normals_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
operator[](size_t pos)pcl::PCLBase< PointInT > [inline]
PCLBase()pcl::PCLBase< PointInT > [inline]
PCLBase(const PCLBase &base)pcl::PCLBase< PointInT > [inline]
PointCloud typedefpcl::PCLBase< PointInT >
PointCloudConstPtr typedefpcl::PCLBase< PointInT >
PointCloudIn typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudInConstPtr typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudInPtr typedefpcl::Keypoint< PointInT, PointOutT >
PointCloudN typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudNConstPtr typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudNPtr typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudOut typedefpcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
PointCloudPtr typedefpcl::PCLBase< PointInT >
PointIndicesConstPtr typedefpcl::PCLBase< PointInT >
PointIndicesPtr typedefpcl::PCLBase< PointInT >
refine_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
refineCorners(PointCloudOut &corners) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
responseCurvature(PointCloudOut &output) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
responseHarris(PointCloudOut &output) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
responseLowe(PointCloudOut &output) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
ResponseMethod enum namepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
responseNoble(PointCloudOut &output) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
responseTomasi(PointCloudOut &output) const pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [protected]
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 > [inline]
setIndices(const IndicesConstPtr &indices)pcl::PCLBase< PointInT > [inline]
setIndices(const PointIndicesConstPtr &indices)pcl::PCLBase< PointInT > [inline]
setIndices(size_t row_start, size_t col_start, size_t nb_rows, size_t nb_cols)pcl::PCLBase< PointInT > [inline]
setInputCloud(const PointCloudConstPtr &cloud)pcl::PCLBase< PointInT > [inline, virtual]
setKSearch(int k)pcl::Keypoint< PointInT, PointOutT > [inline]
setMethod(ResponseMethod type)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
setNonMaxSupression(bool=false)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
setNormals(const PointCloudNPtr &normals)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
setNumberOfThreads(int nr_threads)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [inline]
setRadius(float radius)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
setRadiusSearch(double radius)pcl::Keypoint< PointInT, PointOutT > [inline]
setRefine(bool do_refine)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
setSearchMethod(const KdTreePtr &tree)pcl::Keypoint< PointInT, PointOutT > [inline]
setSearchSurface(const PointCloudInConstPtr &cloud)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [inline, virtual]
pcl::Keypoint::setSearchSurface(const PointCloudInConstPtr &cloud)pcl::Keypoint< PointInT, PointOutT > [inline, virtual]
setThreshold(float threshold)pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
surface_pcl::Keypoint< PointInT, PointOutT > [protected]
threads_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
threshold_pcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT > [private]
TOMASI enum valuepcl::HarrisKeypoint3D< PointInT, PointOutT, NormalT >
tree_pcl::Keypoint< PointInT, PointOutT > [protected]
use_indices_pcl::PCLBase< PointInT > [protected]
~PCLBase()pcl::PCLBase< PointInT > [inline, virtual]


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