• 大小: 3KB
    文件类型: .cpp
    金币: 1
    下载: 0 次
    发布日期: 2021-06-04
  • 语言: C/C++
  • 标签: PCL  ICP  点云  配准  匹配  

资源简介

读取两幅RGBD图像,转换至点云类型利用迭代最近点ICP算法执行点云配准与匹配

资源截图

代码片段和文件信息

#include 
#include 
#include 
#include 
#include 
#include 
#include 
#include 
#include 
#include 

using namespace std;

const double camera_factor=1000;
const double camera_cx=325.5;
const double camera_cy=253.5;
const double camera_fx=518.0;
const double camera_fy=519.0;


int main(int argc char **argv)
{
  ros::init(argc argv “img2join“);
  ros::NodeHandle nh;

  ros::Publisher pub=nh.advertise(“img_join“1);

  cv::Mat rgbdepth;
  rgb=cv::imread(“/home/qy/dev/qtcatkin_cam/src/plc/data/rgb/1.png“);
  depth=cv::imread(“/home/qy/dev/qtcatkin_cam/src/plc/data/depth/1.png“-1);
  cv::imshow(“aa“rgb);
  cv::waitKey(30);
  sensor_msgs::PointCloud2 out;
  pcl::PointCloud cloud1;
  pcl::PointCloud cloud2;
  pcl::PointCloud cloud3;

  // 遍历深度图
  for (int m = 0; m < depth.rows; m++)
      for (int n=0; n < depth.cols; n++)
      {
          // 获取深度图中(mn)处的值
          ushort d = depth.ptr(m)[n];
          // d 可能没有值,若如此,跳过此点
          

评论

共有 条评论