00001 #ifndef IMAGE_PROC_ADVERTISEMENT_CHECKER_H
00002 #define IMAGE_PROC_ADVERTISEMENT_CHECKER_H
00003
00004 #include <ros/ros.h>
00005
00006 namespace image_proc {
00007
00008 class AdvertisementChecker
00009 {
00010 ros::NodeHandle nh_;
00011 std::string name_;
00012 ros::WallTimer timer_;
00013 ros::V_string topics_;
00014
00015 void timerCb();
00016
00017 public:
00018 AdvertisementChecker(const ros::NodeHandle& nh = ros::NodeHandle(),
00019 const std::string& name = std::string());
00020
00021 void start(const ros::V_string& topics, double duration);
00022
00023 void stop();
00024 };
00025
00026 }
00027
00028 #endif