12 #include <sensor_msgs/PointCloud2.h> 32 ROS_INFO(
"FlatPointCloudVisualization with name '%s' did not find a 'height' parameter. Using default.",
name_.c_str());
47 sensor_msgs::PointCloud2 pointCloud;
bool readParameters(XmlRpc::XmlRpcValue &config)
void publish(const boost::shared_ptr< M > &message) const
virtual ~FlatPointCloudVisualization()
static void toPointCloud(const grid_map::GridMap &gridMap, const std::string &pointLayer, sensor_msgs::PointCloud2 &pointCloud)
bool getParam(const std::string &name, std::string &value)
FlatPointCloudVisualization(ros::NodeHandle &nodeHandle, const std::string &name)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
double height_
Height of the z-coordinate at which the flat point cloud is visualized.
void add(const std::string &layer, const double value=NAN)
ros::NodeHandle & nodeHandle_
ROS nodehandle.
std::string name_
Name of the visualization.
ros::Publisher publisher_
ROS publisher of the occupancy grid.
bool visualize(const grid_map::GridMap &map)
virtual bool readParameters(XmlRpc::XmlRpcValue &config)