Public Member Functions | Private Member Functions | Private Attributes | List of all members
cob_cam3d_throttle::Cam3DThrottle Class Reference
Inheritance diagram for cob_cam3d_throttle::Cam3DThrottle:
Inheritance graph
[legend]

Public Member Functions

 Cam3DThrottle ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

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< tPointCloudcloud_sub_
 
ros::Publisher depth_image_pub_
 
message_filters::Subscriber< tImagedepth_image_sub_
 
ros::Time last_update_
 
double max_update_rate_
 
ros::NodeHandle nh_
 
ros::Publisher rgb_caminfo_pub_
 
message_filters::Subscriber< tCameraInforgb_caminfo_sub_
 
ros::Publisher rgb_cloud_pub_
 
message_filters::Subscriber< tPointCloudrgb_cloud_sub_
 
ros::Publisher rgb_image_pub_
 
message_filters::Subscriber< tImagergb_image_sub_
 
ros::Subscriber sub2_
 
ros::Subscriber sub_
 
unsigned int sub_counter_
 
message_filters::Synchronizer< tSyncPolicysync_
 

Additional Inherited Members

- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 39 of file cam3d_throttle.cpp.

Constructor & Destructor Documentation

◆ Cam3DThrottle()

cob_cam3d_throttle::Cam3DThrottle::Cam3DThrottle ( )
inline

Definition at line 43 of file cam3d_throttle.cpp.

Member Function Documentation

◆ callback()

void cob_cam3d_throttle::Cam3DThrottle::callback ( const tPointCloud::ConstPtr &  rgb_cloud,
const tImage::ConstPtr &  rgb_image,
const tCameraInfo::ConstPtr &  rgb_caminfo 
)
inlineprivate

Definition at line 97 of file cam3d_throttle.cpp.

◆ connectCB()

void cob_cam3d_throttle::Cam3DThrottle::connectCB ( const ros::SingleSubscriberPublisher pub)
inlineprivate

Definition at line 125 of file cam3d_throttle.cpp.

◆ disconnectCB()

void cob_cam3d_throttle::Cam3DThrottle::disconnectCB ( const ros::SingleSubscriberPublisher pub)
inlineprivate

Definition at line 140 of file cam3d_throttle.cpp.

◆ onInit()

virtual void cob_cam3d_throttle::Cam3DThrottle::onInit ( )
inlineprivatevirtual

Implements nodelet::Nodelet.

Definition at line 51 of file cam3d_throttle.cpp.

Member Data Documentation

◆ cloud_pub_

ros::Publisher cob_cam3d_throttle::Cam3DThrottle::cloud_pub_
private

Definition at line 161 of file cam3d_throttle.cpp.

◆ cloud_sub_

message_filters::Subscriber<tPointCloud> cob_cam3d_throttle::Cam3DThrottle::cloud_sub_
private

Definition at line 167 of file cam3d_throttle.cpp.

◆ depth_image_pub_

ros::Publisher cob_cam3d_throttle::Cam3DThrottle::depth_image_pub_
private

Definition at line 161 of file cam3d_throttle.cpp.

◆ depth_image_sub_

message_filters::Subscriber<tImage> cob_cam3d_throttle::Cam3DThrottle::depth_image_sub_
private

Definition at line 166 of file cam3d_throttle.cpp.

◆ last_update_

ros::Time cob_cam3d_throttle::Cam3DThrottle::last_update_
private

Definition at line 154 of file cam3d_throttle.cpp.

◆ max_update_rate_

double cob_cam3d_throttle::Cam3DThrottle::max_update_rate_
private

Definition at line 155 of file cam3d_throttle.cpp.

◆ nh_

ros::NodeHandle cob_cam3d_throttle::Cam3DThrottle::nh_
private

Definition at line 158 of file cam3d_throttle.cpp.

◆ rgb_caminfo_pub_

ros::Publisher cob_cam3d_throttle::Cam3DThrottle::rgb_caminfo_pub_
private

Definition at line 161 of file cam3d_throttle.cpp.

◆ rgb_caminfo_sub_

message_filters::Subscriber<tCameraInfo> cob_cam3d_throttle::Cam3DThrottle::rgb_caminfo_sub_
private

Definition at line 165 of file cam3d_throttle.cpp.

◆ rgb_cloud_pub_

ros::Publisher cob_cam3d_throttle::Cam3DThrottle::rgb_cloud_pub_
private

Definition at line 161 of file cam3d_throttle.cpp.

◆ rgb_cloud_sub_

message_filters::Subscriber<tPointCloud> cob_cam3d_throttle::Cam3DThrottle::rgb_cloud_sub_
private

Definition at line 163 of file cam3d_throttle.cpp.

◆ rgb_image_pub_

ros::Publisher cob_cam3d_throttle::Cam3DThrottle::rgb_image_pub_
private

Definition at line 161 of file cam3d_throttle.cpp.

◆ rgb_image_sub_

message_filters::Subscriber<tImage> cob_cam3d_throttle::Cam3DThrottle::rgb_image_sub_
private

Definition at line 164 of file cam3d_throttle.cpp.

◆ sub2_

ros::Subscriber cob_cam3d_throttle::Cam3DThrottle::sub2_
private

Definition at line 160 of file cam3d_throttle.cpp.

◆ sub_

ros::Subscriber cob_cam3d_throttle::Cam3DThrottle::sub_
private

Definition at line 159 of file cam3d_throttle.cpp.

◆ sub_counter_

unsigned int cob_cam3d_throttle::Cam3DThrottle::sub_counter_
private

Definition at line 156 of file cam3d_throttle.cpp.

◆ sync_

message_filters::Synchronizer<tSyncPolicy> cob_cam3d_throttle::Cam3DThrottle::sync_
private

Definition at line 168 of file cam3d_throttle.cpp.


The documentation for this class was generated from the following file:


cob_cam3d_throttle
Author(s): Georg Arbeiter
autogenerated on Tue Aug 2 2022 02:20:56