Go to the documentation of this file.
   12 #include <ros/callback_queue.h> 
   13 #include <ros/node_handle.h> 
   14 #include <ros/subscriber.h> 
   17 #include <std_msgs/String.h> 
  112 #endif // RGBD_CLIENT_H_ 
  
void hostsCallback(const std_msgs::StringConstPtr &msg)
std::thread sub_hosts_thread_
std::mutex switch_impl_mutex_
virtual ~Client()
Destructor.
bool initialized()
Check if the client is initialized. Checks if nh_ is exists. nextImage will not return an image if cl...
bool deinitialize()
Calls deinitialize on implementation clients. Shutsdown both implementations and deletes nh_....
bool initialize(const std::string &server_name, float timeout=5.0)
Initialize the client.
ros::WallTime last_time_shm_server_online_
ImagePtr nextImage()
Get a new Image. If no new image has been received since the last call, The ImagePtr will be a nullpt...
Client which subscribes to RGBD topic.
ros::CallbackQueue cb_queue_
ros::Subscriber sub_shm_hosts_
Client which uses the interfaces of ClientRGBD and ClientSHM.
ClientImplMode client_impl_mode_
void subHostsThreadFunc(const float frequency)
Client which uses shared memory, requires a server on the same machine.
std::unique_ptr< ros::NodeHandle > nh_