Function nav2_smac_planner::createMarker
Defined in File utils.hpp
Function Documentation
-
inline visualization_msgs::msg::Marker nav2_smac_planner::createMarker(const std::vector<geometry_msgs::msg::Point> edge, unsigned int i, const std::string &frame_id, const rclcpp::Time ×tamp)
initializes marker to visualize shape of linestring
- Parameters:
edge – edge to mark of footprint
i – marker ID
frame_id – frame of the marker
timestamp – timestamp of the marker
- Returns:
marker populated