#include <string>
#include <vector>
#include <boost/optional.hpp>
#include <ros/ros.h>
#include <visualization_msgs/Marker.h>
#include <std_msgs/UInt8.h>
#include "psen_scan_v2/ZoneSetConfiguration.h"
Go to the source code of this file.
Classes | |
class | psen_scan_v2::ActiveZonesetNode |
ROS Node that continuously publishes a marker for the active_zoneset. More... | |
Namespaces | |
psen_scan_v2 | |
Root namespace for the ROS part. | |
Variables | |
static const std::string | psen_scan_v2::DEFAULT_ACTIVE_ZONESET_TOPIC = "active_zoneset" |
static const std::string | psen_scan_v2::DEFAULT_ZONECONFIGURATION_TOPIC = "zoneconfiguration" |
static const std::string | psen_scan_v2::DEFAULT_ZONESET_MARKER_ARRAY_TOPIC = "active_zoneset_markers" |