活动介绍
file-type

点云注册技术实践:Python实现ICP算法教程

ZIP文件

下载需积分: 50 | 13.5MB | 更新于2024-11-25 | 96 浏览量 | 3 评论 | 1 下载量 举报 收藏
download 立即下载
" 1. 点云注册概念: 点云注册是指将两个或多个来自同一场景但采集位置或时间不同的点云数据集对齐的过程。点云数据集通常是通过激光扫描仪(如3D LIDAR)获得的一系列三维点的集合,它们反映了物体或场景表面的几何结构。点云注册的目的是为了使不同时间或视角下采集的点云数据能够匹配起来,从而得到更完整、更准确的三维模型。 2. 点云注册操作说明: 操作步骤涉及到提取压缩包文件,具体步骤如下: a. 首先,需要将下载得到的压缩包文件"point_cloud_registration.rar"解压到当前工作目录中。 b. 然后,在终端中切换到解压后的程序目录。 c. 在程序目录中打开终端,输入"python main.py"来运行点云注册程序。 3. 点云注册输入输出: 输入:程序需要两个点云数据文件作为输入,这两个点云数据应当来自同一场景,但位置或者采集时间有所不同。 输出:程序的输出是转换矩阵,这个矩阵能够描述点云1与点云2之间的对齐关系,即如何通过空间变换将点云1的位置变换到与点云2对齐的位置。 4. 目标与应用: 本资源的目标是通过点云注册的过程,使得用户能够熟悉地理参考的3D LIDAR点云数据,并在实际应用中对地面移动地图进行操作。这通常涉及到城市规划、地形测绘、机器人导航等领域。 5. ICP算法: 点云注册中的实践ICP算法,即迭代最近点(Iterative Closest Point)算法,是一种常用的点云配准算法。该算法的目标是减少两个点云之间的距离,找到最合理的空间变换(旋转和平移),以实现点云之间的最佳对齐。ICP算法包括以下步骤: a. 为每个点云中的点匹配最近的点。 b. 计算匹配点对之间的误差。 c. 计算误差最小化所需的变换(通过最小二乘法)。 d. 应用变换,更新点云位置。 e. 重复以上步骤直到收敛。 6. 技术栈: 从标签"Python"可以得知,该点云注册程序是使用Python编程语言开发的。Python在科学计算、数据分析和机器学习等领域有着广泛的应用,其具有丰富的库和框架支持,例如NumPy和SciPy用于数值计算,Pandas用于数据分析,以及Open3D等库用于点云数据处理,使得处理点云数据变得更加方便高效。 7. 环境依赖: 在进行点云注册之前,需要确保安装了Python环境以及相关的依赖库。具体包括: a. Python环境:确保Python版本满足程序运行的要求。 b. 库依赖:可能需要安装特定的Python库,例如numpy、scipy、pandas、open3d等,以便于处理点云数据和执行数学计算。 c. 其他依赖:根据实际代码实现,可能还需要安装其他软件或工具包。 通过以上内容,可以了解到点云注册的基本概念、操作步骤、输入输出要求、目标应用以及ICP算法的原理和应用。这为进一步深入学习和掌握点云处理与注册技术奠定了基础。

相关推荐

filetype

vs中主程序调用#include <iostream> #include <pcl/io/pcd_io.h> #include <pcl/point_types.h> #include <pcl/registration/gicp.h> #include <pcl/visualization/pcl_visualizer.h> #include <boost/thread/thread.hpp> #include <pcl/console/time.h> // 利用控制台计算时间 using namespace std; int main() { pcl::console::TicToc time; // -----------------加载点云数据--------------------------- pcl::PointCloud<pcl::PointXYZ>::Ptr target(new pcl::PointCloud<pcl::PointXYZ>); pcl::io::loadPCDFile<pcl::PointXYZ>("dragon2.pcd", *target); pcl::PointCloud<pcl::PointXYZ>::Ptr source(new pcl::PointCloud<pcl::PointXYZ>); pcl::io::loadPCDFile<pcl::PointXYZ>("dragon1.pcd", *source); time.tic(); //-----------------初始化GICP对象------------------------- pcl::GeneralizedIterativeClosestPoint<pcl::PointXYZ, pcl::PointXYZ> gicp; //-----------------KD树加速搜索--------------------------- pcl::search::KdTree<pcl::PointXYZ>::Ptr tree1(new pcl::search::KdTree<pcl::PointXYZ>); tree1->setInputCloud(source); pcl::search::KdTree<pcl::PointXYZ>::Ptr tree2(new pcl::search::KdTree<pcl::PointXYZ>); tree2->setInputCloud(target); gicp.setSearchMethodSource(tree1); gicp.setSearchMethodTarget(tree2); //-----------------设置GICP相关参数----------------------- gicp.setInputSource(source); //源点云 gicp.setInputTarget(target); //目标点云 gicp.setMaxCorrespondenceDistance(10); //设置对应点对之间的最大距离 gicp.setTransformationEpsilon(1e-10); //为终止条件设置最小转换差异 /* gicp.setSourceCovariances(source_covariances); gicp.setTargetCovariances(target_covariances);*/ gicp.setEuclideanFitnessEpsilon(0.001); //设置收敛条件是均方误差和小于阈值, 停止迭代 gicp.setMaximumIterations(50); //最大迭代次数 //gicp.setUseReciprocalCorrespondences(true);//使用相互对应关系 // 计算需要的刚体变换以便将输入的源点云匹配到目标点云 pcl::PointCloud<pcl::PointXYZ>::Ptr icp_cloud(new pcl::PointCloud<pcl::PointXYZ>); gicp.align(*icp_cloud); //---------------输出必要信息到显示-------------------- cout << "Applied " << 50 << " GICP iterations in " << time.toc() / 1000 << " s" << endl; cout << "\nGICP has converged, score is " << gicp.getFitnessScore() << endl; cout << "变换矩阵:\n" << gicp.getFinalTransformation() << endl; // 使用变换矩阵对为输入点云进行变换 pcl::transformPointCloud(*source, *icp_cloud, gicp.getFinalTransformation()); //pcl::io::savePCDFileASCII (".pcd", *icp_cloud); // -----------------点云可视化-------------------------- boost::shared_ptr<pcl::visualization::PCLVisualizer> viewer_final(new pcl::visualization::PCLVisualizer("配准结果")); viewer_final->setBackgroundColor(0, 0, 0); //设置背景颜色为黑色 // 对目标点云着色可视化 (red). pcl::visualization::PointCloudColorHandlerCustom<pcl::PointXYZ> target_color(target, 255, 0, 0); viewer_final->addPointCloud<pcl::PointXYZ>(target, target_color, "target cloud"); viewer_final->setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_POINT_SIZE, 1, "target cloud"); // 对源点云着色可视化 (green). pcl::visualization::PointCloudColorHandlerCustom<pcl::PointXYZ> input_color(source, 0, 255, 0); viewer_final->addPointCloud<pcl::PointXYZ>(source, input_color, "input cloud"); viewer_final->setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_POINT_SIZE, 1, "input cloud"); // 对转换后的源点云着色 (blue)可视化. pcl::visualization::PointCloudColorHandlerCustom<pcl::PointXYZ> output_color(icp_cloud, 0, 0, 255); viewer_final->addPointCloud<pcl::PointXYZ>(icp_cloud, output_color, "output cloud"); viewer_final->setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_POINT_SIZE, 1, "output cloud"); while (!viewer_final->wasStopped()) { viewer_final->spinOnce(100); boost::this_thread::sleep(boost::posix_time::microseconds(100000)); } return (0); }加入rmse计算并显示

filetype

i libdapclient6v5:amd64 3.20.5-1 amd64 Client library for the Network Data Access Protocol ii libpcl-apps1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - apps library ii libpcl-common1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - common library ii libpcl-dev 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - development files ii libpcl-features1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - features library ii libpcl-filters1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - filters library ii libpcl-io1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - I/O library ii libpcl-kdtree1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - kdtree library ii libpcl-keypoints1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - keypoints library ii libpcl-ml1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - ml library ii libpcl-octree1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - octree library ii libpcl-outofcore1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - outofcore library ii libpcl-people1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - people library ii libpcl-recognition1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - recognition library ii libpcl-registration1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - registration library ii libpcl-sample-consensus1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - sample consensus library ii libpcl-search1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - search library ii libpcl-segmentation1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - segmentation library ii libpcl-stereo1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - stereo library ii libpcl-surface1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - surface library ii libpcl-tracking1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - tracking library ii libpcl-visualization1.10:amd64 1.10.0+dfsg-5ubuntu1 amd64 Point Cloud Library - visualization library ii ros-noetic-pcl-conversions 1.7.4-1focal.20240913.193412 amd64 Provides conversions from PCL data types and ROS message types ii ros-noetic-pcl-msgs 0.3.0-1focal.20240913.193206 amd64 Package containing PCL (Point Cloud Library)-related ROS messages. ii ros-noetic-pcl-ros

filetype

/* 多源异构点云配准数据的滤波及精度分析 */ #include <pcl/io/pcd_io.h>// 点云文件I/O #include <pcl/surface/mls.h>// 移动最小二乘曲面重建 #include <pcl/point_types.h>// 点类型定义 #include <pcl/filters/voxel_grid.h>// 体素网格下采样 #include <pcl/features/normal_3d_omp.h> // 多线程法线估计 #include <pcl/visualization/pcl_visualizer.h> // 可视化模块 #include <pcl/filters/radius_outlier_removal.h> // 半径离群点移除 #include <pcl/filters/statistical_outlier_removal.h>// 统计离群点移除 using namespace std; int main(int argc, char** argv) { pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_a(new pcl::PointCloud<pcl::PointXYZ>); string path = "D:\\新建文件夹\\点云数据集\\Point Cloud Library Files PCD datasets\\kitchen\\Rf3.pcd"; if (pcl::io::loadPCDFile<pcl::PointXYZ>(path, *cloud_a) == -1) { PCL_ERROR("Couldn't read file test_pcd.pcd \n"); return (-1); } //*******多源异构********** pcl::PointCloud<pcl::PointXYZ>::Ptr cloud1(new pcl::PointCloud<pcl::PointXYZ>); pcl::StatisticalOutlierRemoval<pcl::PointXYZ> sor; sor.setInputCloud(cloud_a); sor.setMeanK(15); // 邻域点数量 sor.setStddevMulThresh(1); // 标准差倍数阈值 sor.filter(*cloud1); // 输出到cloud1,邻域15个点,距离均值超过1倍标准差视为离群点 pcl::PointCloud<pcl::PointXYZ>::Ptr cloud11(new pcl::PointCloud<pcl::PointXYZ>); pcl::VoxelGrid<pcl::PointXYZ> grid; grid.setInputCloud(cloud1); Eigen::Vector4f leaf_size{ 0.08,0.08,0.08,0 }; grid.setLeafSize(leaf_size); grid.filter(*cloud11); pcl::PointCloud<pcl::PointXYZ>::Ptr cloud2(new pcl::PointCloud<pcl::PointXYZ>); pcl::RadiusOutlierRemoval<pcl::PointXYZ> ror; ror.setInputCloud(cloud11); ror.setRadiusSearch(0.1); ror.setMinNeighborsInRadius(1); ror.filter(*cloud2); pcl::search::KdTree<pcl::PointXYZ>::Ptr tree(new pcl::search::KdTree<pcl::PointXYZ>); pcl::PointCloud<pcl::PointNormal>::Ptr mls_points_normal(new pcl::PointCloud<pcl::PointNormal>); pcl::MovingLeastSquares<pcl::PointXYZ, pcl::PointNormal> mls; mls.setInputCloud(cloud2); mls.setComputeNormals(true); // mls.setPolynomialFit(true); mls.setPolynomialOrder(2); // MLS拟合的阶数 mls.setSearchMethod(tree); mls.setSearchRadius(0.3); // 邻域搜索半径 mls.setNumberOfThreads(4); mls.process(*mls_points_normal); cout << "mls poits size is: " << mls_points_normal->size() << endl; pcl::io::savePCDFileASCII("多源异构.pcd", *mls_points_normal); pcl::PointCloud<pcl::PointXYZ>::Ptr cloud3(new pcl::PointCloud<pcl::PointXYZ>); pcl::io::loadPCDFile<pcl::PointXYZ>("多源异构.pcd", *cloud3); // -----------------------------可视化----------------------------------- pcl::visualization::PCLVisualizer viewer("Cloud Viewer"); int v1 = 0; int v2 = 1; viewer.createViewPort(0, 0, 0.5, 1, v1); viewer.createViewPort(0.5, 0, 1, 1, v2); viewer.addPointCloud(cloud_a, "original cloud", v1); viewer.addPointCloud(cloud3, "cloud", v2); viewer.setBackgroundColor(255, 255, 255); viewer.setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_COLOR, 1, 0, 0, "original cloud"); viewer.setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_POINT_SIZE, 4, "original cloud"); viewer.setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_COLOR, 0, 0, 0, "cloud"); viewer.setPointCloudRenderingProperties(pcl::visualization::PCL_VISUALIZER_POINT_SIZE, 4, "cloud"); viewer.spin(); return 0; }详细解释一下这段代码,如有问题,请给出改进意见。

filetype

#include <pcl/io/ply_io.h> #include <pcl/point_types.h> #include <pcl/filters/voxel_grid.h> #include <pcl/registration/icp.h> #include <pcl/visualization/cloud_viewer.h> #include <iostream> #include <memory> int main() { try { // 1. 读取源点云和目标点云 auto source_cloud = std::make_shared<pcl::PointCloud<pcl::PointXYZ>>(); auto target_cloud = std::make_shared<pcl::PointCloud<pcl::PointXYZ>>(); std::string source_path = "C:\\Users\\admin-pc\\Documents\\vscode_projects\\PointCloudRegistration\\data\\link\\link_f.ply"; std::string target_path = "C:\\Users\\admin-pc\\Documents\\vscode_projects\\PointCloudRegistration\\data\\link\\RGBDPoints_20250117084420 copy - Cloud.ply"; if (pcl::io::loadPLYFile(source_path, *source_cloud) == -1 || pcl::io::loadPLYFile(target_path, *target_cloud) == -1) { std::cerr << "Error: Could not load point clouds!" << std::endl; return -1; } if (source_cloud->empty() || target_cloud->empty()) { std::cerr << "Error: One of the point clouds is empty!" << std::endl; return -1; } // 2. 对目标点云进行降采样 auto downsampled_target = std::make_shared<pcl::PointCloud<pcl::PointXYZ>>(); pcl::VoxelGrid<pcl::PointXYZ> voxel_grid; voxel_grid.setInputCloud(target_cloud); voxel_grid.setLeafSize(0.06f, 0.06f, 0.05f); // 增大叶子大小参数 voxel_grid.filter(*downsampled_target); if (downsampled_target->empty()) { std::cerr << "Error: Downsampled target cloud is empty!" << std::endl; return -1; } // 3. 点云配准 pcl::IterativeClosestPoint<pcl::PointXYZ, pcl::PointXYZ> icp; icp.setInputSource(downsampled_target); icp.setInputTarget(source_cloud); pcl::PointCloud<pcl::PointXYZ> aligned_cloud; icp.align(aligned_cloud); if (!icp.hasConverged()) { std::cerr << "ICP failed to converge!" << std::endl; return -1; } // 4. 可视化结果 pcl::visualization::CloudViewer viewer("Cloud Viewer"); viewer.showCloud(source_cloud, "source cloud"); viewer.showCloud(downsampled_target, "target cloud"); viewer.showCloud(aligned_cloud.makeShared(), "aligned cloud"); while (!viewer.wasStopped()) {} } catch (const std::exception& e) { std::cerr << "Exception: " << e.what() << std::endl; return -1; } return 0; }哪个是icp处理后的点云

filetype

#include <iostream> #include <pcl/io/pcd_io.h> #include <pcl/point_types.h> #include <pcl/features/normal_3d_omp.h> // 使用OMP加速法向量计算 #include <pcl/registration/icp_nl.h> // 非线性ICP算法 #include <pcl/visualization/pcl_visualizer.h> #include <boost/thread/thread.hpp> #include <pcl/console/time.h> // 控制台时间计时器 using namespace std; // 计算法线 pcl::PointCloud<pcl::PointNormal>::Ptr compute_normals(pcl::PointCloud<pcl::PointXYZ>::Ptr input_cloud) { pcl::NormalEstimationOMP<pcl::PointXYZ, pcl::Normal> normal_estimator; pcl::PointCloud<pcl::Normal>::Ptr normals(new pcl::PointCloud<pcl::Normal>); pcl::search::KdTree<pcl::PointXYZ>::Ptr tree(new pcl::search::KdTree<pcl::PointXYZ>); normal_estimator.setNumberOfThreads(8); // 使用多线程加速法线计算 normal_estimator.setInputCloud(input_cloud); // 设置输入点云 normal_estimator.setSearchMethod(tree); // 设置 KD 树搜索 normal_estimator.setKSearch(10); // 设置 K 近邻搜索 normal_estimator.compute(*normals); // 计算法线 // 拼接点云数据与法线 pcl::PointCloud<pcl::PointNormal>::Ptr cloud_with_normals(new pcl::PointCloud<pcl::PointNormal>); pcl::concatenateFields(*input_cloud, *normals, *cloud_with_normals); return cloud_with_normals; } // 执行 LM-ICP 配准 void run_lm_icp(pcl::PointCloud<pcl::PointNormal>::Ptr& source_normal, pcl::PointCloud<pcl::PointNormal>::Ptr& target_normal, Eigen::Matrix4f& final_transform, pcl::PointCloud<pcl::PointNormal>::Ptr& icp_cloud) { // 初始化 LM ICP 对象 pcl::IterativeClosestPointNonLinear<pcl::PointNormal, pcl::PointNormal> lm_icp; // 设置 ICP 参数 lm_icp.setInputSource(source_normal); lm_icp.setInputTarget(target_normal); lm_icp.setTransformationEpsilon(1e-10); // 设置最小转换差异 lm_icp.setMaxCorrespondenceDistance(10); // 设置最大对应点距离 lm_icp.setEuclideanFitnessEpsilon(0.001); // 设置均方误差收敛条件 lm_icp.setMaximumIterations(50); // 设置最大迭代次数 // 执行 LM-ICP 配准 lm_icp.align(*icp_cloud); final_transform = lm_icp.getFinalTransformation(); std::cout

filetype

saber@ubuntu:~/fastplanner_ws$ catkin_make Base path: /home/saber/fastplanner_ws Source space: /home/saber/fastplanner_ws/src Build space: /home/saber/fastplanner_ws/build Devel space: /home/saber/fastplanner_ws/devel Install space: /home/saber/fastplanner_ws/install #### #### Running command: "cmake /home/saber/fastplanner_ws/src -DCATKIN_DEVEL_PREFIX=/home/saber/fastplanner_ws/devel -DCMAKE_INSTALL_PREFIX=/home/saber/fastplanner_ws/install -G Unix Makefiles" in "/home/saber/fastplanner_ws/build" #### -- Using CATKIN_DEVEL_PREFIX: /home/saber/fastplanner_ws/devel -- Using CMAKE_PREFIX_PATH: /opt/ros/noetic -- This workspace overlays: /opt/ros/noetic -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- Using PYTHON_EXECUTABLE: /usr/bin/python3 -- Using Debian Python package layout -- Using empy: /usr/lib/python3/dist-packages/em.py -- Using CATKIN_ENABLE_TESTING: ON -- Call enable_testing() -- Using CATKIN_TEST_RESULTS_DIR: /home/saber/fastplanner_ws/build/test_results -- Forcing gtest/gmock from source, though one was otherwise available. -- Found gtest sources under '/usr/src/googletest': gtests will be built -- Found gmock sources under '/usr/src/googletest': gmock will be built -- Found PythonInterp: /usr/bin/python3 (found version "3.8.10") -- Using Python nosetests: /usr/bin/nosetests3 -- catkin 0.8.12 -- BUILD_SHARED_LIBS is on -- BUILD_SHARED_LIBS is on -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- ~~ traversing 20 packages in topological order: -- ~~ - quadrotor_msgs -- ~~ - cmake_utils -- ~~ - map_generator -- ~~ - plan_env -- ~~ - bspline -- ~~ - bspline_opt -- ~~ - path_searching -- ~~ - poly_traj -- ~~ - pose_utils -- ~~ - so3_disturbance_generator -- ~~ - odom_visualization -- ~~ - local_sensing_node -- ~~ - so3_control -- ~~ - multi_map_server -- ~~ - traj_utils -- ~~ - plan_manage -- ~~ - uav_utils -- ~~ - so3_quadrotor_simulator -- ~~ - rviz_plugins -- ~~ - waypoint_generator -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- +++ processing catkin package: 'quadrotor_msgs' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/quadrotor_msgs) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- quadrotor_msgs: 13 messages, 0 services -- +++ processing catkin package: 'cmake_utils' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/cmake_utils) -- +++ processing catkin package: 'map_generator' -- ==> add_subdirectory(Fast-Planner/uav_simulator/map_generator) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- +++ processing catkin package: 'plan_env' -- ==> add_subdirectory(Fast-Planner/fast_planner/plan_env) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- Found PCL: pcl_common;pcl_kdtree;pcl_octree;pcl_search;pcl_sample_consensus;pcl_filters;pcl_io;pcl_features;pcl_ml;pcl_segmentation;pcl_visualization;pcl_surface;pcl_registration;pcl_keypoints;pcl_tracking;pcl_recognition;pcl_stereo;pcl_apps;pcl_outofcore;pcl_people;/usr/lib/x86_64-linux-gnu/libboost_system.so;/usr/lib/x86_64-linux-gnu/libboost_filesystem.so;/usr/lib/x86_64-linux-gnu/libboost_date_time.so;/usr/lib/x86_64-linux-gnu/libboost_iostreams.so;/usr/lib/x86_64-linux-gnu/libboost_regex.so;optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so;/usr/lib/libOpenNI.so;/usr/lib/libOpenNI2.so;vtkChartsCore;vtkCommonColor;vtkCommonCore;vtksys;vtkCommonDataModel;vtkCommonMath;vtkCommonMisc;vtkCommonSystem;vtkCommonTransforms;vtkCommonExecutionModel;vtkFiltersGeneral;vtkCommonComputationalGeometry;vtkFiltersCore;vtkInfovisCore;vtkFiltersExtraction;vtkFiltersStatistics;vtkImagingFourier;vtkImagingCore;vtkalglib;vtkRenderingContext2D;vtkRenderingCore;vtkFiltersGeometry;vtkFiltersSources;vtkRenderingFreeType;/usr/lib/x86_64-linux-gnu/libfreetype.so;/usr/lib/x86_64-linux-gnu/libz.so;vtkFiltersModeling;vtkImagingSources;vtkInteractionStyle;vtkInteractionWidgets;vtkFiltersHybrid;vtkImagingColor;vtkImagingGeneral;vtkImagingHybrid;vtkIOImage;vtkDICOMParser;vtkmetaio;/usr/lib/x86_64-linux-gnu/libjpeg.so;/usr/lib/x86_64-linux-gnu/libpng.so;/usr/lib/x86_64-linux-gnu/libtiff.so;vtkRenderingAnnotation;vtkRenderingVolume;vtkIOXML;vtkIOCore;vtkIOXMLParser;/usr/lib/x86_64-linux-gnu/libexpat.so;vtkIOGeometry;vtkIOLegacy;vtkIOPLY;vtkRenderingLOD;vtkViewsContext2D;vtkViewsCore;vtkRenderingContextOpenGL2;vtkRenderingOpenGL2;FLANN::FLANN (Required is at least version "1.7") -- +++ processing catkin package: 'bspline' -- ==> add_subdirectory(Fast-Planner/fast_planner/bspline) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- +++ processing catkin package: 'bspline_opt' -- ==> add_subdirectory(Fast-Planner/fast_planner/bspline_opt) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- +++ processing catkin package: 'path_searching' -- ==> add_subdirectory(Fast-Planner/fast_planner/path_searching) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- +++ processing catkin package: 'poly_traj' -- ==> add_subdirectory(Fast-Planner/fast_planner/poly_traj) -- +++ processing catkin package: 'pose_utils' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/pose_utils) -- Found Armadillo: /usr/lib/libarmadillo.so (found version "9.800.4") -- +++ processing catkin package: 'so3_disturbance_generator' -- ==> add_subdirectory(Fast-Planner/uav_simulator/so3_disturbance_generator) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'odom_visualization' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/odom_visualization) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'local_sensing_node' -- ==> add_subdirectory(Fast-Planner/uav_simulator/local_sensing) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'Eigen' but neither 'Eigen_INCLUDE_DIRS' nor 'Eigen_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Fast-Planner/uav_simulator/local_sensing/CMakeLists.txt:70 (catkin_package) -- +++ processing catkin package: 'so3_control' -- ==> add_subdirectory(Fast-Planner/uav_simulator/so3_control) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'multi_map_server' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/multi_map_server) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- multi_map_server: 4 messages, 0 services -- +++ processing catkin package: 'traj_utils' -- ==> add_subdirectory(Fast-Planner/fast_planner/traj_utils) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- +++ processing catkin package: 'plan_manage' -- ==> add_subdirectory(Fast-Planner/fast_planner/plan_manage) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- plan_manage: 1 messages, 0 services -- +++ processing catkin package: 'uav_utils' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/uav_utils) -- Performing Test COMPILER_SUPPORTS_CXX11 -- Performing Test COMPILER_SUPPORTS_CXX11 - Success -- Performing Test COMPILER_SUPPORTS_CXX0X -- Performing Test COMPILER_SUPPORTS_CXX0X - Success -- Found Eigen: /usr/include/eigen3 (found version "3.3.7") -- +++ processing catkin package: 'so3_quadrotor_simulator' -- ==> add_subdirectory(Fast-Planner/uav_simulator/so3_quadrotor_simulator) CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'Eigen3' but neither 'Eigen3_INCLUDE_DIRS' nor 'Eigen3_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Fast-Planner/uav_simulator/so3_quadrotor_simulator/CMakeLists.txt:25 (catkin_package) CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Fast-Planner/uav_simulator/so3_quadrotor_simulator/CMakeLists.txt:25 (catkin_package) -- +++ processing catkin package: 'rviz_plugins' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/rviz_plugins) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Fast-Planner/uav_simulator/Utils/rviz_plugins/CMakeLists.txt:12 (catkin_package) -- Using Qt5 based on the rviz_QT_VERSION: 5.12.8 -- +++ processing catkin package: 'waypoint_generator' -- ==> add_subdirectory(Fast-Planner/uav_simulator/Utils/waypoint_generator) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Configuring done CMake Warning (dev) at Fast-Planner/uav_simulator/so3_disturbance_generator/CMakeLists.txt:70 (add_dependencies): Policy CMP0046 is not set: Error on non-existent dependency in add_dependencies. Run "cmake --help-policy CMP0046" for policy details. Use the cmake_policy command to set the policy and suppress this warning. The dependency target "so3_disturbance_generator_gencfg" of target "so3_disturbance_generator" does not exist. This warning is for project developers. Use -Wno-dev to suppress it. -- Generating done -- Build files have been written to: /home/saber/fastplanner_ws/build #### #### Running command: "make -j2 -l2" in "/home/saber/fastplanner_ws/build" #### Scanning dependencies of target geometry_msgs_generate_messages_py Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_StatusData [ 0%] Built target geometry_msgs_generate_messages_py Scanning dependencies of target nav_msgs_generate_messages_py [ 0%] Built target nav_msgs_generate_messages_py Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_Odometry [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_StatusData Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_LQRTrajectory [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_Odometry Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_AuxCommand [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_LQRTrajectory Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_Corrections [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_AuxCommand Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_Gains [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_Corrections Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_OutputData [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_Gains Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_PositionCommand [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_OutputData Scanning dependencies of target _quadrotor_msgs_generate_messages_check_deps_PPROutputData [ 0%] Built target _quadrotor_msgs_generate_messages_check_deps_Pos

资源评论
用户头像
战神哥
2025.04.29
通过ICP算法实现点云对齐,操作步骤清晰,学习价值高。
用户头像
型爷
2025.03.28
这个Python脚本简单易用,适合新手快速上手点云注册。
用户头像
五月Eliy
2025.03.24
适合学习地理参考3D LIDAR点云处理的资料,实用性强。
syviahk
  • 粉丝: 46
上传资源 快速赚钱