Struct NavGraphVisualizer::FleetNavGraph
Defined in File NavGraphVisualizer.hpp
Nested Relationships
This struct is a nested type of Class NavGraphVisualizer.
Struct Documentation
-
struct FleetNavGraph
-
Public Functions
-
FleetNavGraph(const std::string &fleet_name, std::weak_ptr<rclcpp::Node> node, Color::ConstSharedPtr color, double lane_width, double waypoint_width, double text_size, double lane_transparency)
-
std::vector<Marker::ConstSharedPtr> update_lane_states(const LaneStates &lane_states, std::optional<std::string> map_name_filter = std::nullopt)
-
void fill_with_markers(const std::string &map_name, MarkerArray &marker_array, const bool delete_markers = false)
Public Members
-
std::string fleet_name
-
std::optional<TrafficGraph> traffic_graph
-
LaneStates::ConstSharedPtr lane_states
-
std::unordered_map<std::string, LaneMarkers> lane_markers
-
LaneMarkers all_lane_markers
-
std::weak_ptr<rclcpp::Node> node
-
double lane_width
-
double waypoint_width
-
double text_size
-
double lane_transparency
-
std::unordered_set<std::size_t> currently_closed_lanes
-
std::unordered_set<std::size_t> currently_speed_limited_lanes
-
FleetNavGraph(const std::string &fleet_name, std::weak_ptr<rclcpp::Node> node, Color::ConstSharedPtr color, double lane_width, double waypoint_width, double text_size, double lane_transparency)