grid_map_to_image_demo_node.cpp
Go to the documentation of this file.
1 /*
2  * grid_map_to_image_demo.cpp
3  *
4  * Created on: October 19, 2020
5  * Author: Magnus Gärtner
6  * Institute: ETH Zurich, ANYbotics
7  */
8 
10 
11 #include <ros/ros.h>
12 
13 /*
14  * Usage:
15  * $ rosrun grid_map_demos grid_map_to_image_demo _grid_map_topic:=/grid_map _file:=/home/$USER/Desktop/grid_map_image.png
16  */
17 int main(int argc, char** argv)
18 {
19  // Initialize node and publisher.
20  ros::init(argc, argv, "grid_map_to_image_demo");
21  ros::NodeHandle nh("~");
22  grid_map_demos::GridMapToImageDemo gridMapToImageDemo(nh);
23 
24  ros::spin();
25  return EXIT_SUCCESS;
26 }
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 1 2021 02:13:55