Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009 #pragma once
00010
00011 #include <grid_map_core/Polygon.hpp>
00012
00013
00014 #include <string>
00015
00016
00017 #include <ros/time.h>
00018 #include <geometry_msgs/PolygonStamped.h>
00019 #include <visualization_msgs/Marker.h>
00020 #include <std_msgs/ColorRGBA.h>
00021
00022 namespace grid_map {
00023
00024 class PolygonRosConverter
00025 {
00026 public:
00027
00031 PolygonRosConverter();
00032
00037 virtual ~PolygonRosConverter();
00038
00044 static void toMessage(const grid_map::Polygon& polygon, geometry_msgs::PolygonStamped& message);
00045
00054 static void toLineMarker(const grid_map::Polygon& polygon, const std_msgs::ColorRGBA& color, const double lineWidth,
00055 const double zCoordinate, visualization_msgs::Marker& marker);
00056
00064 static void toTriangleListMarker(const grid_map::Polygon& polygon, const std_msgs::ColorRGBA& color,
00065 const double zCoordinate, visualization_msgs::Marker& marker);
00066 };
00067
00068 }