版權說明:本文檔由用戶提供并上傳,收益歸屬內(nèi)容提供方,若內(nèi)容存在侵權,請進行舉報或認領
文檔簡介
機器人操作系統(tǒng)(ROS2)入門與實踐機器人操作系統(tǒng)(ROS2)入門與實踐第1章LinuxUbuntu入門基礎第2章ROS2安裝與系統(tǒng)架構(gòu)第3章ROS2編程基礎第4章ROS2機器人運動控制第5章激光雷達在ROS2中的使用第6章IMU在ROS2中的使用第7章ROS2中的SLAM環(huán)境建圖第8章ROS2中的NAV2自主導航第9章ROS2中的圖像視覺應用第10章ROS2的三維視覺應用第11章ROS2的機械臂應用第12章基于ROS2的綜合應用第10章10.2使用PCL進行物品檢測
10.1RGB-D相機的三維點云數(shù)據(jù)獲取10.3本章小結(jié)第10章ROS2的三維視覺應用
三維點云數(shù)據(jù)的獲取是通過訂閱三維相機驅(qū)動節(jié)點發(fā)布的話題,從話題中獲取相機發(fā)出的消息包來實現(xiàn)的。本實驗中,使用的虛擬機器人配備的是KinectV2相機,話題名稱是"/kinect2/sd/points"。話題中的消息包格式為sensor_msgs::PointCloud2。本實驗將會實現(xiàn)一個訂閱者節(jié)點,訂閱相機發(fā)布的話題"/kinect2/sd/points"。從此話題中接收sensor_msgs::PointCloud2類型的消息包,并將其中的點云數(shù)據(jù)轉(zhuǎn)換成PCL的格式,然后把所有三維點的坐標值顯示在終端程序里。10.1RGB-D相機的三維點云數(shù)據(jù)獲取10.1RGB-D相機的三維點云數(shù)據(jù)獲取
詳細操作步驟見教材P329-P338頁1、編寫節(jié)點代碼在VSCode中找到pc_pkg軟件包,在
“src”文件夾新建文件,命名為“pc_data.cpp”。10.1RGB-D相機的三維點云數(shù)據(jù)獲取10.1.1編寫點云數(shù)據(jù)獲取程序打開一個新的終端窗口,在工作空間中創(chuàng)建一個新的軟件包。cd~/ros2_ws/srcros2pkgcreatepc_pkg#include<rclcpp/rclcpp.hpp>#include<sensor_msgs/msg/point_cloud2.hpp>#include<pcl/point_types.h>#include<pcl/point_cloud.h>#include<pcl_conversions/pcl_conversions.h>
std::shared_ptr<rclcpp::Node>node;
voidPointcloudCallback(constsensor_msgs::msg::PointCloud2::SharedPtrmsg){pcl::PointCloud<pcl::PointXYZ>pointCloudIn;pcl::fromROSMsg(*msg,pointCloudIn);
intcloudSize=pointCloudIn.points.size();for(inti=0;i<cloudSize;i++){RCLCPP_INFO(node->get_logger(),"[i=%d](%.2f,%.2f,%.2f)",i,pointCloudIn.points[i].x,pointCloudIn.points[i].y,pointCloudIn.points[i].z);}}10.1RGB-D相機的三維點云數(shù)據(jù)獲取intmain(intargc,char**argv){rclcpp::init(argc,argv);
node=std::make_shared<rclcpp::Node>("pointcloud_data_node");autopc_sub=node->create_subscription<sensor_msgs::msg::PointCloud2>("/kinect2/sd/points",1,PointcloudCallback);
rclcpp::spin(node);
rclcpp::shutdown();
return0;}10.1RGB-D相機的三維點云數(shù)據(jù)獲取2、設置編譯規(guī)則find_package(rclcppREQUIRED)find_package(sensor_msgsREQUIRED)find_package(pcl_conversionsREQUIRED)find_package(pcl_rosREQUIRED)add_executable(pc_datasrc/pc_data.cpp)ament_target_dependencies(pc_data"rclcpp""sensor_msgs""pcl_conversions""pcl_ros")install(TARGETSpc_dataDESTINATIONlib/${PROJECT_NAME})3、修改軟件包信息<depend>rclcpp</depend><depend>sensor_msgs</depend><depend>pcl_conversions</depend><depend>pcl_ros</depend>10.1RGB-D相機的三維點云數(shù)據(jù)獲取sourceinstall/setup.bashros2launchwpr_simulation2wpb_table.launch.py10.1RGB-D相機的三維點云數(shù)據(jù)獲取4、編譯軟件包cd~/ros2_wscolconbuild10.1.2仿真運行點云數(shù)據(jù)獲取程序sourceinstall/setup.bashros2runpc_pkgpc_data打開第2個子窗口。10.1RGB-D相機的三維點云數(shù)據(jù)獲取
在10.1節(jié)的實驗里,實現(xiàn)了從ROS機器人頭部的RGB-D相機獲取三維點云數(shù)據(jù)。這一次將繼續(xù)深入,使用PCL實現(xiàn)三維特征提取,并對桌面上的物體進行檢測和定位。
具體實現(xiàn)步驟如下:1)將機器人頭部相機采集到的三維點云消息包進行格式轉(zhuǎn)換。從ROS2的點云格式轉(zhuǎn)換為PCL點云格式,方便后面調(diào)用PCL的函數(shù)對點云數(shù)據(jù)進行處理。2)先使用PCL函數(shù)對點云數(shù)據(jù)進行平面提取,將桌面的高度確定下來。3)將桌面高度以下的點集剔除掉,僅保留桌面之上的物體點云。4)使用歐幾里德分割法對保留下來的物體點云進行點云簇的提取,將桌面上的多個相隔較遠的點云簇區(qū)分開。這時可以認為每個點云簇就表示一個物體的點云集合。計算每個物體點云集合的質(zhì)心坐標,用來表示物體的空間位置。10.2使用PCL進行物品檢測
詳細操作步驟見教材P339-P356頁1、編寫節(jié)點代碼在VSCode中找到pc_pkg軟件包,在
“src”文件夾中新建文件,命名為“pc_objects.cpp”。10.2使用PCL進行物品檢測10.2.1編寫物品檢測程序下面編寫這個代碼文件內(nèi)容:#include<rclcpp/rclcpp.hpp>#include<sensor_msgs/msg/point_cloud2.hpp>#include<pcl/point_types.h>#include<pcl/point_cloud.h>#include<pcl_conversions/pcl_conversions.h>#include<tf2_ros/transform_listener.h>#include<pcl_ros/transforms.hpp>#include<pcl/filters/passthrough.h>#include<pcl/segmentation/sac_segmentation.h>#include<pcl/search/kdtree.h>#include<pcl/segmentation/extract_clusters.h>
std::shared_ptr<rclcpp::Node>node;tf2_ros::Buffer::SharedPtrtf_buffer_;std::shared_ptr<tf2_ros::TransformListener>tf_listener_;10.2使用PCL進行物品檢測voidPointcloudCallback(constsensor_msgs::msg::PointCloud2::SharedPtrmsg){boolresult=tf_buffer_->canTransform("base_footprint",msg->header.frame_id,msg->header.stamp);if(!result){return;}sensor_msgs::msg::PointCloud2pc_footprint;pcl_ros::transformPointCloud("base_footprint",*msg,pc_footprint,*tf_buffer_);10.2使用PCL進行物品檢測pcl::PointCloud<pcl::PointXYZ>cloud_src;pcl::fromROSMsg(pc_footprint,cloud_src);
pcl::PassThrough<pcl::PointXYZ>pass;pass.setInputCloud(cloud_src.makeShared());pass.setFilterFieldName("x");pass.setFilterLimits(0.5,1.5);pass.filter(cloud_src);pass.setInputCloud(cloud_src.makeShared());pass.setFilterFieldName("y");pass.setFilterLimits(-0.5,0.5);pass.filter(cloud_src);pass.setInputCloud(cloud_src.makeShared());pass.setFilterFieldName("z");pass.setFilterLimits(0.5,1.5);pass.filter(cloud_src);10.2使用PCL進行物品檢測pcl::ModelCoefficients::Ptrcoefficients(newpcl::ModelCoefficients);pcl::SACSegmentation<pcl::PointXYZ>segmentation;segmentation.setInputCloud(cloud_src.makeShared());segmentation.setModelType(pcl::SACMODEL_PLANE);segmentation.setMethodType(pcl::SAC_RANSAC);segmentation.setDistanceThreshold(0.05);segmentation.setOptimizeCoefficients(true);pcl::PointIndices::PtrplaneIndices(newpcl::PointIndices);segmentation.segment(*planeIndices,*coefficients);intpoint_num=planeIndices->indices.size();floatpoints_z_sum=0;for(inti=0;i<point_num;i++){intpoint_index=planeIndices->indices[i];points_z_sum+=cloud_src.points[point_index].z;}10.2使用PCL進行物品檢測floatplane_height=points_z_sum/point_num;RCLCPP_INFO(node->get_logger(),"plane_height=%.2f",plane_height);
pass.setInputCloud(cloud_src.makeShared());pass.setFilterFieldName("z");pass.setFilterLimits(plane_height+0.2,1.5);pass.filter(cloud_src);
pcl::search::KdTree<pcl::PointXYZ>::Ptrtree(newpcl::search::KdTree<pcl::PointXYZ>);tree->setInputCloud(cloud_src.makeShared());
pcl::EuclideanClusterExtraction<pcl::PointXYZ>ec;ec.setInputCloud(cloud_src.makeShared());ec.setMinClusterSize(100);ec.setMaxClusterSize(25000);ec.setClusterTolerance(0.1);ec.setSearchMethod(tree);std::vector<pcl::PointIndices>cluster_indices;ec.extract(cluster_indices);intobject_num=cluster_indices.size();10.2使用PCL進行物品檢測RCLCPP_INFO(node->get_logger(),"object_num=%d",object_num);for(inti=0;i<object_num;i++){intpoint_num=cluster_indices[i].indices.size();floatpoints_x_sum=0;floatpoints_y_sum=0;floatpoints_z_sum=0;for(intj=0;j<point_num;j++){intpoint_index=cluster_indices[i].indices[j];points_x_sum+=cloud_src.points[point_index].x;points_y_sum+=cloud_src.points[point_index].y;points_z_sum+=cloud_src.points[point_index].z;}floatobject_x=points_x_sum/point_num;floatobject_y=points_y_sum/point_num;floatobject_z=points_z_sum/point_num;RCLCPP_INFO(node->get_logger(),"object%dpos=(%.2f,%.2f,%.2f)",i,object_x,object_y,object_z);}RCLCPP_INFO(node->get_logger(),"---------------------");}10.2使用PCL進行物品檢測intmain(intargc,char**argv){rclcpp::init(argc,argv);
node=std::make_shared<rclcpp::Node>("pointcloud_objects_node");
tf_buffer_=std::make_shared<tf2_ros::Buffer>(node->get_clock());tf_listener_=std::make_shared<tf2_ros::TransformListener>(*tf_buffer_);
autopc_sub=node->create_subscription<sensor_msgs::msg::PointCloud2>("/kinect2/sd/points",1,PointcloudCallback);
rclcpp::spin(node);
rclcpp::shutdown();
return0;}10.2使用PCL進行物品檢測2、設置編譯規(guī)則find_package(rclcppREQUIRED)find_package(sensor_msgsREQUIRED)find_package(pcl_conversionsREQUIRED)f
溫馨提示
- 1. 本站所有資源如無特殊說明,都需要本地電腦安裝OFFICE2007和PDF閱讀器。圖紙軟件為CAD,CAXA,PROE,UG,SolidWorks等.壓縮文件請下載最新的WinRAR軟件解壓。
- 2. 本站的文檔不包含任何第三方提供的附件圖紙等,如果需要附件,請聯(lián)系上傳者。文件的所有權益歸上傳用戶所有。
- 3. 本站RAR壓縮包中若帶圖紙,網(wǎng)頁內(nèi)容里面會有圖紙預覽,若沒有圖紙預覽就沒有圖紙。
- 4. 未經(jīng)權益所有人同意不得將文件中的內(nèi)容挪作商業(yè)或盈利用途。
- 5. 人人文庫網(wǎng)僅提供信息存儲空間,僅對用戶上傳內(nèi)容的表現(xiàn)方式做保護處理,對用戶上傳分享的文檔內(nèi)容本身不做任何修改或編輯,并不能對任何下載內(nèi)容負責。
- 6. 下載文件中如有侵權或不適當內(nèi)容,請與我們聯(lián)系,我們立即糾正。
- 7. 本站不保證下載資源的準確性、安全性和完整性, 同時也不承擔用戶因使用這些下載資源對自己和他人造成任何形式的傷害或損失。
最新文檔
- 2024年度個人及配偶共同借款合同5篇
- 2024年度西安商鋪合同糾紛調(diào)解協(xié)議3篇
- 2024版房產(chǎn)租賃意向金合同6篇
- 2024版水電安裝工程承包合同(含技術服務)2篇
- 福建省永安市第三中學2025屆高考壓軸卷英語試卷含解析
- 2025屆山東省棗莊、滕州市高考適應性考試英語試卷含解析2
- 2025屆河南省夏邑高三壓軸卷英語試卷含解析
- 山東省東明縣一中2025屆高考英語五模試卷含解析
- 2025屆河北省保定市阜平中學高考數(shù)學押題試卷含解析
- 2025屆廣東省深圳市南山區(qū)南頭中學高考考前提分數(shù)學仿真卷含解析
- 員工更替計劃
- 初三期末考試動員班會 (2)課件
- 抖音小店數(shù)據(jù)分析怎么做
- PFMEA制作指南課件
- 提高患者滿意度的導醫(yī)接待工作方法
- 皮膚美容與整形技術的新進展
- 《柔性生產(chǎn)方式》課件
- 單位員工餐廳整體保障服務方案
- 中國旗袍課件
- 銷售線索培訓課件
- 一例胸痹病人的護理查房
評論
0/150
提交評論