72 std_srvs::Empty::Request &req,
73 std_srvs::Empty::Response &res)
75 boost::mutex::scoped_lock lock(
mutex_);
87 boost::mutex::scoped_lock lock(
mutex_);
116 jsk_topic_tools::PassthroughDuration::Request &req,
117 jsk_topic_tools::PassthroughDuration::Response &res)
124 std_srvs::Empty::Request &req,
125 std_srvs::Empty::Response &res)
134 boost::mutex::scoped_lock lock(
mutex_);
163 boost::mutex::scoped_lock lock(
mutex_);
180 boost::mutex::scoped_lock lock(
mutex_);
196 const std::string&
topic)
205 msg->getMessageDefinition());
boost::function< void(const SingleSubscriberPublisher &)> SubscriberStatusCallback
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)
uint32_t getNumSubscribers() const
jsk_topic_tools::Passthrough Passthrough
#define NODELET_DEBUG(...)