Public Member Functions | |
void | goalCallback () |
LaserCbDetectorAction () | |
void | preemptCallback () |
void | snapshotCallback (const calibration_msgs::DenseLaserSnapshotConstPtr &msg) |
Private Attributes | |
actionlib::SimpleActionServer < laser_cb_detector::ConfigAction > | as_ |
LaserCbDetector | detector_ |
ros::Publisher | image_pub_ |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
boost::mutex | run_mutex_ |
ros::Subscriber | sub_ |
Definition at line 121 of file laser_cb_detector_node.cpp.
LaserCbDetectorAction::LaserCbDetectorAction | ( | ) | [inline] |
Definition at line 123 of file laser_cb_detector_node.cpp.
void LaserCbDetectorAction::goalCallback | ( | ) | [inline] |
Definition at line 144 of file laser_cb_detector_node.cpp.
void LaserCbDetectorAction::preemptCallback | ( | ) | [inline] |
Definition at line 160 of file laser_cb_detector_node.cpp.
void LaserCbDetectorAction::snapshotCallback | ( | const calibration_msgs::DenseLaserSnapshotConstPtr & | msg | ) | [inline] |
Definition at line 166 of file laser_cb_detector_node.cpp.
actionlib::SimpleActionServer<laser_cb_detector::ConfigAction> LaserCbDetectorAction::as_ [private] |
Definition at line 199 of file laser_cb_detector_node.cpp.
Definition at line 198 of file laser_cb_detector_node.cpp.
Definition at line 196 of file laser_cb_detector_node.cpp.
ros::NodeHandle LaserCbDetectorAction::nh_ [private] |
Definition at line 194 of file laser_cb_detector_node.cpp.
ros::Publisher LaserCbDetectorAction::pub_ [private] |
Definition at line 195 of file laser_cb_detector_node.cpp.
boost::mutex LaserCbDetectorAction::run_mutex_ [private] |
Definition at line 193 of file laser_cb_detector_node.cpp.
ros::Subscriber LaserCbDetectorAction::sub_ [private] |
Definition at line 197 of file laser_cb_detector_node.cpp.