octomap_to_gridmap_demo_node.cpp
Go to the documentation of this file.
1 /*
2  * octomap_to_gridmap_demo_node.cpp
3  *
4  * Created on: May 03, 2017
5  * Author: Jeff Delmerico
6  * Institute: University of Zürich, Robotics and Perception Group
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, "octomap_to_gridmap_demo");
16  ros::NodeHandle nh("~");
17  grid_map_demos::OctomapToGridmapDemo octomapToGridmapDemo(nh);
18  ros::Duration(2.0).sleep();
19 
20  ros::Rate r(0.1); // 1 hz
21  while (ros::ok())
22  {
23  octomapToGridmapDemo.convertAndPublishMap();
24  ros::spinOnce();
25  r.sleep();
26  }
27  return 0;
28 }
int main(int argc, char **argv)
bool sleep() const
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL bool ok()
bool sleep()
ROSCPP_DECL void spinOnce()
r


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