The object recognition listener node object. More...
#include "rail_recognition/ObjectRecognitionListener.h"
#include "rail_recognition/PointCloudRecognizer.h"
#include <geometry_msgs/PoseArray.h>
#include <pcl/common/centroid.h>
#include <pcl/common/common.h>
#include <rail_recognition/PointCloudMetrics.h>
Go to the source code of this file.
The object recognition listener node object.
The object recognition listener will listen to a specified SegmentedObjectsArray topic and attempt to recognize all segmented objects. The new list are republished on a separate topic.
Definition in file ObjectRecognitionListener.cpp.