Go to the documentation of this file.
22 #include "sensor_msgs/PointCloud2.h"
23 #include <sensor_msgs/Image.h>
24 #include <sensor_msgs/CameraInfo.h>
97 void callback(
const tPointCloud::ConstPtr& rgb_cloud,
98 const tImage::ConstPtr& rgb_image,
99 const tCameraInfo::ConstPtr& rgb_caminfo
message_filters::Subscriber< tCameraInfo > rgb_caminfo_sub_
ros::NodeHandle & getNodeHandle() const
message_filters::Subscriber< tImage > depth_image_sub_
ros::Publisher depth_image_pub_
sensor_msgs::CameraInfo tCameraInfo
bool getParam(const std::string &key, bool &b) const
message_filters::Synchronizer< tSyncPolicy > sync_
ros::Publisher rgb_caminfo_pub_
ros::NodeHandle & getPrivateNodeHandle() const
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
message_filters::sync_policies::ApproximateTime< tPointCloud, tImage, tCameraInfo > tSyncPolicy
void connectCB(const ros::SingleSubscriberPublisher &pub)
message_filters::Subscriber< tPointCloud > rgb_cloud_sub_
message_filters::Subscriber< tPointCloud > cloud_sub_
PLUGINLIB_EXPORT_CLASS(cob_cam3d_throttle::Cam3DThrottle, nodelet::Nodelet)
sensor_msgs::PointCloud2 tPointCloud
void disconnectCB(const ros::SingleSubscriberPublisher &pub)
unsigned int sub_counter_
void callback(const tPointCloud::ConstPtr &rgb_cloud, const tImage::ConstPtr &rgb_image, const tCameraInfo::ConstPtr &rgb_caminfo)
ros::Publisher cloud_pub_
message_filters::Subscriber< tImage > rgb_image_sub_
ros::Publisher rgb_image_pub_
ros::Publisher rgb_cloud_pub_
sensor_msgs::Image tImage
#define NODELET_DEBUG(...)