pcl_ros::NormalEstimationOMP Class Reference

NormalEstimationOMP estimates local surface properties at each 3D point, such as surface normals and curvatures, in parallel, using the OpenMP standard. More...

#include <normal_3d_omp.h>

Inheritance diagram for pcl_ros::NormalEstimationOMP:
Inheritance graph
[legend]

List of all members.

Private Types

typedef pcl::PointCloud
< pcl::Normal > 
PointCloudOut

Private Member Functions

bool childInit (ros::NodeHandle &nh)
 Child initialization routine. Internal method.
void computePublish (const PointCloudInConstPtr &cloud, const PointCloudInConstPtr &surface, const IndicesConstPtr &indices)
 Compute the feature and publish it.
void emptyPublish (const PointCloudInConstPtr &cloud)
 Publish an empty point cloud of the feature output type.

Private Attributes

pcl::NormalEstimationOMP
< pcl::PointXYZ, pcl::Normal > 
impl_

Detailed Description

NormalEstimationOMP estimates local surface properties at each 3D point, such as surface normals and curvatures, in parallel, using the OpenMP standard.

Author:
Radu Bogdan Rusu

Definition at line 48 of file normal_3d_omp.h.


Member Typedef Documentation

Definition at line 47 of file normal_3d_omp.h.


Member Function Documentation

bool pcl_ros::NormalEstimationOMP::childInit ( ros::NodeHandle &  nh  )  [inline, private, virtual]

Child initialization routine. Internal method.

Implements pcl_ros::Feature.

Definition at line 51 of file normal_3d_omp.h.

void pcl_ros::NormalEstimationOMP::computePublish ( const PointCloudInConstPtr cloud,
const PointCloudInConstPtr surface,
const IndicesConstPtr indices 
) [private, virtual]

Compute the feature and publish it.

Implements pcl_ros::Feature.

Definition at line 50 of file normal_3d_omp.cpp.

void pcl_ros::NormalEstimationOMP::emptyPublish ( const PointCloudInConstPtr cloud  )  [private, virtual]

Publish an empty point cloud of the feature output type.

Implements pcl_ros::Feature.

Definition at line 42 of file normal_3d_omp.cpp.


Member Data Documentation

pcl::NormalEstimationOMP<pcl::PointXYZ, pcl::Normal> pcl_ros::NormalEstimationOMP::impl_ [private]

Definition at line 45 of file normal_3d_omp.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Friends


pcl_ros
Author(s): Maintained by Radu Bogdan Rusu
autogenerated on Fri Jan 11 09:15:54 2013