#include <distortion.h>
Public Member Functions | |
void | cameraDistortionTest () |
void | camInfoCallback (const sensor_msgs::CameraInfoConstPtr &msg) |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg, int cam_index) |
Protected Attributes | |
sensor_msgs::ImageConstPtr | cam_image_distorted_ |
sensor_msgs::ImageConstPtr | cam_image_undistorted_ |
sensor_msgs::CameraInfoConstPtr | cam_info_distorted_ |
ros::Subscriber | cam_info_distorted_sub_ |
image_transport::Subscriber | cam_sub_distorted_ |
image_transport::Subscriber | cam_sub_undistorted_ |
ros::NodeHandle | nh_ |
Definition at line 37 of file distortion.h.
void DistortionTest::cameraDistortionTest | ( | ) |
Definition at line 77 of file distortion.h.
|
inline |
Definition at line 71 of file distortion.h.
|
inline |
Definition at line 58 of file distortion.h.
|
protected |
Definition at line 47 of file distortion.h.
|
protected |
Definition at line 48 of file distortion.h.
|
protected |
Definition at line 53 of file distortion.h.
|
protected |
Definition at line 51 of file distortion.h.
|
protected |
Definition at line 43 of file distortion.h.
|
protected |
Definition at line 44 of file distortion.h.
|
protected |
Definition at line 40 of file distortion.h.