Public Member Functions | |
| template<typename Point > | |
| bool | getPC (const size_t ind, typename pcl::PointCloud< Point >::Ptr pc, std::string &fn) const |
| void | load (const std::string &fn) |
| template<typename Point > | |
| void | writePC (const std::string &pc_fn, typename pcl::PointCloud< Point >::ConstPtr pc) const |
Static Public Member Functions | |
| static Testing_PCDLoader & | get () |
| singleton | |
Private Member Functions | |
| Testing_PCDLoader () | |
Static Private Member Functions | |
| static bool | _load (const std::string &fn, sensor_msgs::PointCloud2 &pc2) |
Private Attributes | |
| std::vector< std::string > | pc2s_fn_ |
little helper to load pcd files from test folder
Definition at line 90 of file test_segmentation.cpp.
| Testing_PCDLoader::Testing_PCDLoader | ( | ) | [inline, private] |
Definition at line 105 of file test_segmentation.cpp.
| static bool Testing_PCDLoader::_load | ( | const std::string & | fn, |
| sensor_msgs::PointCloud2 & | pc2 | ||
| ) | [inline, static, private] |
filename is stored in frame_id
Definition at line 94 of file test_segmentation.cpp.
| static Testing_PCDLoader& Testing_PCDLoader::get | ( | ) | [inline, static] |
singleton
Definition at line 119 of file test_segmentation.cpp.
| bool Testing_PCDLoader::getPC | ( | const size_t | ind, |
| typename pcl::PointCloud< Point >::Ptr | pc, | ||
| std::string & | fn | ||
| ) | const [inline] |
Definition at line 129 of file test_segmentation.cpp.
| void Testing_PCDLoader::load | ( | const std::string & | fn | ) | [inline] |
Definition at line 124 of file test_segmentation.cpp.
| void Testing_PCDLoader::writePC | ( | const std::string & | pc_fn, |
| typename pcl::PointCloud< Point >::ConstPtr | pc | ||
| ) | const [inline] |
Definition at line 146 of file test_segmentation.cpp.
std::vector<std::string> Testing_PCDLoader::pc2s_fn_ [private] |
Definition at line 92 of file test_segmentation.cpp.