image_to_gridmap_demo_node.cpp
Go to the documentation of this file.
1 /*
2  * image_to_gridmap_demo_node.cpp
3  *
4  * Created on: May 04, 2015
5  * Author: Martin Wermelinger
6  * Institute: ETH Zurich, ANYbotics
7  */
8 
9 #include <ros/ros.h>
11 
12 int main(int argc, char** argv)
13 {
14  // Initialize node and publisher.
15  ros::init(argc, argv, "image_to_gridmap_demo");
16  ros::NodeHandle nh("~");
17  grid_map_demos::ImageToGridmapDemo imageToGridmapDemo(nh);
18 
19  ros::spin();
20  return 0;
21 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spin()
int main(int argc, char **argv)


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