Public Member Functions | |
| void | cancelCallback (SnapshotActionServer::GoalHandle gh) |
| void | goalCallback (SnapshotActionServer::GoalHandle gh) |
| void | scanCallback (const sensor_msgs::LaserScanConstPtr &scan) |
| Snapshotter () | |
| void | startScan (double move_to_start_wait_time=1.0) |
Private Attributes | |
| SnapshotActionServer | as_ |
| SnapshotActionServer::GoalHandle | current_gh_ |
| std::string | fixed_frame_ |
| GetSnapshotGoal | goal_ |
| ros::Time | interval_end_ |
| ros::Time | interval_start_ |
| ros::ServiceClient | laser_controller_sc_ |
| laser_geometry::LaserProjection | lg_ |
| ros::NodeHandle | nh_ |
| message_filters::Subscriber< sensor_msgs::LaserScan > | scan_sub_ |
| GetSnapshotFeedback | snapshot_feedback_ |
| GetSnapshotResult | snapshot_result_ |
| SnapshotState | state_ |
| boost::mutex | state_mutex_ |
| tf::TransformListener | tf_ |
| boost::scoped_ptr< tf::MessageFilter< sensor_msgs::LaserScan > > | tf_filter_ |
Definition at line 91 of file snapshotter_action.cpp.
| Snapshotter::Snapshotter | ( | ) |
Definition at line 128 of file snapshotter_action.cpp.
| void Snapshotter::cancelCallback | ( | SnapshotActionServer::GoalHandle | gh | ) |
Definition at line 288 of file snapshotter_action.cpp.
| void Snapshotter::goalCallback | ( | SnapshotActionServer::GoalHandle | gh | ) |
Definition at line 218 of file snapshotter_action.cpp.
| void Snapshotter::scanCallback | ( | const sensor_msgs::LaserScanConstPtr & | scan | ) |
Definition at line 156 of file snapshotter_action.cpp.
| void Snapshotter::startScan | ( | double | move_to_start_wait_time = 1.0 | ) |
Definition at line 237 of file snapshotter_action.cpp.
|
private |
Definition at line 106 of file snapshotter_action.cpp.
|
private |
Definition at line 119 of file snapshotter_action.cpp.
|
private |
Definition at line 123 of file snapshotter_action.cpp.
|
private |
Definition at line 120 of file snapshotter_action.cpp.
|
private |
Definition at line 114 of file snapshotter_action.cpp.
|
private |
Definition at line 113 of file snapshotter_action.cpp.
|
private |
Definition at line 109 of file snapshotter_action.cpp.
|
private |
Definition at line 115 of file snapshotter_action.cpp.
|
private |
Definition at line 105 of file snapshotter_action.cpp.
|
private |
Definition at line 108 of file snapshotter_action.cpp.
|
private |
Definition at line 117 of file snapshotter_action.cpp.
|
private |
Definition at line 116 of file snapshotter_action.cpp.
|
private |
Definition at line 112 of file snapshotter_action.cpp.
|
private |
Definition at line 111 of file snapshotter_action.cpp.
|
private |
Definition at line 122 of file snapshotter_action.cpp.
|
private |
Definition at line 124 of file snapshotter_action.cpp.