$search
#include <ros/ros.h>#include <interactive_markers/interactive_marker_server.h>#include <interactive_markers/menu_handler.h>#include <sensor_msgs/PointCloud2.h>#include <actionlib/client/simple_action_client.h>#include <point_cloud_server/StoreCloudAction.h>#include <pcl/kdtree/kdtree_flann.h>#include <tf/transform_listener.h>#include <object_manipulator/tools/mechanism_interface.h>
Go to the source code of this file.
Classes | |
| class | CloudHandler |
Typedefs | |
| typedef pcl::PointXYZRGB | PointT |
| typedef pcl::PointXYZRGB PointT |
Definition at line 47 of file cloud_handler.h.