点云cloudpoint生成octomap的OcTree的两种方法以及rviz可视化

news2024/10/6 8:22:43

第一种:在自己的项目中将点云通过ros的topic发布,用octomap_server订阅点云消息,在octomap_server中生成ocTree

再用rviz进行可视化。

创建工作空间,记得source

mkdir temp_ocotmap_test/src
cd temp_ocotmap_test
catkin_make
source devel/setup.bash

将这两个功能包下载放进自己的ros项目

再创建一个用于发布点云的功能包

cd src
catkin_create_pkg my_pkg std_msgs roscpp

形成这样的目录结构

 这里使用:Octomap 在ROS环境下实时显示_ros octomap-CSDN博客

的点云数据进行说明。

进入自己的功能包,创建一个data文件,将那位博主的点云文件test.pcd放进data文件夹

cd my_pkg
mkdir data

接下来写自己节点的cpp文件和自己功能包的CMakeLists.txt

cd my_pkg/src
vim my_pkg.cpp

my_pkg.cpp写入如下内容

#include<iostream>
#include<string>
#include <stdlib.h>
#include <stdio.h>
#include <sstream>
#include <vector>

#include<ros/ros.h>  
#include<pcl/point_cloud.h>  
#include<pcl_conversions/pcl_conversions.h>  
#include<sensor_msgs/PointCloud2.h>  
#include<pcl/io/pcd_io.h>

#include <octomap_msgs/OctomapWithPose.h>
#include <octomap_msgs/Octomap.h>
#include <geometry_msgs/Pose.h>

#include <octomap/octomap.h>
#include <octomap_msgs/Octomap.h>
#include <octomap_msgs/conversions.h>

#include <geometry_msgs/TransformStamped.h>


#define TESTCLOUDPOINTS 1
#define TESTOCTOTREE 0

int main (int argc, char **argv)  
{  
    std::string topic,path,frame_id;
    int hz=5;

    ros::init (argc, argv, "publish_pointcloud");  
    ros::NodeHandle nh;  

    nh.param<std::string>("path", path, "/home/username/Downloads/temp_for_run_octomap_server/src/publish_pointcloud/data/test.pcd");
    nh.param<std::string>("frame_id", frame_id, "your_frame_id");
    nh.param<std::string>("topic", topic, "your_pointcloud_topic");
    nh.param<int>("hz", hz, 5);

    // load cloudpoint
    pcl::PointCloud<pcl::PointXYZ> pcl_cloud; 
    pcl::io::loadPCDFile (path, pcl_cloud); 

#if TESTCLOUDPOINTS
    ros::Publisher pcl_pub = nh.advertise<sensor_msgs::PointCloud2> (topic, 10);  

    // 转换成ROS下的数据类型 通过topic发布
    sensor_msgs::PointCloud2 output;  
    pcl::toROSMsg(pcl_cloud, output);

    output.header.stamp=ros::Time::now();
    output.header.frame_id  =frame_id;

    std::cout<<"path = "<<path<<std::endl;
    std::cout<<"frame_id = "<<frame_id<<std::endl;
    std::cout<<"topic = "<<topic<<std::endl;
    std::cout<<"hz = "<<hz<<std::endl;

    ros::Rate loop_rate(hz);  
    while (ros::ok())  
    {  
        pcl_pub.publish(output);  
        ros::spinOnce();  
        loop_rate.sleep();  
    }

#endif

#if TESTOCTOTREE
    ros::Publisher octomap_pub = nh.advertise<octomap_msgs::Octomap>(topic, 1);

    octomap::OcTree tree(0.1);  // You can adjust the resolution as needed

    for (const auto& point : pcl_cloud.points) {
        tree.updateNode(point.x, point.y, point.z, true);
    }

    // Publish the octree as an OctoMap message
    octomap_msgs::Octomap octomap_msg;
    octomap_msgs::fullMapToMsg(tree, octomap_msg);

    // Assuming you have a publisher for the octomap
    octomap_msg.header.stamp=ros::Time::now();
    octomap_msg.header.frame_id  =frame_id;

    std::cout<<"path = "<<path<<std::endl;
    std::cout<<"frame_id = "<<frame_id<<std::endl;
    std::cout<<"topic = "<<topic<<std::endl;
    std::cout<<"hz = "<<hz<<std::endl;

    ros::Rate loop_rate(hz);  
    while (ros::ok())  
    {  
        octomap_pub.publish(octomap_msg);  
        ros::spinOnce();  
        loop_rate.sleep();  
    }

#endif

    return 0;  
}  

CMakeLists.txt这样写

cmake_minimum_required(VERSION 3.0.2)
project(my_pkg)

## Compile as C++11, supported in ROS Kinetic and newer
# add_compile_options(-std=c++11)

## Find catkin macros and libraries
## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
## is used, also find other catkin packages
find_package(catkin REQUIRED COMPONENTS
  roscpp
  std_msgs
  sensor_msgs
  octomap_msgs
  geometry_msgs
)
find_package(PCL REQUIRED)
find_package(octomap REQUIRED)

## System dependencies are found with CMake's conventions
# find_package(Boost REQUIRED COMPONENTS system)


## Uncomment this if the package has a setup.py. This macro ensures
## modules and global scripts declared therein get installed
## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html
# catkin_python_setup()

################################################
## Declare ROS messages, services and actions ##
################################################

## To declare and build messages, services or actions from within this
## package, follow these steps:
## * Let MSG_DEP_SET be the set of packages whose message types you use in
##   your messages/services/actions (e.g. std_msgs, actionlib_msgs, ...).
## * In the file package.xml:
##   * add a build_depend tag for "message_generation"
##   * add a build_depend and a exec_depend tag for each package in MSG_DEP_SET
##   * If MSG_DEP_SET isn't empty the following dependency has been pulled in
##     but can be declared for certainty nonetheless:
##     * add a exec_depend tag for "message_runtime"
## * In this file (CMakeLists.txt):
##   * add "message_generation" and every package in MSG_DEP_SET to
##     find_package(catkin REQUIRED COMPONENTS ...)
##   * add "message_runtime" and every package in MSG_DEP_SET to
##     catkin_package(CATKIN_DEPENDS ...)
##   * uncomment the add_*_files sections below as needed
##     and list every .msg/.srv/.action file to be processed
##   * uncomment the generate_messages entry below
##   * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)

## Generate messages in the 'msg' folder
# add_message_files(
#   FILES
#   Message1.msg
#   Message2.msg
# )

## Generate services in the 'srv' folder
# add_service_files(
#   FILES
#   Service1.srv
#   Service2.srv
# )

## Generate actions in the 'action' folder
# add_action_files(
#   FILES
#   Action1.action
#   Action2.action
# )

## Generate added messages and services with any dependencies listed here
# generate_messages(
#   DEPENDENCIES
#   std_msgs
# )

################################################
## Declare ROS dynamic reconfigure parameters ##
################################################

## To declare and build dynamic reconfigure parameters within this
## package, follow these steps:
## * In the file package.xml:
##   * add a build_depend and a exec_depend tag for "dynamic_reconfigure"
## * In this file (CMakeLists.txt):
##   * add "dynamic_reconfigure" to
##     find_package(catkin REQUIRED COMPONENTS ...)
##   * uncomment the "generate_dynamic_reconfigure_options" section below
##     and list every .cfg file to be processed

## Generate dynamic reconfigure parameters in the 'cfg' folder
# generate_dynamic_reconfigure_options(
#   cfg/DynReconf1.cfg
#   cfg/DynReconf2.cfg
# )

###################################
## catkin specific configuration ##
###################################
## The catkin_package macro generates cmake config files for your package
## Declare things to be passed to dependent projects
## INCLUDE_DIRS: uncomment this if your package contains header files
## LIBRARIES: libraries you create in this project that dependent projects also need
## CATKIN_DEPENDS: catkin_packages dependent projects also need
## DEPENDS: system dependencies of this project that dependent projects also need
catkin_package(
#  INCLUDE_DIRS include
#  LIBRARIES my_pkg
#  CATKIN_DEPENDS roscpp std_msgs
#  DEPENDS system_lib
)

###########
## Build ##
###########

## Specify additional locations of header files
## Your package locations should be listed before other locations
include_directories(
# include
  ${catkin_INCLUDE_DIRS}
  ${PCL_INCLUDE_DIRS}
  ${OCTOMAP_INCLUDE_DIRS}
)

## Declare a C++ library
# add_library(${PROJECT_NAME}
#   src/${PROJECT_NAME}/my_pkg.cpp
# )

## Add cmake target dependencies of the library
## as an example, code may need to be generated before libraries
## either from message generation or dynamic reconfigure
# add_dependencies(${PROJECT_NAME} ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})

## Declare a C++ executable
## With catkin_make all packages are built within a single CMake context
## The recommended prefix ensures that target names across packages don't collide
add_executable(publish_pointcloud src/my_pkg.cpp)

## Rename C++ executable without prefix
## The above recommended prefix causes long target names, the following renames the
## target back to the shorter version for ease of user use
## e.g. "rosrun someones_pkg node" instead of "rosrun someones_pkg someones_pkg_node"
# set_target_properties(${PROJECT_NAME}_node PROPERTIES OUTPUT_NAME node PREFIX "")

## Add cmake target dependencies of the executable
## same as for the library above
# add_dependencies(${PROJECT_NAME}_node ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})

## Specify libraries to link a library or executable target against
target_link_libraries(publish_pointcloud
  ${catkin_LIBRARIES}
  ${PCL_LIBRARIES}
  ${OCTOMAP_LIBRARIES}
)

#############
## Install ##
#############

# all install targets should use catkin DESTINATION variables
# See http://ros.org/doc/api/catkin/html/adv_user_guide/variables.html

## Mark executable scripts (Python etc.) for installation
## in contrast to setup.py, you can choose the destination
# catkin_install_python(PROGRAMS
#   scripts/my_python_script
#   DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
# )

## Mark executables for installation
## See http://docs.ros.org/melodic/api/catkin/html/howto/format1/building_executables.html
# install(TARGETS ${PROJECT_NAME}_node
#   RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
# )

## Mark libraries for installation
## See http://docs.ros.org/melodic/api/catkin/html/howto/format1/building_libraries.html
# install(TARGETS ${PROJECT_NAME}
#   ARCHIVE DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
#   LIBRARY DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
#   RUNTIME DESTINATION ${CATKIN_GLOBAL_BIN_DESTINATION}
# )

## Mark cpp header files for installation
# install(DIRECTORY include/${PROJECT_NAME}/
#   DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION}
#   FILES_MATCHING PATTERN "*.h"
#   PATTERN ".svn" EXCLUDE
# )

## Mark other files for installation (e.g. launch and bag files, etc.)
# install(FILES
#   # myfile1
#   # myfile2
#   DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION}
# )

#############
## Testing ##
#############

## Add gtest based cpp test target and link libraries
# catkin_add_gtest(${PROJECT_NAME}-test test/test_my_pkg.cpp)
# if(TARGET ${PROJECT_NAME}-test)
#   target_link_libraries(${PROJECT_NAME}-test ${PROJECT_NAME})
# endif()

## Add folders to be run by python nosetests
# catkin_add_nosetests(test)

my_pkg.cpp中,先使用 宏TESTCLOUDPOINTS,发布点云数据

#define TESTCLOUDPOINTS 1
#define TESTOCTOTREE 0

定义好frame_idtopic

nh.param<std::string>("path", path, "/home/.../test.pcd");
nh.param<std::string>("frame_id", frame_id, "your_frame_id");
nh.param<std::string>("topic", topic, "your_pointcloud_topic");
nh.param<int>("hz", hz, 5);

回到工作空间,编译

cd temp_ocotmap_test
caikin_make

在工作空间中运行节点

rosrun my_pkg publish_pointcloud

打开一个terminal,进入工作空间,新打开terminal要source一下

source devel/setup.bash

接下来要运行octomap_server,通过octomap_server中的launch文件运行,launch文件在octomap_server/launch,运行之前,要修改其中的frame_id 和topic为你自己定义的frame_id和topic

<launch>
  <node pkg="octomap_server" type="octomap_server_node" name="octomap_server">

    <!-- resolution in meters per pixel -->
    <param name="resolution" value="0.05" />

    <!-- name of the fixed frame, needs to be "/map" for SLAM -->
    <param name="frame_id" type="string" value="your_frame_id" />

    <!-- max range / depth resolution of the kinect in meter -->
    <param name="sensor_model/max_range" value="100.0" />
    <param name="latch" value="true" />

    <!-- max/min height for occupancy map, should be in meters -->
    <param name="pointcloud_max_z" value="1000" />
    <param name="pointcloud_min_z" value="0" />

    <!-- topic from where pointcloud2 messages are subscribed -->
    <remap from="/cloud_in" to="your_pointcloud_topic" />
 
  </node>
</launch>

在工作空间中运行octomap_server

roslaunch octomap_server octomap_mapping.launch

这时会出现

 不用担心,其实octree已经生成,不知道为什么会显示这个,因为这个问题困扰了好久

再打开一个terminal,运行rviz,记得提前要安装rviz的octomap 插件

rosrun rviz rviz

修改Fixed Frame,Add一个OccupancyGrid,订阅/ocotmap_full这个topic,就可以看到生成的octree了

 第二种:不使用octomap_server,在自己项目中引用octomap包,生成octree,直接发布octree的topic,rviz订阅topic进行可视化

将上面my_pkg.cpp中的宏改为

#define TESTCLOUDPOINTS 0
#define TESTOCTOTREE 1

这样就运行了直接生成octree并发布的那段代码,回到工作空间,编译,运行节点

cd temp_ocotmap_test
catkin_make
rosrun my_pkg publish_pointcloud

在rviz中修改topic和frame_id,便可以看到octree

以上!

本文来自互联网用户投稿,该文观点仅代表作者本人,不代表本站立场。本站仅提供信息存储空间服务,不拥有所有权,不承担相关法律责任。如若转载,请注明出处:http://www.coloradmin.cn/o/1116425.html

如若内容造成侵权/违法违规/事实不符,请联系多彩编程网进行投诉反馈,一经查实,立即删除!

相关文章

系列一、文件

一、概述 文件对我们并不陌生&#xff0c;简单的讲文件就是保存数据的地方&#xff0c;比如大家经常使用的word文档&#xff0c;txt文件&#xff0c;excel文件&#xff0c;mp3音乐文件&#xff0c;mp4视频文件...等等&#xff0c;它既可以是一张图片&#xff0c;也可以是一段视…

C++之继承<2>【详解】

C之继承&#xff1c;2&#xff1e;【详解】 1. 派生类的默认成员函数1.1 1. 构造成员函数1.2 拷贝复制1.3 构造函数和析构函数的执行顺序 2. 继承和友元3. 继承与静态成员 1. 派生类的默认成员函数 1.1 1. 构造成员函数 派生类的构造函数必须调用基类的构造函数初始化基类的那…

力扣刷题 day50:10-20

1.存在重复元素 给你一个整数数组 nums 。如果任一值在数组中出现 至少两次 &#xff0c;返回 true &#xff1b;如果数组中每个元素互不相同&#xff0c;返回 false 。 方法一&#xff1a;集合去重 #方法一&#xff1a;集合去重 def containsDuplicate(nums):return len(n…

八股总结(招聘)

线程创建方法&#xff1a; 继承 Thread 类实现 Runnable 接口通过 ExecutorService 和 Callable\ 实现有返回值的线程基于线程池的execute()&#xff0c;创建临时线程

嵌入式面试常见问题(二)

1.malloc如何分配内存&#xff1f; 进行虚拟地址空间的分布&#xff1a;程序地址空间-》程序虚拟地址空间-》进程虚拟地址空间 内存布局&#xff1a; ​ 进程虚拟地址空间和PCB&#xff08;Process Control Block&#xff0c;进程控制块&#xff09;进行串联 &#xff1a; ​…

微信小程序进阶——后台交互

目录 一、后台准备 1.1 pom.xml 1.2 配置数据源 1.3 整合mybatis 二、前后端交互 2.1 method1 2.2 method2 2.2.1 封装request 2.2.2 头部引用util 2.2.3 编写方法 2.2.4 展示效果 三、WXS的使用 3.1 会议状态 3.1.2 引入wxs 3.1.3 修改代码 3.1.4 展示效果 3…

计算机毕业设计 基于SpringBoot笔记记录分享网站的设计与实现 Javaweb项目 Java实战项目 前后端分离 文档报告 代码讲解 安装调试

&#x1f34a;作者&#xff1a;计算机编程-吉哥 &#x1f34a;简介&#xff1a;专业从事JavaWeb程序开发&#xff0c;微信小程序开发&#xff0c;定制化项目、 源码、代码讲解、文档撰写、ppt制作。做自己喜欢的事&#xff0c;生活就是快乐的。 &#x1f34a;心愿&#xff1a;点…

Mysql 中的性能调优方法

Mysql 性能调优方法可以从四个方面来说&#xff0c;分别是&#xff1a; 表结构与索引 SQL 语句优化 Mysql 参数优化 硬件及系统配置 这四个方面的优化成本和优化效果是成反比的。 表结构和索引的优化 表结构和索引的优化&#xff0c;主要可以下面这些方面去优化&#xff1a; 分…

NewStarCTF 2023 公开赛道 WEEK2|WEB 游戏高手

app_v2.js就是游戏文件 右键“用调试器打开”&#xff1a; var gameScore 0; 就是当前分数&#xff0c; 打开控制台&#xff0c;输入 gameScore 1000000&#xff0c;回车 就可以得到flag

字节码进阶之ASM字节码操作类库详解

文章目录 0.前言1. 引言2. ASM简介3. 字节码基础知识回顾 4. ASM的核心概念5. ASM的基本用法5.1. 读取和分析字节码5.2. 修改和生成字节码 6. ASM的高级用法6.1. 字节码增强技术6.2. 自定义类加载器和类定义 7. 实例演示&#xff1a;使用ASM实现简单的字节码增强 字节码进阶之A…

代码随想录算法训练营第二十八天丨 回溯算法part04

491.递增子序列 思路 这个递增子序列比较像是取有序的子集。而且本题也要求不能有相同的递增子序列。 在90.子集II (opens new window)中是通过排序&#xff0c;再加一个标记数组来达到去重的目的。 而本题求自增子序列&#xff0c;是不能对原数组进行排序的&#xff0c;排…

前端工作方式要换了?HTMX简介:无需JavaScript的动态HTML

HTMX允许你使用扩展的HTML语法代替 JavaScript 来实现交互性。HTMX 在标记中直接为你提供HTTP 交互&#xff0c;并支持许多其他交互需求&#xff0c;无需求助于 JavaScript。这是一个有趣的想法&#xff0c;可能最终会影响到web前端的工作方式。让我们看看如何使用HTMX以及它的…

pytorch 入门 (三)案例一:mnist手写数字识别

本文为&#x1f517;小白入门Pytorch内部限免文章 &#x1f368; 本文为&#x1f517;小白入门Pytorch中的学习记录博客&#x1f366; 参考文章&#xff1a;【小白入门Pytorch】mnist手写数字识别&#x1f356; 原作者&#xff1a;K同学啊 目录 一、 前期准备1. 设置GPU2. 导入…

聊聊分布式架构09——分布式中的一致性协议

目录 01从集中式到分布式 系统特点 集中式特点 分布式特点 事务处理差异 02一致性协议与Paxos算法 2PC&#xff08;Two-Phase Commit&#xff09; 阶段一&#xff1a;提交事务请求 阶段二&#xff1a;执行事务提交 优缺点 3PC&#xff08;Three-Phase Commit&#x…

kubeadm初始化搭建cri-dockerd记录 containerd.io

07.尚硅谷_搭建K8s集群&#xff08;kubeadm方式&#xff09;-部署master节点_哔哩哔哩_bilibili 视频里的版本只有1.17而现在&#xff08;2023.10.20&#xff09;kubernetes最新版本是1.28&#xff0c;需要搭载cri-dockerd&#xff0c; 先去网站下载了对应的rpm包cri-dockerd…

计算机算法分析与设计(14)---贪心算法(会场安排问题和最优服务次序问题)

文章目录 一、会场安排问题1.1 问题描述1.2 思路分析1.3 例题分析1.4 代码编写 二、最优服务次序问题2.1 问题描述2.2 思路分析2.3 代码编写 一、会场安排问题 1.1 问题描述 假设在足够多的会场里安排一批活动&#xff0c;并希望使用尽可能少的会场。设计一个有效的贪心算法进…

kettle 导出Excel 日期信息为空bug

今天做个需求&#xff0c;跨库联表查询数据。导出为Excel &#xff0c;但是日期数据除了问题。日期yyyy/mm/dd hh:mm:ss 竟然是空的 。 解决办法&#xff1a; 一、&#xff08;网上给出最多的解决方案&#xff0c;但本人不实用。需要安装MySQL监听&#xff09; to_char(日期,…

Mojo——会燃的 AI 编程语言

点击链接了解详情 导语&#xff1a;本文简介 Mojo 的背景与特点&#xff0c;并分享如何通过腾讯云 Cloudstudio 的 WebIDE 和分享社区快速学习和上手 Mojo。 &#x1f525;&#x1f525;&#x1f525; 腾讯云 Cloud Studio 已开放 Mojo 应用模版。 什么是 Mojo Mojo 是基于 P…

CodeFormer和GFPGAN的本地部署与效果对比

CodeFormer和GFPGAN是两个图片人脸修复的开源程序&#xff0c;两个程序不相伯仲&#xff0c;效果都非常棒&#xff0c;在stable diffusion中这两个插件都有集成进去&#xff01;我们今天就将这两个程序的本地独立安装和使用方法记录一下&#xff01; CodeFormer github主页地址…

【前端】使用tesseract插件识别提取图片中的文字

前言 有时候项目需要识别证照信息&#xff0c;或者拍照搜索内容等。图片处理一般是后端处理比较好&#xff0c;不过前端也有相关插件处理&#xff0c;tesseract.js就是一种前端处理方案。 使用tesseract tesseract更多的语言模型&#xff1a;language配置 安装 Tesseract.…