17 #include <grid_map_msgs/GridMap.h> 35 SdfDemo(
ros::NodeHandle& nodeHandle,
const std::string& mapTopic, std::string elevationLayer,
const std::string& pointcloudTopic);
38 void callback(
const grid_map_msgs::GridMap& message);
std::string elevationLayer_
Elevation layer in the received grid map.
void callback(const grid_map_msgs::GridMap &message)
SdfDemo(ros::NodeHandle &nodeHandle, const std::string &mapTopic, std::string elevationLayer, const std::string &pointcloudTopic)
ros::Publisher freespacePublisher_
Free space publisher.
ros::Publisher occupiedPublisher_
Occupied space publisher.
ros::Subscriber gridmapSubscriber_
Grid map subscriber.
ros::Publisher pointcloudPublisher_
Pointcloud publisher.