#include <boost/lexical_cast.hpp>#include "cylindrical_shell.h"#include <geometry_msgs/PoseStamped.h>#include <pcl_ros/point_cloud.h>#include <tf/transform_datatypes.h>#include <visualization_msgs/MarkerArray.h>#include <vector>

Go to the source code of this file.
Classes | |
| class | Visualizer |
| Visualizer creates ROS messages to visualize the results of the localization in RViz. The possible objects that can be visualized are: neighborhoods, cylindrical shells, and handles. More... | |
Typedefs | |
| typedef visualization_msgs::MarkerArray | MarkerArray |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
Definition at line 44 of file visualizer.h.
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
Definition at line 43 of file visualizer.h.