#include <segment_to_graph_node.h>
Public Member Functions | |
void | Publish () |
SegmentToGraphNode (ros::NodeHandle &n) | |
Public Attributes | |
ros::NodeHandle | n_ |
Node handler to the root node. More... | |
ros::NodeHandle | n_param_ |
Node handler to the current node. More... | |
std::unique_ptr< ros::Rate > | rate_ |
Private Member Functions | |
std::vector< int32_t > | findNeighbors (std::vector< PathSeg > &_graph, Eigen::Vector2d _point, uint32_t _segment) |
void | readSegments () |
Private Attributes | |
tuw_multi_robot_msgs::Graph | current_graph_ |
double | path_length_ |
ros::Publisher | pubSegments_ |
std::string | segment_file_ |
std::string | segment_topic_ |
Definition at line 50 of file segment_to_graph_node.h.
tuw_graph::SegmentToGraphNode::SegmentToGraphNode | ( | ros::NodeHandle & | n | ) |
Definition at line 57 of file segment_to_graph_node.cpp.
|
private |
Definition at line 151 of file segment_to_graph_node.cpp.
void tuw_graph::SegmentToGraphNode::Publish | ( | ) |
Definition at line 74 of file segment_to_graph_node.cpp.
|
private |
Definition at line 79 of file segment_to_graph_node.cpp.
|
private |
Definition at line 68 of file segment_to_graph_node.h.
ros::NodeHandle tuw_graph::SegmentToGraphNode::n_ |
Node handler to the root node.
Definition at line 55 of file segment_to_graph_node.h.
ros::NodeHandle tuw_graph::SegmentToGraphNode::n_param_ |
Node handler to the current node.
Definition at line 56 of file segment_to_graph_node.h.
|
private |
Definition at line 66 of file segment_to_graph_node.h.
|
private |
Definition at line 61 of file segment_to_graph_node.h.
std::unique_ptr<ros::Rate> tuw_graph::SegmentToGraphNode::rate_ |
Definition at line 57 of file segment_to_graph_node.h.
|
private |
Definition at line 64 of file segment_to_graph_node.h.
|
private |
Definition at line 65 of file segment_to_graph_node.h.