#include "jsk_pcl_ros_utils/pointcloud_to_stl.h"#include <geometry_msgs/PoseStamped.h>#include <geometry_msgs/PointStamped.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <pcl/kdtree/kdtree_flann.h>#include <pcl/features/normal_3d.h>#include <pcl/surface/gp3.h>#include <pcl/io/vtk_lib_io.h>#include <pcl/TextureMesh.h>#include <pcl/surface/texture_mapping.h>#include <pcl/surface/mls.h>#include <pcl/io/obj_io.h>#include <pcl/filters/filter.h>#include "jsk_recognition_utils/pcl_conversion_util.h"#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
| Namespaces | |
| namespace | jsk_pcl_ros_utils | 
| Defines | |
| #define | BOOST_PARAMETER_MAX_ARITY 7 | 
| Functions | |
| PLUGINLIB_EXPORT_CLASS (jsk_pcl_ros_utils::PointCloudToSTL, nodelet::Nodelet) | |
| #define BOOST_PARAMETER_MAX_ARITY 7 | 
Definition at line 35 of file pointcloud_to_stl_nodelet.cpp.