#include "jsk_pcl_ros/environment_plane_modeling.h"#include <pcl/filters/extract_indices.h>#include <pcl/common/distances.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/filters/project_inliers.h>#include <pcl/surface/convex_hull.h>#include <jsk_recognition_msgs/SparseOccupancyGridArray.h>#include <pluginlib/class_list_macros.h>#include <geometry_msgs/PoseArray.h>#include "jsk_recognition_utils/geo_util.h"#include "jsk_pcl_ros/grid_map.h"#include <jsk_topic_tools/rosparam_utils.h>
Go to the source code of this file.
| Namespaces | |
| namespace | jsk_pcl_ros | 
| Defines | |
| #define | BOOST_PARAMETER_MAX_ARITY 7 | 
| Functions | |
| PLUGINLIB_EXPORT_CLASS (jsk_pcl_ros::EnvironmentPlaneModeling, nodelet::Nodelet) | |
| #define BOOST_PARAMETER_MAX_ARITY 7 | 
Definition at line 36 of file environment_plane_modeling_nodelet.cpp.