#include <advertisement_checker.h>
Public Member Functions | |
AdvertisementChecker (const ros::NodeHandle &nh=ros::NodeHandle(), const std::string &name=std::string()) | |
void | start (const ros::V_string &topics, double duration) |
void | stop () |
Private Member Functions | |
void | timerCb () |
Private Attributes | |
std::string | name_ |
ros::NodeHandle | nh_ |
ros::WallTimer | timer_ |
ros::V_string | topics_ |
Definition at line 8 of file advertisement_checker.h.
image_proc::AdvertisementChecker::AdvertisementChecker | ( | const ros::NodeHandle & | nh = ros::NodeHandle() , |
const std::string & | name = std::string() |
||
) |
Definition at line 6 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::start | ( | const ros::V_string & | topics, |
double | duration | ||
) |
Definition at line 42 of file advertisement_checker.cpp.
Definition at line 54 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::timerCb | ( | ) | [private] |
Definition at line 13 of file advertisement_checker.cpp.
std::string image_proc::AdvertisementChecker::name_ [private] |
Definition at line 11 of file advertisement_checker.h.
Definition at line 10 of file advertisement_checker.h.
Definition at line 12 of file advertisement_checker.h.
Definition at line 13 of file advertisement_checker.h.