#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 41 of file advertisement_checker.h.
image_proc::AdvertisementChecker::AdvertisementChecker | ( | const ros::NodeHandle & | nh = ros::NodeHandle() , |
const std::string & | name = std::string() |
||
) |
Definition at line 39 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::start | ( | const ros::V_string & | topics, |
double | duration | ||
) |
Definition at line 75 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::stop | ( | ) |
Definition at line 87 of file advertisement_checker.cpp.
|
private |
Definition at line 46 of file advertisement_checker.cpp.
|
private |
Definition at line 44 of file advertisement_checker.h.
|
private |
Definition at line 43 of file advertisement_checker.h.
|
private |
Definition at line 45 of file advertisement_checker.h.
|
private |
Definition at line 46 of file advertisement_checker.h.