The main segmentation node object. More...
#include "SegmentationZone.h"
#include <pcl_ros/point_cloud.h>
#include <rail_manipulation_msgs/SegmentedObjectList.h>
#include <rail_segmentation/RemoveObject.h>
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/PointCloud2.h>
#include <std_srvs/Empty.h>
#include <tf/transform_listener.h>
#include <tf2_ros/transform_listener.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <pcl/filters/conditional_removal.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <boost/thread/mutex.hpp>
#include <string>
Go to the source code of this file.
Classes | |
class | rail::segmentation::Segmenter |
The main grasp collector node object. More... | |
Namespaces | |
namespace | rail |
namespace | rail::segmentation |
The main segmentation node object.
The segmenter is responsible for segmenting clusters from a point cloud topic. Visualization and data latched topics are published after each request. A persistent array of objects is maintained internally.
Definition in file Segmenter.h.