next best view. More...
#include <pluginlib/class_list_macros.h>
#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <geometry_msgs/PoseArray.h>
#include "octomap/octomap.h"
#include "octomap_ros/conversions.h"
#include <octomap_ros/OctomapBinary.h>
#include "pcl_to_octree/octree/OcTreePCL.h"
#include "pcl_to_octree/octree/OcTreeNodePCL.h"
#include "pcl_to_octree/octree/OcTreeServerPCL.h"
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <pcl/features/normal_3d.h>
#include <pcl/features/boundary.h>
#include <pcl/segmentation/extract_clusters.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/filters/passthrough.h>
#include <pcl_ros/publisher.h>
#include <pcl_ros/pcl_nodelet.h>
#include <tf/transform_listener.h>
#include <visualization_msgs/MarkerArray.h>
#include <vector>
#include <nodelet/nodelet.h>
#include <math.h>
#include <iostream>
#include <fstream>
#include <sstream>
#include <nav_msgs/OccupancyGrid.h>
Go to the source code of this file.
Classes | |
class | autonomous_mapping::NextBestView |
struct | autonomous_mapping::point_2d |
Namespaces | |
namespace | autonomous_mapping |
Functions | |
PLUGINLIB_DECLARE_CLASS (autonomous_mapping, NextBestView, autonomous_mapping::NextBestView, nodelet::Nodelet) | |
void | autonomous_mapping::write_pgm (std::string filename, std::vector< std::vector< int > > cm) |
Variables | |
int | autonomous_mapping::counter = 0 |
double | autonomous_mapping::pi = 3.141 |
next best view.
Definition in file next_best_view.cpp.
PLUGINLIB_DECLARE_CLASS | ( | autonomous_mapping | , |
NextBestView | , | ||
autonomous_mapping::NextBestView | , | ||
nodelet::Nodelet | |||
) |