
Public Member Functions | |
| void | mapMetadataCallback (const nav_msgs::MapMetaDataConstPtr &msg) |
| void | poseCallback (const geometry_msgs::PoseWithCovarianceStampedConstPtr &msg) |
| PoseLabelerWrapper (const std::string &label_map_filename, const std::string &pose_topic) | |
Private Attributes | |
| ros::Publisher | label_pub_ |
| PoseLabel | last_label_ |
| ros::Subscriber | map_meta_sub_ |
| ros::NodeHandle | nh_ |
| ros::Subscriber | pose_sub_ |
| bool | started_ |
Definition at line 46 of file pose_labeler_node.cpp.
| topological_tools::PoseLabelerWrapper::PoseLabelerWrapper | ( | const std::string & | label_map_filename, |
| const std::string & | pose_topic | ||
| ) | [inline] |
Definition at line 49 of file pose_labeler_node.cpp.
| void topological_tools::PoseLabelerWrapper::mapMetadataCallback | ( | const nav_msgs::MapMetaDataConstPtr & | msg | ) | [inline] |
Definition at line 58 of file pose_labeler_node.cpp.
| void topological_tools::PoseLabelerWrapper::poseCallback | ( | const geometry_msgs::PoseWithCovarianceStampedConstPtr & | msg | ) | [inline] |
Definition at line 63 of file pose_labeler_node.cpp.
Definition at line 80 of file pose_labeler_node.cpp.
PoseLabel topological_tools::PoseLabelerWrapper::last_label_ [private] |
Definition at line 81 of file pose_labeler_node.cpp.
Definition at line 77 of file pose_labeler_node.cpp.
Definition at line 75 of file pose_labeler_node.cpp.
Definition at line 78 of file pose_labeler_node.cpp.
bool topological_tools::PoseLabelerWrapper::started_ [private] |
Definition at line 82 of file pose_labeler_node.cpp.