The main segmentation node object. More...
#include "rail_segmentation/Segmenter.h"#include <pcl_ros/transforms.h>#include <ros/package.h>#include <sensor_msgs/point_cloud_conversion.h>#include <sensor_msgs/image_encodings.h>#include <tf2/LinearMath/Matrix3x3.h>#include <pcl/common/common.h>#include <pcl/filters/extract_indices.h>#include <pcl/filters/passthrough.h>#include <pcl/filters/project_inliers.h>#include <pcl/filters/voxel_grid.h>#include <pcl/ModelCoefficients.h>#include <pcl/segmentation/sac_segmentation.h>#include <pcl/segmentation/extract_clusters.h>#include <yaml-cpp/yaml.h>#include <fstream>
Go to the source code of this file.
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.cpp.