Public Member Functions | |
void | image_cb (const sensor_msgs::ImageConstPtr &msg) |
RemotePtam (const ros::NodeHandle &nh, const std::string &_transport) | |
void | subscribe (const ros::NodeHandle &nh) |
void | unsubscribe () |
~RemotePtam () | |
Private Attributes | |
image_transport::Subscriber * | sub_ |
std::string | topic_ |
std::string | transport_ |
std::string | window_name_ |
Definition at line 58 of file RemotePtam.cpp.
RemotePtam::RemotePtam | ( | const ros::NodeHandle & | nh, |
const std::string & | _transport | ||
) | [inline] |
Definition at line 67 of file RemotePtam.cpp.
RemotePtam::~RemotePtam | ( | ) | [inline] |
Definition at line 89 of file RemotePtam.cpp.
void RemotePtam::image_cb | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 95 of file RemotePtam.cpp.
void RemotePtam::subscribe | ( | const ros::NodeHandle & | nh | ) | [inline] |
Definition at line 110 of file RemotePtam.cpp.
void RemotePtam::unsubscribe | ( | ) | [inline] |
Definition at line 119 of file RemotePtam.cpp.
image_transport::Subscriber* RemotePtam::sub_ [private] |
Definition at line 61 of file RemotePtam.cpp.
std::string RemotePtam::topic_ [private] |
Definition at line 64 of file RemotePtam.cpp.
std::string RemotePtam::transport_ [private] |
Definition at line 63 of file RemotePtam.cpp.
std::string RemotePtam::window_name_ [private] |
Definition at line 62 of file RemotePtam.cpp.