#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 7 of file advertisement_checker.h.
image_proc::AdvertisementChecker::AdvertisementChecker | ( | const ros::NodeHandle & | nh = ros::NodeHandle() , |
|
const std::string & | name = std::string() | |||
) |
Definition at line 4 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::start | ( | const ros::V_string & | topics, | |
double | duration | |||
) |
Definition at line 40 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::stop | ( | ) |
Definition at line 52 of file advertisement_checker.cpp.
void image_proc::AdvertisementChecker::timerCb | ( | ) | [private] |
Definition at line 11 of file advertisement_checker.cpp.
std::string image_proc::AdvertisementChecker::name_ [private] |
Definition at line 7 of file advertisement_checker.h.
ros::NodeHandle image_proc::AdvertisementChecker::nh_ [private] |
Definition at line 6 of file advertisement_checker.h.
ros::WallTimer image_proc::AdvertisementChecker::timer_ [private] |
Definition at line 8 of file advertisement_checker.h.
ros::V_string image_proc::AdvertisementChecker::topics_ [private] |
Definition at line 9 of file advertisement_checker.h.