next_best_view.cpp
Go to the documentation of this file.
1 
20 #include <assert.h>
21 #include <iostream>
22 
23 #include <ros/ros.h>
24 #include <geometry_msgs/Point.h>
25 #include <geometry_msgs/PoseWithCovarianceStamped.h>
26 #include <geometry_msgs/PoseStamped.h>
27 #include <nav_msgs/OccupancyGrid.h>
28 #include <nav_msgs/Path.h>
29 #include <set>
30 
31 #include "typedef.hpp"
35 
36 int main(int argc, char** argv) {
37  ros::init(argc, argv, "next_best_view");
38  ros::start();
39 
41 
42  ros::spin();
43 
44  return 0;
45 }
46 
47 
48 
ROSCPP_DECL void start()
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
NextBestView is a configuration class of the related node.
ROSCPP_DECL void spin(Spinner &spinner)
int main(int argc, char **argv)


asr_next_best_view
Author(s): Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij
autogenerated on Thu Jan 9 2020 07:20:18