, including all inherited members.
CloudSurfaceProcessing() | pcl::CloudSurfaceProcessing< PointInT, PointOutT > | [inline] |
compute_normals_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
computeMLSPointNormal(int index, const PointCloudIn &input, const std::vector< int > &nn_indices, std::vector< float > &nn_sqr_dists, PointCloudOut &projected_points, NormalCloud &projected_points_normals) | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
deinitCompute() | pcl::PCLBase< PointInT > | [inline, protected] |
desired_num_points_in_radius_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
dilation_iteration_num_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
fake_indices_ | pcl::PCLBase< PointInT > | [protected] |
getClassName() const | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline, private] |
getDilationIterations() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getDilationVoxelSize() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getIndices() | pcl::PCLBase< PointInT > | [inline] |
getInputCloud() | pcl::PCLBase< PointInT > | [inline] |
getPointDensity() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getPolynomialFit() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getPolynomialOrder() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getSearchMethod() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getSearchRadius() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getSqrGaussParam() const | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getUpsamplingRadius() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
getUpsamplingStepSize() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
indices_ | pcl::PCLBase< PointInT > | [protected] |
initCompute() | pcl::PCLBase< PointInT > | [inline, protected] |
input_ | pcl::PCLBase< PointInT > | [protected] |
KdTree typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
KdTreePtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
mls_results_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
MovingLeastSquares() | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
NONE enum value | pcl::MovingLeastSquares< PointInT, PointOutT > | |
NormalCloud typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
NormalCloudPtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
normals_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
nr_coeff_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
operator[](size_t pos) | pcl::PCLBase< PointInT > | [inline] |
order_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
PCLBase() | pcl::PCLBase< PointInT > | [inline] |
PCLBase(const PCLBase &base) | pcl::PCLBase< PointInT > | [inline] |
performProcessing(PointCloudOut &output) | pcl::MovingLeastSquares< PointInT, PointOutT > | [private, virtual] |
pcl::CloudSurfaceProcessing::performProcessing(pcl::PointCloud< PointOutT > &output)=0 | pcl::CloudSurfaceProcessing< PointInT, PointOutT > | [protected, pure virtual] |
PointCloud typedef | pcl::PCLBase< PointInT > | |
PointCloudConstPtr typedef | pcl::PCLBase< PointInT > | |
PointCloudIn typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudInConstPtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudInPtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudOut typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudOutConstPtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudOutPtr typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
PointCloudPtr typedef | pcl::PCLBase< PointInT > | |
PointIndicesConstPtr typedef | pcl::PCLBase< PointInT > | |
PointIndicesPtr typedef | pcl::PCLBase< PointInT > | |
polynomial_fit_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
process(PointCloudOut &output) | pcl::MovingLeastSquares< PointInT, PointOutT > | |
pcl::CloudSurfaceProcessing::process(pcl::PointCloud< PointOutT > &output) | pcl::CloudSurfaceProcessing< PointInT, PointOutT > | [virtual] |
projectPointToMLSSurface(float &u_disp, float &v_disp, Eigen::Vector3d &u, Eigen::Vector3d &v, Eigen::Vector3d &plane_normal, float &curvature, Eigen::Vector3f &query_point, Eigen::VectorXd &c_vec, int num_neighbors, PointOutT &result_point, pcl::Normal &result_normal) | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
RANDOM_UNIFORM_DENSITY enum value | pcl::MovingLeastSquares< PointInT, PointOutT > | |
rng_uniform_distribution_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
SAMPLE_LOCAL_PLANE enum value | pcl::MovingLeastSquares< PointInT, PointOutT > | |
search_method_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
search_radius_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
searchForNeighbors(int index, std::vector< int > &indices, std::vector< float > &sqr_distances) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline, protected] |
SearchMethod typedef | pcl::MovingLeastSquares< PointInT, PointOutT > | |
setComputeNormals(bool compute_normals) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setDilationIterations(int iterations) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setDilationVoxelSize(float voxel_size) | pcl::MovingLeastSquares< PointInT, 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] |
setPointDensity(int desired_num_points_in_radius) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setPolynomialFit(bool polynomial_fit) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setPolynomialOrder(int order) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setSearchMethod(const KdTreePtr &tree) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setSearchRadius(double radius) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setSqrGaussParam(double sqr_gauss_param) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setUpsamplingMethod(UpsamplingMethod method) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setUpsamplingRadius(double radius) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
setUpsamplingStepSize(double step_size) | pcl::MovingLeastSquares< PointInT, PointOutT > | [inline] |
sqr_gauss_param_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
tree_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
upsample_method_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
upsampling_radius_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
upsampling_step_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
UpsamplingMethod enum name | pcl::MovingLeastSquares< PointInT, PointOutT > | |
use_indices_ | pcl::PCLBase< PointInT > | [protected] |
VOXEL_GRID_DILATION enum value | pcl::MovingLeastSquares< PointInT, PointOutT > | |
voxel_size_ | pcl::MovingLeastSquares< PointInT, PointOutT > | [protected] |
~PCLBase() | pcl::PCLBase< PointInT > | [inline, virtual] |