#include <ros/ros.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/Image.h>
#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
void | ImageCallback (const sensor_msgs::Image::ConstPtr &image) |
void | InfoCallback (const sensor_msgs::CameraInfo::ConstPtr &info) |
int | main (int argc, char **argv) |
TEST (CvCameraNode, getImage) | |
TEST (CvCameraNode, getCameraInfo) | |
Variables | |
sensor_msgs::CameraInfo | g_camera_info |
sensor_msgs::Image | g_image |
void ImageCallback | ( | const sensor_msgs::Image::ConstPtr & | image | ) |
Definition at line 11 of file test_cv_camera_no_yaml.cpp.
void InfoCallback | ( | const sensor_msgs::CameraInfo::ConstPtr & | info | ) |
Definition at line 16 of file test_cv_camera_no_yaml.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 71 of file test_cv_camera_no_yaml.cpp.
TEST | ( | CvCameraNode | , |
getImage | |||
) |
Definition at line 21 of file test_cv_camera_no_yaml.cpp.
TEST | ( | CvCameraNode | , |
getCameraInfo | |||
) |
Definition at line 41 of file test_cv_camera_no_yaml.cpp.
sensor_msgs::CameraInfo g_camera_info |
Definition at line 9 of file test_cv_camera_no_yaml.cpp.
sensor_msgs::Image g_image |
Definition at line 8 of file test_cv_camera_no_yaml.cpp.