iterators_demo_node.cpp
Go to the documentation of this file.
1 /*
2  * grid_map_iterators_demo_node.cpp
3  *
4  * Created on: Nov 4, 2014
5  * Author: Péter Fankhauser
6  * Institute: ETH Zurich, ANYbotics
7  */
8 
9 #include <ros/ros.h>
11 
12 int main(int argc, char** argv)
13 {
14  ros::init(argc, argv, "grid_map_iterators_demo");
15 
16  ros::NodeHandle nodeHandle("~");
17  grid_map_demos::IteratorsDemo iteratorsDemo(nodeHandle);
18 
20  return 0;
21 }
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void requestShutdown()


grid_map_demos
Author(s): Péter Fankhauser
autogenerated on Tue Jun 25 2019 20:02:37