#include <iri_clean_board/CleaningPlanConfig.h>
#include "mutex.h"
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <estirabot_msgs/StateRepresentationChanges.h>
#include <estirabot_msgs/PointsDistanceMsg.h>
#include <estirabot_msgs/DirtyArea.h>
#include <estirabot_msgs/Ellipse.h>
#include <estirabot_msgs/TraversedEllipses.h>
#include <iri_perception_msgs/ImagePoint.h>
#include <pcl/point_cloud.h>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <pcl/common/common.h>
#include <tf/transform_datatypes.h>
#include <Eigen/Core>
#include <Eigen/Geometry>
Go to the source code of this file.
Classes | |
class | EllipsesRepresentation |
IRI ROS Specific Driver Class. More... |