sdf_demo_node.cpp
Go to the documentation of this file.
1 /*
2 * sdf_demo_node.cpp
3 *
4 * Created on: May 3, 2022
5 * Author: Ruben Grandia
6 * Institute: ETH Zurich
7 */
8 
9 #include <string>
10 
11 #include <ros/ros.h>
12 
14 
15 int main(int argc, char** argv)
16 {
17  ros::init(argc, argv, "grid_map_sdf_demo");
18  ros::NodeHandle nodeHandle("");
19 
20  std::string elevationLayer;
21  nodeHandle.getParam("elevation_layer", elevationLayer);
22 
23  std::string mapTopic;
24  nodeHandle.getParam("grid_map_topic", mapTopic);
25 
26  std::string pointcloudTopic;
27  nodeHandle.getParam("pointcloud_topic", pointcloudTopic);
28 
29  grid_map_demos::SdfDemo sdfDemo(nodeHandle, mapTopic, elevationLayer, pointcloudTopic);
30 
31  ros::spin();
32  return 0;
33 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool getParam(const std::string &key, std::string &s) const
int main(int argc, char **argv)
ROSCPP_DECL void spin()


grid_map_demos
Author(s): Péter Fankhauser
autogenerated on Wed Jul 5 2023 02:24:01