Protected Member Functions | |
void | publishRaw () |
virtual void | SetUp () |
Protected Attributes | |
sensor_msgs::CameraInfo | cam_info |
image_transport::CameraPublisher | cam_pub |
ros::NodeHandle | nh |
sensor_msgs::ImagePtr | raw_image |
std::string | topic_color |
std::string | topic_mono |
std::string | topic_raw |
std::string | topic_rect |
std::string | topic_rect_color |
Definition at line 10 of file rostest.cpp.
void ImageProcTest::publishRaw | ( | ) | [inline, protected] |
Definition at line 70 of file rostest.cpp.
virtual void ImageProcTest::SetUp | ( | ) | [inline, protected, virtual] |
Definition at line 13 of file rostest.cpp.
sensor_msgs::CameraInfo ImageProcTest::cam_info [protected] |
Definition at line 67 of file rostest.cpp.
Definition at line 68 of file rostest.cpp.
ros::NodeHandle ImageProcTest::nh [protected] |
Definition at line 59 of file rostest.cpp.
sensor_msgs::ImagePtr ImageProcTest::raw_image [protected] |
Definition at line 66 of file rostest.cpp.
std::string ImageProcTest::topic_color [protected] |
Definition at line 63 of file rostest.cpp.
std::string ImageProcTest::topic_mono [protected] |
Definition at line 61 of file rostest.cpp.
std::string ImageProcTest::topic_raw [protected] |
Definition at line 60 of file rostest.cpp.
std::string ImageProcTest::topic_rect [protected] |
Definition at line 62 of file rostest.cpp.
std::string ImageProcTest::topic_rect_color [protected] |
Definition at line 64 of file rostest.cpp.