详细步骤:
1.新建工作空间并初始化
mkdir -p ~/point_ws/src
cd point_ws/src
catkin_init_workspace
2.在src中新建文件夹my_pcl
3.point_ws中包含的内容:
3.1include文件夹——My_Filter.h
3.2src文件夹——My_Filter.cpp、my_pcl_node.cpp、CMakeLists.txt(初始化的即可)
3.3CMakeLists.txt(自己写的)
3.4my_pcl.launch
3.5package.xml
3.6my_pcl_node(编译结束后复制过来的)*
具体如下:
3.1.My_Filter.h
#include <iostream>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <laser_geometry/laser_geometry.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/LaserScan.h>
#include <pcl_conversions/pcl_conversions.h>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/io/pcd_io.h>
class My_Filter {
public:
My_Filter();
//订阅 LaserScan 数据,并发布 PointCloud2 点云
void scanCallback(const sensor_msgs::LaserScan::ConstPtr& lidar2Dscan);
//订阅 LaserScan 数据,先转换为 PointCloud2,再转换为 pcl::PointCloud
void scanCallback_2(const sensor_msgs::LaserScan::ConstPtr& lidar2Dscan);
//直接订阅 PointCloud2 然后自动转换为 pcl::PointCloud
void pclCloudCallback(const pcl::PointCloud<pcl::PointXYZ>::ConstPtr& cloud);
private:
ros::NodeHandle node_;
laser_geometry::LaserProjection projector_;
tf::TransformListener tfListener_;
//发布 "PointCloud2"
ros::Publisher point_cloud_publisher_;
//订阅 "/scan"
ros::Subscriber scan_sub_;
//订阅 "/cloud2" -> "PointCloud2"
ros::Subscriber pclCloud_sub_;
};
3.2.1.My_Filter.cpp
#include "My_Filter.h"
My_Filter::My_Filter(){
//scan_sub_ = node_.subscribe<sensor_msgs::LaserScan> ("/scan", 100, &My_Filter::scanCallback, this);
//订阅 "/scan"
scan_sub_ = node_.subscribe<sensor_msgs::LaserScan> ("/lidar2Dscan", 100, &My_Filter::scanCallback_2, this);
//发布LaserScan转换为PointCloud2的后的数据
point_cloud_publisher_ = node_.advertise<sensor_msgs::PointCloud2> ("/cloud2", 100, false);
//此处的tf是 laser_geometry 要用到的
tfListener_.setExtrapolationLimit(ros::Duration(0.1));
//前面提到的通过订阅PointCloud2,直接转化为pcl::PointCloud的方式
pclCloud_sub_ = node_.subscribe<pcl::PointCloud<pcl::PointXYZ> >("/cloud2", 10, &My_Filter::pclCloudCallback, this);
}
void My_Filter::scanCallback(const sensor_msgs::LaserScan::ConstPtr& lidar2Dscan){
sensor_msgs::PointCloud2 cloud;
projector_.transformLaserScanToPointCloud("2Dlidar_link", *lidar2Dscan, cloud, tfListener_);
point_cloud_publisher_.publish(cloud);
}
void My_Filter::scanCallback_2(const sensor_msgs::LaserScan::ConstPtr& lidar2Dscan){
sensor_msgs::PointCloud2 cloud;
/*laser_geometry包中函数,将 sensor_msgs::LaserScan 转换为 sensor_msgs::PointCloud2 */
//普通转换
//projector_.projectLaser(*scan, cloud);
//使用tf的转换
projector_.transformLaserScanToPointCloud("2Dlidar_link", *lidar2Dscan, cloud, tfListener_);
int row_step = cloud.row_step;
int height = cloud.height;
/*将 sensor_msgs::PointCloud2 转换为 pcl::PointCloud<T> */
//注意要用fromROSMsg函数需要引入pcl_versions(见头文件定义)
pcl::PointCloud<pcl::PointXYZ> rawCloud;
pcl::fromROSMsg(cloud, rawCloud);
for(size_t i = 0; i < rawCloud.points.size(); i++){
std::cout<<rawCloud.points[i].x<<"\t"<<rawCloud.points[i].y<<"\t"<<rawCloud.points[i].z<<std::endl;
}
point_cloud_publisher_.publish(cloud);
}
void My_Filter::pclCloudCallback(const pcl::PointCloud<pcl::PointXYZ>::ConstPtr& cloud){
for(size_t i = 0; i < cloud->points.size(); i++){
std::cout<<"direct_trans: "<<cloud->points[i].x<<"\t"<<cloud->points[i].y<<"\t"<<cloud->points[i].z<<std::endl;
}
}
3.2.2.my_pcl_node.cpp
#include "My_Filter.h"
int main(int argc, char** argv)
{
ros::init(argc, argv, "my_pcl_node");
My_Filter filter;
ros::spin();
return 0;
}
3.3.my_pcl中的CMakeLists.txt
cmake_minimum_required(VERSION 2.8.3)
project(my_pcl)
find_package(catkin REQUIRED COMPONENTS
laser_geometry
pcl_conversions
pcl_ros
roscpp
rospy
sensor_msgs
tf
)
find_package(PCL 1.7 REQUIRED)
catkin_package(
INCLUDE_DIRS include
CATKIN_DEPENDS roscpp sensor_msgs pcl_ros laser_geometry pcl_conversions rospy tf libpcl-all
)
include_directories(
include
${catkin_INCLUDE_DIRS}
)
link_directories(${PCL_LIBRARY_DIRS})
add_executable(${PROJECT_NAME}_node src/My_Filter.cpp src/my_pcl_node.cpp)
target_link_libraries(${PROJECT_NAME}_node
${catkin_LIBRARIES}
${PCL_LIBRARIES}
)
3.4.my_pcl中的my_pcl.launch
<launch>
<node pkg="my_pcl" type="my_pcl_node" name="my_pcl_node" output="screen"/>
</launch>
3.5.my_pcl中的package.xml
<?xml version="1.0"?>
<package format="2">
<name>my_pcl</name>
<version>0.0.0</version>
<description>The my_pcl package</description>
<!-- One maintainer tag required, multiple allowed, one person per tag -->
<!-- Example: -->
<!-- <maintainer email="jane.doe@example.com">Jane Doe</maintainer> -->
<maintainer email="yyz@todo.todo">yyz</maintainer>
<!-- One license tag required, multiple allowed, one license per tag -->
<!-- Commonly used license strings: -->
<!-- BSD, MIT, Boost Software License, GPLv2, GPLv3, LGPLv2.1, LGPLv3 -->
<license>TODO</license>
<!-- Url tags are optional, but multiple are allowed, one per tag -->
<!-- Optional attribute type can be: website, bugtracker, or repository -->
<!-- Example: -->
<!-- <url type="website">http://wiki.ros.org/my_pcl</url> -->
<!-- Author tags are optional, multiple are allowed, one per tag -->
<!-- Authors do not have to be maintainers, but could be -->
<!-- Example: -->
<!-- <author email="jane.doe@example.com">Jane Doe</author> -->
<!-- The *depend tags are used to specify dependencies -->
<!-- Dependencies can be catkin packages or system dependencies -->
<!-- Examples: -->
<!-- Use depend as a shortcut for packages that are both build and exec dependencies -->
<!-- <depend>roscpp</depend> -->
<!-- Note that this is equivalent to the following: -->
<!-- <build_depend>roscpp</build_depend> -->
<!-- <exec_depend>roscpp</exec_depend> -->
<!-- Use build_depend for packages you need at compile time: -->
<!-- <build_depend>message_generation</build_depend> -->
<!-- Use build_export_depend for packages you need in order to build against this package: -->
<!-- <build_export_depend>message_generation</build_export_depend> -->
<!-- Use buildtool_depend for build tool packages: -->
<!-- <buildtool_depend>catkin</buildtool_depend> -->
<!-- Use exec_depend for packages you need at runtime: -->
<!-- <exec_depend>message_runtime</exec_depend> -->
<!-- Use test_depend for packages you need only for testing: -->
<!-- <test_depend>gtest</test_depend> -->
<!-- Use doc_depend for packages you need only for building documentation: -->
<!-- <doc_depend>doxygen</doc_depend> -->
<buildtool_depend>catkin</buildtool_depend>
<build_depend>laser_geometry</build_depend>
<build_depend>pcl_conversions</build_depend>
<build_depend>pcl_ros</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>rospy</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>tf</build_depend>
<build_export_depend>laser_geometry</build_export_depend>
<build_export_depend>pcl_conversions</build_export_depend>
<build_export_depend>pcl_ros</build_export_depend>
<build_export_depend>roscpp</build_export_depend>
<build_export_depend>rospy</build_export_depend>
<build_export_depend>sensor_msgs</build_export_depend>
<build_export_depend>tf</build_export_depend>
<exec_depend>laser_geometry</exec_depend>
<exec_depend>pcl_conversions</exec_depend>
<exec_depend>pcl_ros</exec_depend>
<exec_depend>roscpp</exec_depend>
<exec_depend>rospy</exec_depend>
<exec_depend>sensor_msgs</exec_depend>
<exec_depend>tf</exec_depend>
<build_depend>libpcl-all-dev</build_depend>
<exec_depend>libpcl-all</exec_depend>
<!-- The export tag contains other, unspecified, tags -->
<export>
<!-- Other tools can request additional information be placed here -->
</export>
</package>
4.回到point_ws目录下,用catkin_make编译,之后配置环境gedit ~/.bashrc
。
source /home/yyz/point_ws/build/devel/setup.bash
export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:/home/yyz/point_ws/src
5.运行
roslaunch my_pcl my_pcl_node
但一直提示找不到这个节点,干脆去devel/lib/my_pcl路径下把这个节点文件复制到my_pcl文件夹中了,再次运行,成功!
参考链接:https://blog.csdn.net/qq_42780025/article/details/108451593