pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > Member List
This is the complete list of members for pcl::BoundaryEstimation< PointInT, PointNT, PointOutT >, including all inherited members.
angle_threshold_pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [protected]
BaseClass typedefpcl::Feature< PointInT, PointOutT >
BoundaryEstimation()pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [inline]
compute(PointCloudOut &output)pcl::Feature< PointInT, PointOutT >
computeEigen(pcl::PointCloud< Eigen::MatrixXf > &output)pcl::Feature< PointInT, PointOutT >
computeFeature(PointCloudOut &output)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [protected, virtual]
computeFeatureEigen(pcl::PointCloud< Eigen::MatrixXf > &)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [inline, private, virtual]
ConstPtr typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
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]
getAngleThreshold()pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [inline]
getClassName() const pcl::Feature< PointInT, PointOutT > [inline, protected]
getCoordinateSystemOnPlane(const PointNT &p_coeff, Eigen::Vector4f &u, Eigen::Vector4f &v)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [inline]
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]
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]
indices_pcl::PCLBase< PointInT > [protected]
initCompute()pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [protected, virtual]
input_pcl::PCLBase< PointInT > [protected]
isBoundaryPoint(const pcl::PointCloud< PointInT > &cloud, int q_idx, const std::vector< int > &indices, const Eigen::Vector4f &u, const Eigen::Vector4f &v, const float angle_threshold)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT >
isBoundaryPoint(const pcl::PointCloud< PointInT > &cloud, const PointInT &q_point, const std::vector< int > &indices, const Eigen::Vector4f &u, const Eigen::Vector4f &v, const float angle_threshold)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT >
k_pcl::Feature< PointInT, PointOutT > [protected]
KdTree typedefpcl::Feature< PointInT, PointOutT >
KdTreePtr typedefpcl::Feature< PointInT, PointOutT >
normals_pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [protected]
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 >
PointCloudN typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudNConstPtr typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudNPtr typedefpcl::FeatureFromNormals< PointInT, PointNT, PointOutT >
PointCloudOut typedefpcl::BoundaryEstimation< PointInT, PointNT, PointOutT >
PointCloudPtr typedefpcl::PCLBase< PointInT >
PointIndicesConstPtr typedefpcl::PCLBase< PointInT >
PointIndicesPtr typedefpcl::PCLBase< PointInT >
Ptr typedefpcl::FeatureFromNormals< 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 >
setAngleThreshold(float angle)pcl::BoundaryEstimation< PointInT, PointNT, PointOutT > [inline]
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]
setInputNormals(const PointCloudNConstPtr &normals)pcl::FeatureFromNormals< PointInT, PointNT, PointOutT > [inline]
setKSearch(int k)pcl::Feature< PointInT, 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]
~PCLBase()pcl::PCLBase< PointInT > [inline, virtual]


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