Public Member Functions | |
unsigned long | GetCalibratedXYMatlab (int u, int v, float z, float &x, float &y) |
unsigned long | GetCalibratedZSwissranger (int u, int v, int width, float &zCalibrated) |
void | Undistort (const boost::shared_ptr< sensor_msgs::PointCloud2 const > &tof_camera_data, const sensor_msgs::CameraInfoConstPtr &camera_info) |
UndistortTOF (const ros::NodeHandle &node_handle) | |
Private Attributes | |
ros::NodeHandle | node_handle_ |
sensor_msgs::PointCloud2 | pc2_msg_ |
ros::Publisher | pub_pc2_ |
message_filters::Subscriber < sensor_msgs::CameraInfo > | sub_camera_info_ |
message_filters::Subscriber < sensor_msgs::PointCloud2 > | sub_pc2_ |
message_filters::Synchronizer < SyncPolicy > | sub_sync_ |
Definition at line 79 of file undistort_tof.cpp.
UndistortTOF::UndistortTOF | ( | const ros::NodeHandle & | node_handle | ) | [inline] |
Definition at line 91 of file undistort_tof.cpp.
unsigned long UndistortTOF::GetCalibratedXYMatlab | ( | int | u, |
int | v, | ||
float | z, | ||
float & | x, | ||
float & | y | ||
) | [inline] |
Definition at line 111 of file undistort_tof.cpp.
unsigned long UndistortTOF::GetCalibratedZSwissranger | ( | int | u, |
int | v, | ||
int | width, | ||
float & | zCalibrated | ||
) | [inline] |
Definition at line 103 of file undistort_tof.cpp.
void UndistortTOF::Undistort | ( | const boost::shared_ptr< sensor_msgs::PointCloud2 const > & | tof_camera_data, |
const sensor_msgs::CameraInfoConstPtr & | camera_info | ||
) | [inline] |
Definition at line 144 of file undistort_tof.cpp.
ros::NodeHandle UndistortTOF::node_handle_ [private] |
Definition at line 82 of file undistort_tof.cpp.
sensor_msgs::PointCloud2 UndistortTOF::pc2_msg_ [private] |
Definition at line 83 of file undistort_tof.cpp.
ros::Publisher UndistortTOF::pub_pc2_ [private] |
Definition at line 88 of file undistort_tof.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> UndistortTOF::sub_camera_info_ [private] |
Definition at line 86 of file undistort_tof.cpp.
message_filters::Subscriber<sensor_msgs::PointCloud2> UndistortTOF::sub_pc2_ [private] |
Definition at line 85 of file undistort_tof.cpp.
Definition at line 87 of file undistort_tof.cpp.