Go to the documentation of this file.
   80                      "[image_transport] Topics '%s' and '%s' do not appear to be synchronized. " 
   82                      "\tImage messages received:      %d\n" 
   83                      "\tCameraInfo messages received: %d\n" 
   84                      "\tSynchronized pairs:           %d",
 
  101                                    const std::string& base_topic, uint32_t queue_size,
 
  104   : impl_(new 
Impl(queue_size))
 
  108   std::string image_topic = info_nh.
resolveName(base_topic);
 
  110   impl_->image_sub_.subscribe(image_it, image_topic, queue_size, transport_hints);
 
  111   impl_->info_sub_ .subscribe(info_nh, info_topic, queue_size, transport_hints.
getRosHints());
 
  114   impl_->sync_.registerCallback(boost::bind(callback, boost::placeholders::_1, boost::placeholders::_2));
 
  126   if (
impl_) 
return impl_->image_sub_.getTopic();
 
  127   return std::string();
 
  132   if (
impl_) 
return impl_->info_sub_.getTopic();
 
  133   return std::string();
 
  140   if (
impl_) 
return impl_->image_sub_.getNumPublishers();
 
  146   if (
impl_) 
return impl_->image_sub_.getTransport();
 
  147   return std::string();
 
  155 CameraSubscriber::operator 
void*() 
const 
  157   return (impl_ && impl_->isValid()) ? (
void*)1 : (
void*)0;
 
  
Image subscription filter.
void increment(int *value)
IMAGE_TRANSPORT_DECL std::string getCameraInfoTopic(const std::string &base_topic)
Form the camera info topic name, sibling to the base topic.
Advertise and subscribe to image topics.
message_filters::Subscriber< sensor_msgs::CameraInfo > info_sub_
Impl(uint32_t queue_size)
std::string getTransport() const
Returns the name of the transport being used.
std::string getTopic() const
std::string getTopic() const
std::string resolveName(const std::string &name, bool remap=true) const
void shutdown()
Unsubscribe the callback associated with this CameraSubscriber.
ros::WallTimer check_synced_timer_
boost::function< void(const sensor_msgs::ImageConstPtr &, const sensor_msgs::CameraInfoConstPtr &)> Callback
SubscriberFilter image_sub_
message_filters::TimeSynchronizer< sensor_msgs::Image, sensor_msgs::CameraInfo > sync_
uint32_t getNumPublishers() const
Returns the number of publishers this subscriber is connected to.
const ros::TransportHints & getRosHints() const
#define ROS_WARN_NAMED(name,...)
std::string getTopic() const
Get the base topic (on which the raw image is published).
std::string getInfoTopic() const
Get the camera info topic.
void checkImagesSynchronized()
Stores transport settings for an image topic subscription.
WallTimer createWallTimer(WallDuration period, const WallTimerCallback &callback, bool oneshot=false, bool autostart=true) const
void unsubscribe()
Force immediate unsubscription of this subscriber from its topic.
image_transport
Author(s): Patrick Mihelich
autogenerated on Fri Apr 11 2025 02:14:22