11 #include <sensor_msgs/PointCloud2.h> 14 namespace gm = ::grid_map::grid_map_pcl;
19 PointCloud::Ptr cloud(
new pcl::PointCloud<pcl::PointXYZ>);
21 cloud->header.frame_id = frame;
22 sensor_msgs::PointCloud2 msg;
24 ROS_INFO_STREAM(
"Publishing loaded cloud, number of points: " << cloud->points.size());
30 ros::init(argc, argv,
"point_cloud_pub_node");
34 const std::string cloudFrame = nh.
param<std::string>(
"cloud_frame",
"");
std::string getPcdFilePath(const ros::NodeHandle &nh)
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
void publishCloud(const std::string &filename, const ros::Publisher &pub, const std::string &frame)
bool param(const std::string ¶m_name, T ¶m_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)
#define ROS_INFO_STREAM(args)
void toROSMsg(const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image)