#include "handeye_log.h"
Go to the source code of this file.
Functions | |
| void | load_xyz_img_depth (pcl::PointCloud< pcl::PointXYZ > &pcl_xyz, std::ofstream &img_depth) |
| void | load_xyz_matlab_file (pcl::PointCloud< pcl::PointXYZ > &pcl_xyz, std::ofstream &matlab_file) |
| void | load_xyzr_img_depth (pcl::PointCloud< pcl::PointWithRange > &pcl_xyzr, std::ofstream &img_depth) |
| void | load_xyzr_matlab_file (pcl::PointCloud< pcl::PointWithRange > &pcl_xyzr, std::ofstream &matlab_file) |
| void | load_xyzrgb_img_depth (pcl::PointCloud< pcl::PointXYZRGB > &pcl_xyzrgb, std::ofstream &img_depth) |
| void | load_xyzrgb_matlab_file (pcl::PointCloud< pcl::PointXYZRGB > &pcl_xyzrgb, std::ofstream &matlab_file) |
| void | load_xyzri_img_depth (sensor_msgs::PointCloud2 &pcl_xyzri, std::ofstream &img_depth) |
| void | load_xyzri_matlab_file (sensor_msgs::PointCloud2 &pcl_xyzri, std::ofstream &matlab_file) |
| int | main (int argc, char **argv) |
| void | store_xyzri_img_depth (sensor_msgs::PointCloud2 &pcl_xyzri, std::ofstream &img_intensity) |
| void load_xyz_img_depth | ( | pcl::PointCloud< pcl::PointXYZ > & | pcl_xyz, |
| std::ofstream & | img_depth | ||
| ) |
Definition at line 111 of file handeye_log.cpp.
| void load_xyz_matlab_file | ( | pcl::PointCloud< pcl::PointXYZ > & | pcl_xyz, |
| std::ofstream & | matlab_file | ||
| ) |
Definition at line 60 of file handeye_log.cpp.
| void load_xyzr_img_depth | ( | pcl::PointCloud< pcl::PointWithRange > & | pcl_xyzr, |
| std::ofstream & | img_depth | ||
| ) |
Definition at line 99 of file handeye_log.cpp.
| void load_xyzr_matlab_file | ( | pcl::PointCloud< pcl::PointWithRange > & | pcl_xyzr, |
| std::ofstream & | matlab_file | ||
| ) |
Definition at line 46 of file handeye_log.cpp.
| void load_xyzrgb_img_depth | ( | pcl::PointCloud< pcl::PointXYZRGB > & | pcl_xyzrgb, |
| std::ofstream & | img_depth | ||
| ) |
Definition at line 74 of file handeye_log.cpp.
| void load_xyzrgb_matlab_file | ( | pcl::PointCloud< pcl::PointXYZRGB > & | pcl_xyzrgb, |
| std::ofstream & | matlab_file | ||
| ) |
Definition at line 17 of file handeye_log.cpp.
| void load_xyzri_img_depth | ( | sensor_msgs::PointCloud2 & | pcl_xyzri, |
| std::ofstream & | img_depth | ||
| ) |
Definition at line 87 of file handeye_log.cpp.
| void load_xyzri_matlab_file | ( | sensor_msgs::PointCloud2 & | pcl_xyzri, |
| std::ofstream & | matlab_file | ||
| ) |
Definition at line 33 of file handeye_log.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 761 of file handeye_log.cpp.
| void store_xyzri_img_depth | ( | sensor_msgs::PointCloud2 & | pcl_xyzri, |
| std::ofstream & | img_intensity | ||
| ) |
Definition at line 5 of file handeye_log.cpp.