Public Member Functions | |
void | cameraCallback (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::CameraInfoConstPtr &caminfo_msg) |
void | goalCallback () |
void | preemptCallback () |
RgbdCbDetectorAction (ros::NodeHandle &n) | |
Private Attributes | |
actionlib::SimpleActionServer < image_cb_detector::ConfigAction > | as_ |
message_filters::Subscriber < sensor_msgs::CameraInfo > | caminfo_sub_ |
DepthToPointCloud | cloud_converter_ |
message_filters::Subscriber < sensor_msgs::Image > | depth_sub_ |
image_cb_detector::ImageCbDetector | detector_ |
message_filters::Subscriber < sensor_msgs::Image > | image_sub_ |
bool | last_sample_invalid_ |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
boost::mutex | run_mutex_ |
message_filters::Synchronizer < CameraSyncPolicy > | sync_ |
Definition at line 62 of file rgbd_cb_detector_action.cpp.
RgbdCbDetectorAction::RgbdCbDetectorAction | ( | ros::NodeHandle & | n | ) | [inline] |
Definition at line 65 of file rgbd_cb_detector_action.cpp.
void RgbdCbDetectorAction::cameraCallback | ( | const sensor_msgs::ImageConstPtr & | image_msg, |
const sensor_msgs::ImageConstPtr & | depth_msg, | ||
const sensor_msgs::CameraInfoConstPtr & | caminfo_msg | ||
) | [inline] |
Definition at line 111 of file rgbd_cb_detector_action.cpp.
void RgbdCbDetectorAction::goalCallback | ( | ) | [inline] |
Definition at line 83 of file rgbd_cb_detector_action.cpp.
void RgbdCbDetectorAction::preemptCallback | ( | ) | [inline] |
Definition at line 103 of file rgbd_cb_detector_action.cpp.
actionlib::SimpleActionServer<image_cb_detector::ConfigAction> RgbdCbDetectorAction::as_ [private] |
Definition at line 256 of file rgbd_cb_detector_action.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> RgbdCbDetectorAction::caminfo_sub_ [private] |
Definition at line 261 of file rgbd_cb_detector_action.cpp.
Definition at line 267 of file rgbd_cb_detector_action.cpp.
message_filters::Subscriber<sensor_msgs::Image> RgbdCbDetectorAction::depth_sub_ [private] |
Definition at line 260 of file rgbd_cb_detector_action.cpp.
Definition at line 257 of file rgbd_cb_detector_action.cpp.
message_filters::Subscriber<sensor_msgs::Image> RgbdCbDetectorAction::image_sub_ [private] |
Definition at line 259 of file rgbd_cb_detector_action.cpp.
bool RgbdCbDetectorAction::last_sample_invalid_ [private] |
Definition at line 266 of file rgbd_cb_detector_action.cpp.
ros::NodeHandle RgbdCbDetectorAction::nh_ [private] |
Definition at line 255 of file rgbd_cb_detector_action.cpp.
ros::Publisher RgbdCbDetectorAction::pub_ [private] |
Definition at line 264 of file rgbd_cb_detector_action.cpp.
boost::mutex RgbdCbDetectorAction::run_mutex_ [private] |
Definition at line 254 of file rgbd_cb_detector_action.cpp.
Definition at line 262 of file rgbd_cb_detector_action.cpp.