pointcloud_publisher_node.cpp
Go to the documentation of this file.
1 /*
2  * pointcloud_publisher_node.cpp
3  *
4  * Created on: Aug 19, 2021
5  * Author: Edo Jelavic
6  * Institute: ETH Zurich, Robotic Systems Lab
7  */
8 
10 #include <ros/ros.h>
11 #include <sensor_msgs/PointCloud2.h>
12 #include "grid_map_pcl/helpers.hpp"
13 
14 namespace gm = ::grid_map::grid_map_pcl;
15 using Point = ::pcl::PointXYZ;
16 using PointCloud = ::pcl::PointCloud<Point>;
17 
18 void publishCloud(const std::string& filename, const ros::Publisher& pub, const std::string& frame) {
19  PointCloud::Ptr cloud(new pcl::PointCloud<pcl::PointXYZ>);
20  cloud = gm::loadPointcloudFromPcd(filename);
21  cloud->header.frame_id = frame;
22  sensor_msgs::PointCloud2 msg;
23  pcl::toROSMsg(*cloud, msg);
24  ROS_INFO_STREAM("Publishing loaded cloud, number of points: " << cloud->points.size());
25  msg.header.stamp = ros::Time::now();
26  pub.publish(msg);
27 }
28 
29 int main(int argc, char** argv) {
30  ros::init(argc, argv, "point_cloud_pub_node");
31  ros::NodeHandle nh("~");
32 
33  const std::string pathToCloud = gm::getPcdFilePath(nh);
34  const std::string cloudFrame = nh.param<std::string>("cloud_frame", "");
35  // publish cloud
36  ros::Publisher cloudPub = nh.advertise<sensor_msgs::PointCloud2>("raw_pointcloud", 1, true);
37  publishCloud(pathToCloud, cloudPub, cloudFrame);
38 
39  // run
40  ros::spin();
41  return EXIT_SUCCESS;
42 }
std::string getPcdFilePath(const ros::NodeHandle &nh)
Definition: helpers.cpp:58
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
sensor_msgs::PointCloud2 PointCloud
tf::Vector3 Point
int argc
void publishCloud(const std::string &filename, const ros::Publisher &pub, const std::string &frame)
bool param(const std::string &param_name, T &param_val, const T &default_val) const
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
Pointcloud::Ptr loadPointcloudFromPcd(const std::string &filename)
Definition: helpers.cpp:150
ROSCPP_DECL void spin()
char ** argv
#define ROS_INFO_STREAM(args)
void toROSMsg(const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image)
static Time now()


grid_map_pcl
Author(s): Dominic Jud , Edo Jelavic
autogenerated on Wed Jul 5 2023 02:23:51