Go to the documentation of this file.
4 #include <std_msgs/String.h>
12 Server::Server(ros::NodeHandle nh) : nh_(nh), pub_hostname_thread_ptr_(nullptr)
virtual ~Server()
Destructor.
void initialize(const std::string &name, RGBStorageType rgb_type=RGB_STORAGE_LOSSLESS, DepthStorageType depth_type=DEPTH_STORAGE_LOSSLESS, const float service_freq=10)
Initialize server.
void send(const Image &image, bool threaded=false)
send Write a new image to all interfaces
std::string get_hostname()
Get the hostname of the current machine.
void pubHostnameThreadFunc(ros::NodeHandle &nh, const std::string server_name, const std::string hostname, const float frequency)
void initialize(const std::string &name, RGBStorageType rgb_type=RGB_STORAGE_LOSSLESS, DepthStorageType depth_type=DEPTH_STORAGE_LOSSLESS, const float service_freq=10)
initialize initialize server
void send(const Image &image)
send Write a new image to the shared memory
Server(ros::NodeHandle nh=ros::NodeHandle())
Constructor.
void initialize(const std::string &name)
initialize Initialize shared memory server
std::unique_ptr< std::thread > pub_hostname_thread_ptr_
void send(const Image &image)
Write a new image to all interfaces.