
Public Member Functions | |
| Cam3DThrottle () | |
Private Member Functions | |
| void | callback (const tPointCloud::ConstPtr &rgb_cloud, const tImage::ConstPtr &rgb_image, const tCameraInfo::ConstPtr &rgb_caminfo) |
| void | connectCB (const ros::SingleSubscriberPublisher &pub) |
| void | disconnectCB (const ros::SingleSubscriberPublisher &pub) |
| virtual void | onInit () |
Private Attributes | |
| ros::Publisher | cloud_pub_ |
| message_filters::Subscriber < tPointCloud > | cloud_sub_ |
| ros::Publisher | depth_image_pub_ |
| message_filters::Subscriber < tImage > | depth_image_sub_ |
| ros::Time | last_update_ |
| double | max_update_rate_ |
| ros::NodeHandle | nh_ |
| ros::Publisher | rgb_caminfo_pub_ |
| message_filters::Subscriber < tCameraInfo > | rgb_caminfo_sub_ |
| ros::Publisher | rgb_cloud_pub_ |
| message_filters::Subscriber < tPointCloud > | rgb_cloud_sub_ |
| ros::Publisher | rgb_image_pub_ |
| message_filters::Subscriber < tImage > | rgb_image_sub_ |
| ros::Subscriber | sub2_ |
| ros::Subscriber | sub_ |
| unsigned int | sub_counter_ |
| message_filters::Synchronizer < tSyncPolicy > | sync_ |
Definition at line 81 of file cam3d_throttle.cpp.
| cob_cam3d_throttle::Cam3DThrottle::Cam3DThrottle | ( | ) | [inline] |
Definition at line 85 of file cam3d_throttle.cpp.
| void cob_cam3d_throttle::Cam3DThrottle::callback | ( | const tPointCloud::ConstPtr & | rgb_cloud, |
| const tImage::ConstPtr & | rgb_image, | ||
| const tCameraInfo::ConstPtr & | rgb_caminfo | ||
| ) | [inline, private] |
Definition at line 139 of file cam3d_throttle.cpp.
| void cob_cam3d_throttle::Cam3DThrottle::connectCB | ( | const ros::SingleSubscriberPublisher & | pub | ) | [inline, private] |
Definition at line 167 of file cam3d_throttle.cpp.
| void cob_cam3d_throttle::Cam3DThrottle::disconnectCB | ( | const ros::SingleSubscriberPublisher & | pub | ) | [inline, private] |
Definition at line 182 of file cam3d_throttle.cpp.
| virtual void cob_cam3d_throttle::Cam3DThrottle::onInit | ( | ) | [inline, private, virtual] |
Implements nodelet::Nodelet.
Definition at line 93 of file cam3d_throttle.cpp.
Definition at line 203 of file cam3d_throttle.cpp.
Definition at line 209 of file cam3d_throttle.cpp.
Definition at line 203 of file cam3d_throttle.cpp.
Definition at line 208 of file cam3d_throttle.cpp.
Definition at line 196 of file cam3d_throttle.cpp.
double cob_cam3d_throttle::Cam3DThrottle::max_update_rate_ [private] |
Definition at line 197 of file cam3d_throttle.cpp.
Reimplemented from nodelet::Nodelet.
Definition at line 200 of file cam3d_throttle.cpp.
Definition at line 203 of file cam3d_throttle.cpp.
message_filters::Subscriber<tCameraInfo> cob_cam3d_throttle::Cam3DThrottle::rgb_caminfo_sub_ [private] |
Definition at line 207 of file cam3d_throttle.cpp.
Definition at line 203 of file cam3d_throttle.cpp.
message_filters::Subscriber<tPointCloud> cob_cam3d_throttle::Cam3DThrottle::rgb_cloud_sub_ [private] |
Definition at line 205 of file cam3d_throttle.cpp.
Definition at line 203 of file cam3d_throttle.cpp.
Definition at line 206 of file cam3d_throttle.cpp.
Definition at line 202 of file cam3d_throttle.cpp.
Definition at line 201 of file cam3d_throttle.cpp.
unsigned int cob_cam3d_throttle::Cam3DThrottle::sub_counter_ [private] |
Definition at line 198 of file cam3d_throttle.cpp.
Definition at line 210 of file cam3d_throttle.cpp.