29 #ifndef SEGMENT_TO_GRAPH_NODE_H 30 #define SEGMENT_TO_GRAPH_NODE_H 34 #include <tuw_multi_robot_msgs/Vertex.h> 35 #include <tuw_multi_robot_msgs/Graph.h> 36 #include <geometry_msgs/Point.h> 38 #include <eigen3/Eigen/Dense> 47 PathSeg(Eigen::Vector2d _s, Eigen::Vector2d _e,
double _w) : start(_s), end(_e), width(_w) { }
57 std::unique_ptr<ros::Rate>
rate_;
71 std::vector<int32_t> findNeighbors(std::vector<PathSeg> &_graph, Eigen::Vector2d _point, uint32_t _segment);
74 #endif // PLANNER_NODE_H
PathSeg(Eigen::Vector2d _s, Eigen::Vector2d _e, double _w)
ros::Publisher pubSegments_
std::string segment_file_
tuw_multi_robot_msgs::Graph current_graph_
ros::NodeHandle n_param_
Node handler to the current node.
ros::NodeHandle n_
Node handler to the root node.
std::unique_ptr< ros::Rate > rate_
std::string segment_topic_