37 #ifndef PCL_ROS_SHOT_OMP_H_ 38 #define PCL_ROS_SHOT_OMP_H_ 40 #include <pcl/features/shot_omp.h> 50 pcl::SHOTEstimationOMP<pcl::PointXYZ, pcl::Normal, pcl::SHOT352>
impl_;
73 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
77 #endif //#ifndef PCL_ROS_SHOT_OMP_H_ SHOTEstimation estimates SHOT descriptor using OpenMP.
bool childInit(ros::NodeHandle &nh)
Child initialization routine. Internal method.
pcl::SHOTEstimationOMP< pcl::PointXYZ, pcl::Normal, pcl::SHOT352 > impl_
void computePublish(const PointCloudInConstPtr &cloud, const PointCloudNConstPtr &normals, const PointCloudInConstPtr &surface, const IndicesPtr &indices)
Compute the feature and publish it.
PointCloudN::ConstPtr PointCloudNConstPtr
void emptyPublish(const PointCloudInConstPtr &cloud)
Publish an empty point cloud of the feature output type.
pcl::PointCloud< pcl::SHOT352 > PointCloudOut
int max_queue_size_
The maximum queue size (default: 3).
ros::Publisher pub_output_
The output PointCloud publisher.
PointCloudIn::ConstPtr PointCloudInConstPtr