38 #ifndef PCL_ROS_EXTRACT_POLYGONAL_PRISM_DATA_H_ 39 #define PCL_ROS_EXTRACT_POLYGONAL_PRISM_DATA_H_ 47 #include <pcl/segmentation/extract_polygonal_prism_data.h> 50 #include <dynamic_reconfigure/server.h> 51 #include "pcl_ros/ExtractPolygonalPrismDataConfig.h" 97 nf_.
add (boost::make_shared<PointIndices> (cloud));
111 void config_callback (ExtractPolygonalPrismDataConfig &config, uint32_t level);
119 const PointCloudConstPtr &hull,
124 pcl::ExtractPolygonalPrismData<pcl::PointXYZ>
impl_;
126 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
130 #endif //#ifndef PCL_EXTRACT_POLYGONAL_PRISM_DATA_H_
void fromPCL(const pcl::uint64_t &pcl_stamp, ros::Time &stamp)
PCLNodelet represents the base PCL Nodelet class. All PCL nodelets should inherit from this class...
pcl_msgs::PointIndices PointIndices
void add(const MConstPtr &msg)
PointIndices::ConstPtr PointIndicesConstPtr