visualization.hpp
Go to the documentation of this file.
1 #ifndef _ASTRA_ROS_VISUALIZATION_HPP_
2 #define _ASTRA_ROS_VISUALIZATION_HPP_
3 
4 #include <std_msgs/ColorRGBA.h>
5 #include <visualization_msgs/MarkerArray.h>
6 #include "astra_ros/Body.h"
7 
8 namespace astra_ros
9 {
10 
11  // visualization_msgs::MarkerArray
12 
13  visualization_msgs::MarkerArray toMarkerArray(const Body &body);
14  visualization_msgs::MarkerArray toMarkerArray(const std::vector<Body> &bodies);
15 }
16 
17 #endif
astra_ros::toMarkerArray
visualization_msgs::MarkerArray toMarkerArray(const Body &body)
astra_ros
Definition: Device.hpp:14


astra_ros
Author(s): Braden McDorman
autogenerated on Wed Mar 2 2022 00:53:06