grid_map_loader_node.cpp
Go to the documentation of this file.
00001 /*
00002  * grid_map_loader_node.cpp
00003  *
00004  *  Created on: Aug 24, 2015
00005  *      Author: Peter Fankhauser
00006  *   Institute: ETH Zurich, ANYbotics
00007  */
00008 
00009 #include <grid_map_loader/GridMapLoader.hpp>
00010 #include <ros/ros.h>
00011 
00012 int main(int argc, char** argv)
00013 {
00014   ros::init(argc, argv, "grid_map_loader");
00015   ros::NodeHandle nodeHandle("~");
00016   grid_map_loader::GridMapLoader gridMapLoader(nodeHandle);
00017   ros::waitForShutdown();
00018   return 0;
00019 }


grid_map_loader
Author(s): Péter Fankhauser
autogenerated on Tue Jul 9 2019 05:06:41