44 catch (
const std::out_of_range &ex)
46 ROS_FATAL_STREAM(
"Invalid clock relay type " << clock_relay_type_string <<
" specified");
51 params.
topic =
"clock";
52 params.
type =
"rosgraph_msgs/Clock";
53 params.
origin = boost::make_shared<ros::NodeHandle>(from);
54 params.
target = boost::make_shared<ros::NodeHandle>(to);
58 switch (clock_relay_type)
84 ROS_FATAL_STREAM(
"Unsupported clock relay type " << clock_relay_type_string <<
" specified");
93 multimaster_msgs::GetClockOffset::Response &res)
double throttle_frequency
void publish(const boost::shared_ptr< M > &message) const
boost::shared_ptr< ros::NodeHandle > target
TimeProcessor::ConstPtr time_processor
ClockRelay(std::string from, std::string to, std::string clock_relay_type_string, double frequency)
static const boost::unordered_map< std::string, Type > type_name_map_
message_relay::TopicRelay::Ptr clock_relay_
#define ROS_FATAL_STREAM(args)
bool getClockOffsetCb(multimaster_msgs::GetClockOffset::Request &req, multimaster_msgs::GetClockOffset::Response &res)
static ConstPtr create(std::string offset_operation_string, ros::Duration offset=ros::Duration(0.0))
ros::ServiceServer offset_server_
TopicRelay::Ptr createTopicRelay(const TopicRelayParams ¶ms)
multimaster_msgs::ClockOffset offset_
ros::Publisher offset_publisher_
boost::shared_ptr< ros::NodeHandle > origin