Go to the documentation of this file.
37 #ifndef SINGLE_CLIENT_H_
38 #define SINGLE_CLIENT_H_
40 #include <visualization_msgs/InteractiveMarkerInit.h>
41 #include <visualization_msgs/InteractiveMarkerUpdate.h>
43 #include <boost/scoped_ptr.hpp>
44 #include <boost/thread/thread.hpp>
45 #include <boost/thread/recursive_mutex.hpp>
47 #include <boost/function.hpp>
48 #include <boost/unordered_map.hpp>
56 #include "../interactive_marker_client.h"
67 const std::string& server_id,
75 void process(
const visualization_msgs::InteractiveMarkerUpdate::ConstPtr& msg,
bool enable_autocomplete_transparency =
true);
78 void process(
const visualization_msgs::InteractiveMarkerInit::ConstPtr& msg,
bool enable_autocomplete_transparency =
true);
StateMachine< StateT > state_
uint64_t first_update_seq_num_
void process(const visualization_msgs::InteractiveMarkerUpdate::ConstPtr &msg, bool enable_autocomplete_transparency=true)
M_UpdateMessageContext update_queue_
MessageContext< visualization_msgs::InteractiveMarkerUpdate > UpdateMessageContext
M_InitMessageContext init_queue_
std::deque< UpdateMessageContext > M_UpdateMessageContext
uint64_t last_update_seq_num_
std::deque< InitMessageContext > M_InitMessageContext
void transformUpdateMsgs()
ros::Time last_update_time_
SingleClient(const std::string &server_id, tf2_ros::Buffer &tf, const std::string &target_frame, const InteractiveMarkerClient::CbCollection &callbacks)
std::string target_frame_
const InteractiveMarkerClient::CbCollection & callbacks_
void errorReset(std::string error_msg)
MessageContext< visualization_msgs::InteractiveMarkerInit > InitMessageContext
interactive_markers
Author(s): David Gossow, William Woodall
autogenerated on Fri Oct 27 2023 02:31:54