Public Member Functions | |
| RecorderNode () | |
| void | spin () |
| ~RecorderNode () | |
Private Member Functions | |
| bool | clearPath (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
Private Attributes | |
| double | ang_interval_ |
| double | dist_interval_ |
| std::string | frame_global_ |
| std::string | frame_robot_ |
| ros::NodeHandle | nh_ |
| nav_msgs::Path | path_ |
| ros::NodeHandle | pnh_ |
| ros::Publisher | pub_path_ |
| ros::ServiceServer | srs_clear_path_ |
| bool | store_time_ |
| tf2_ros::Buffer | tfbuf_ |
| tf2_ros::TransformListener | tfl_ |
| std::string | topic_path_ |
Definition at line 51 of file trajectory_recorder.cpp.
| RecorderNode::RecorderNode | ( | ) |
Definition at line 79 of file trajectory_recorder.cpp.
| RecorderNode::~RecorderNode | ( | ) |
Definition at line 98 of file trajectory_recorder.cpp.
|
private |
Definition at line 107 of file trajectory_recorder.cpp.
| void RecorderNode::spin | ( | ) |
Definition at line 114 of file trajectory_recorder.cpp.
|
private |
Definition at line 66 of file trajectory_recorder.cpp.
|
private |
Definition at line 65 of file trajectory_recorder.cpp.
|
private |
Definition at line 64 of file trajectory_recorder.cpp.
|
private |
Definition at line 63 of file trajectory_recorder.cpp.
|
private |
Definition at line 69 of file trajectory_recorder.cpp.
|
private |
Definition at line 76 of file trajectory_recorder.cpp.
|
private |
Definition at line 70 of file trajectory_recorder.cpp.
|
private |
Definition at line 71 of file trajectory_recorder.cpp.
|
private |
Definition at line 74 of file trajectory_recorder.cpp.
|
private |
Definition at line 67 of file trajectory_recorder.cpp.
|
private |
Definition at line 72 of file trajectory_recorder.cpp.
|
private |
Definition at line 73 of file trajectory_recorder.cpp.
|
private |
Definition at line 62 of file trajectory_recorder.cpp.