#include <intersection_render_object.hpp>
Public Attributes | |
LaneDirection | direction = LaneDirection::unknown_direction |
uint8_t | lane_id |
std::vector< geometry_msgs::msg::Point > | nodes |
std::vector< uint8_t > | signal_group_ids |
LaneType | type = LaneType::unknown_type |
Definition at line 44 of file intersection_render_object.hpp.
LaneDirection etsi_its_msgs::displays::IntersectionLane::direction = LaneDirection::unknown_direction |
Definition at line 47 of file intersection_render_object.hpp.
uint8_t etsi_its_msgs::displays::IntersectionLane::lane_id |
Definition at line 45 of file intersection_render_object.hpp.
std::vector<geometry_msgs::msg::Point> etsi_its_msgs::displays::IntersectionLane::nodes |
Definition at line 48 of file intersection_render_object.hpp.
std::vector<uint8_t> etsi_its_msgs::displays::IntersectionLane::signal_group_ids |
Definition at line 49 of file intersection_render_object.hpp.
LaneType etsi_its_msgs::displays::IntersectionLane::type = LaneType::unknown_type |
Definition at line 46 of file intersection_render_object.hpp.