#include <string>
#include <vector>
#include <fmt/format.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Point32.h>
#include <std_msgs/ColorRGBA.h>
#include <visualization_msgs/Marker.h>
#include "psen_scan_v2/ZoneSet.h"
Go to the source code of this file.
|  | 
| #define | TO_MARKER(zoneset_obj,  polygon_type,  polygon_index,  tf_frame) | 
|  | 
◆ TO_MARKER
      
        
          | #define TO_MARKER | ( |  | zoneset_obj, | 
        
          |  |  |  | polygon_type, | 
        
          |  |  |  | polygon_index, | 
        
          |  |  |  | tf_frame | 
        
          |  | ) |  |  | 
      
 
Value:
               createRGBA(strcmp(#polygon_type, 
"muting") != 0,                                                        \
 
                          strcmp(#polygon_type, "warn") == 0,                                                          \
                          strcmp(#polygon_type, "muting") == 0,                                                        \
                          1),                                                                                          \
               tf_frame,                                                                                               \
               zoneset_obj.polygon_type##polygon_index.points,                                                         \
               0.01 * (strcmp(#polygon_type, "warn") == 0) + 0.02 * (strcmp(#polygon_type, "muting") == 0))
 
Definition at line 31 of file zoneset_to_marker_conversion.h.
 
 
 
visualization_msgs::Marker createMarker(const std::string &ns, const std_msgs::ColorRGBA &color, const std::string &frame_id, const std::vector< geometry_msgs::Point32 > &points, const double &z_offset=0)