Public Member Functions | |
void | goalCallback () |
void | imageCallback (const sensor_msgs::ImageConstPtr &image) |
ImageCbDetectorAction () | |
void | preemptCallback () |
Private Attributes | |
actionlib::SimpleActionServer < image_cb_detector::ConfigAction > | as_ |
ImageCbDetector | detector_ |
image_transport::ImageTransport | it_ |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
boost::mutex | run_mutex_ |
image_transport::Subscriber | sub_ |
Definition at line 49 of file image_cb_detector_action.cpp.
ImageCbDetectorAction::ImageCbDetectorAction | ( | ) | [inline] |
Definition at line 52 of file image_cb_detector_action.cpp.
void ImageCbDetectorAction::goalCallback | ( | ) | [inline] |
Definition at line 62 of file image_cb_detector_action.cpp.
void ImageCbDetectorAction::imageCallback | ( | const sensor_msgs::ImageConstPtr & | image | ) | [inline] |
Definition at line 90 of file image_cb_detector_action.cpp.
void ImageCbDetectorAction::preemptCallback | ( | ) | [inline] |
Definition at line 82 of file image_cb_detector_action.cpp.
actionlib::SimpleActionServer<image_cb_detector::ConfigAction> ImageCbDetectorAction::as_ [private] |
Definition at line 113 of file image_cb_detector_action.cpp.
Definition at line 114 of file image_cb_detector_action.cpp.
Definition at line 117 of file image_cb_detector_action.cpp.
ros::NodeHandle ImageCbDetectorAction::nh_ [private] |
Definition at line 112 of file image_cb_detector_action.cpp.
ros::Publisher ImageCbDetectorAction::pub_ [private] |
Definition at line 116 of file image_cb_detector_action.cpp.
boost::mutex ImageCbDetectorAction::run_mutex_ [private] |
Definition at line 111 of file image_cb_detector_action.cpp.
Definition at line 118 of file image_cb_detector_action.cpp.