36 : origin_(origin), target_(target), frame_id_processor_(frame_id_processor)
51 if (!is_static && frequency > 0.0)
59 for (tf2_msgs::TFMessage::_transforms_type::const_iterator new_tf = transforms->transforms.begin();
60 new_tf != transforms->transforms.end(); ++new_tf)
85 const FrameIdPair frame_id_pair(new_tf.header.frame_id, new_tf.child_frame_id);
90 geometry_msgs::TransformStamped::Ptr new_tf_ptr = boost::make_shared<geometry_msgs::TransformStamped>(new_tf);
96 std::pair<FrameIdPair, std::size_t>(frame_id_pair,
transform_cache_.transforms.size() - 1));
101 geometry_msgs::TransformStamped &
tf =
105 if (tf.header.stamp < new_tf.header.stamp)
107 tf.header.stamp = new_tf.header.stamp;
108 tf.transform = new_tf.transform;
void publish(const boost::shared_ptr< M > &message) const
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
static void processMessage(typename Message::Ptr &msg, typename Processor::ConstPtr &processor)