当前位置:   article > 正文

实测 (三)NVIDIA Xavier NX + D435i / 奥比中光Astrapro 相机+ ORB-SLAM 2 + 3 稠密回环建图_astrapro.yaml文件

astrapro.yaml文件

开发环境:NX+Ubuntu18.04+ROS-melodic

接着上篇,使用奥比中光的Astrapro相机(乐视三合一相机)orb-slam2稠密回环建图

依然先放上效果图:

 三、NX + Astrapro相机+orb-slam2 稠密回环建图

3.1 安装奥比中光Astrapro的SDK

(1)安装依赖

  1. sudo apt-get install libudev-dev
  2. sudo apt-get install libopenal-dev
  3. sudo apt-get install libvorbis-dev
  4. sudo apt install ros-melodic-rgbd-launch

(2)新建工作空间

  1. mkdir -p ~/astra_ws/src
  2. cd astra_ws
  3. catkin_make
  4. source devel/setup.bash

(3)下载编译sdk

  1. cd astra_ws/src
  2. git clone https://github.com/orbbec/ros_astra_camera
  3. cd ..
  4. catkin_make

(4)配置设备节点,并再次编译

  1. roscd astra_camera
  2. ./scripts/create_udev_rules
  3. cd ~/astra_ws
  4. catkin_make --pkg astra_camera

(5)修改 astrapro.launch

首先插上相机,首先查看相机接口

lsusb

其中:

  1. Bus 001 Device 019: ID 2bc5:0502 // RGB模块 可能有的显示0501
  2. Bus 001 Device 018: ID 2bc5:0403 // 深度模块

根据显示,对应修改astrapro.launch中, 0x0501 改为上面的 0x0502(如果上面显示的是0501就不用改)

(6)启动相机

  1. sudo su //不运行su命令,直接打开会丢失深度信息
  2. souce devel setup.bash
  3. roslaunch astra_carma astrapro.launch

3.2 运行建图

(1)修改ORB-SLAM2_RGBD_DENSE_MAP/Examples/ROS/ORB_SLAM21/src/ros_rgbd.cc的topic

  1. message_filters::Subscriber<sensor_msgs::Image> rgb_sub(nh, "/camera/rgb/image_raw", 1);
  2. message_filters::Subscriber<sensor_msgs::Image> depth_sub(nh, "/camera/depth_registered/image_raw", 1);

之后重新编译

./build_ros.sh

(2)配置astrapro.yaml文件

复制Asus.yaml,并重命名astrapro.yaml,修改其中的内参camera.bf。需要完整版的yaml文件,可以在评论区留下联系邮箱

(3)运行

rosrun ORBSLAM21 RGBD Vocabulary/ORBvoc.bin Examlpe/ROS/ORB_SLAM21/astrapro.yaml

声明:本文内容由网友自发贡献,不代表【wpsshop博客】立场,版权归原作者所有,本站不承担相应法律责任。如您发现有侵权的内容,请联系我们。转载请注明出处:https://www.wpsshop.cn/w/IT小白/article/detail/280372
推荐阅读
相关标签
  

闽ICP备14008679号