35 #include <boost/foreach.hpp> 40 const std::string& name)
51 ros::V_string::iterator topic_it =
topics_.begin();
52 while (topic_it !=
topics_.end())
56 ros::master::V_TopicInfo::iterator info_it = topic_info.begin();
57 while (!found && info_it != topic_info.end())
59 found = (*topic_it == info_it->name);
63 topic_it =
topics_.erase(topic_it);
78 BOOST_FOREACH(
const std::string& topic, topics)
#define ROS_WARN_NAMED(name,...)
void start(const ros::V_string &topics, double duration)
std::string resolveName(const std::string &name, bool remap=true) const
ROSCPP_DECL bool getTopics(V_TopicInfo &topics)
std::vector< TopicInfo > V_TopicInfo
AdvertisementChecker(const ros::NodeHandle &nh=ros::NodeHandle(), const std::string &name=std::string())
std::vector< std::string > V_string
WallTimer createWallTimer(WallDuration period, void(T::*callback)(const WallTimerEvent &), T *obj, bool oneshot=false, bool autostart=true) const