Public Member Functions | |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
void | publishRaw () |
Protected Member Functions | |
virtual void | SetUp () |
Protected Attributes | |
sensor_msgs::CameraInfo | cam_info_ |
image_transport::CameraPublisher | cam_pub_ |
image_transport::Subscriber | cam_sub_ |
cv::Mat | distorted_image_ |
bool | has_new_image_ |
ros::NodeHandle | nh_ |
sensor_msgs::ImagePtr | raw_image_ |
cv::Mat | received_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 test_rectify.cpp.
void ImageProcRectifyTest::imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 93 of file test_rectify.cpp.
void ImageProcRectifyTest::publishRaw | ( | ) | [inline] |
Definition at line 109 of file test_rectify.cpp.
virtual void ImageProcRectifyTest::SetUp | ( | ) | [inline, protected, virtual] |
Definition at line 13 of file test_rectify.cpp.
sensor_msgs::CameraInfo ImageProcRectifyTest::cam_info_ [protected] |
Definition at line 88 of file test_rectify.cpp.
Definition at line 89 of file test_rectify.cpp.
Definition at line 90 of file test_rectify.cpp.
cv::Mat ImageProcRectifyTest::distorted_image_ [protected] |
Definition at line 84 of file test_rectify.cpp.
bool ImageProcRectifyTest::has_new_image_ [protected] |
Definition at line 86 of file test_rectify.cpp.
ros::NodeHandle ImageProcRectifyTest::nh_ [protected] |
Definition at line 77 of file test_rectify.cpp.
sensor_msgs::ImagePtr ImageProcRectifyTest::raw_image_ [protected] |
Definition at line 85 of file test_rectify.cpp.
cv::Mat ImageProcRectifyTest::received_image_ [protected] |
Definition at line 87 of file test_rectify.cpp.
std::string ImageProcRectifyTest::topic_color_ [protected] |
Definition at line 81 of file test_rectify.cpp.
std::string ImageProcRectifyTest::topic_mono_ [protected] |
Definition at line 79 of file test_rectify.cpp.
std::string ImageProcRectifyTest::topic_raw_ [protected] |
Definition at line 78 of file test_rectify.cpp.
std::string ImageProcRectifyTest::topic_rect_ [protected] |
Definition at line 80 of file test_rectify.cpp.
std::string ImageProcRectifyTest::topic_rect_color_ [protected] |
Definition at line 82 of file test_rectify.cpp.