37 #include <std_msgs/Time.h> 59 boost::mutex::scoped_lock lock(
mutex_);
64 msg->getMessageDefinition());
70 std_msgs::Time timestamp;
80 std_msgs::Time timestamp;
91 std_srvs::Empty::Request& req,
92 std_srvs::Empty::Response& res)
94 boost::mutex::scoped_lock lock(
mutex_);
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())
PLUGINLIB_EXPORT_CLASS(jsk_topic_tools::Snapshot, nodelet::Nodelet)
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
ros::NodeHandle & getPrivateNodeHandle() const
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)