#include <ros/ros.h>#include <gtest/gtest.h>#include <camera_calibration_parsers/parse.h>#include <string>#include <sensor_msgs/CameraInfo.h>#include <opencv/cv.h>#include "opencv2/core/core_c.h"#include "opencv2/core/core.hpp"#include "opencv2/highgui/highgui_c.h"#include <cv_bridge/CvBridge.h>#include <image_transport/image_transport.h>#include <boost/foreach.hpp>

Go to the source code of this file.
Classes | |
| class | ImageProcTest |
Functions | |
| void | callback (const sensor_msgs::ImageConstPtr &msg) |
| int | main (int argc, char **argv) |
| TEST_F (ImageProcTest, monoSubscription) | |
| void callback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 77 of file rostest.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 95 of file rostest.cpp.
| TEST_F | ( | ImageProcTest | , | |
| monoSubscription | ||||
| ) |
Definition at line 83 of file rostest.cpp.