< >
Home » ROS2与webots入门教程 » ros2与webots入门教程-turtlebot3使用

ros2与webots入门教程-turtlebot3使用

ros2与webots入门教程-turtlebot3使用

说明: 

  • 介绍如何在webots中使用turtlebot3

步骤: 

  • 启动turtlebot3
ros2 launch webots_ros2_turtlebot robot_launch.py

建图

  • 将 SLAM 与 Webots 模拟的 TurtleBot3 Burger 一起使用。
  • 您会看到,Webots 使用标准的 ROS2 接口,无需修改即可与 TurtleBot3 SLAM 包一起使用。
  • 安装cartographer 
sudo apt install ros-galactic-turtlebot3-cartographer
  • 或源码安装
source /opt/ros/${ROS_DISTRO}/local_setup.bash

# Retrieve the sources
cd /path/to/ros2_ws
git clone -b ${ROS_DISTRO}-devel https://github.com/ROBOTIS-GIT/turtlebot3.git src/turtlebot3

# Check dependencies
rosdep update
rosdep install --from-paths src --ignore-src --rosdistro ${ROS_DISTRO}

# Building packages
colcon build --packages-up-to turtlebot3_navigation2
source install/local_setup.bash
  • 运行robot_launch
ros2 launch webots_ros2_turtlebot robot_launch.py
  • 新开终端,运行
ros2 launch turtlebot3_cartographer cartographer.launch.py \
    use_sim_time:=true

 - 您可能需要运行该命令 2 或 3 次才能使其正常工作。

请输入图片描述

导航

 - 安装

sudo apt install ros-galactic-turtlebot3-navigation2
  • 启动webots
ros2 launch webots_ros2_turtlebot robot_launch.py
  • 新开终端,运行
export TURTLEBOT3_MODEL='burger'
ros2 launch turtlebot3_navigation2 navigation2.launch.py \
    use_sim_time:=true \
    map:=$(ros2 pkg prefix webots_ros2_turtlebot --share)/resource/turtlebot3_burger_example_map.yaml
  • 该命令将初始化 Navigation2 包并打开 RVIz2。
  • 确保通过单击 RViz2 中的 2D Pose Estimate 按钮或执行以下命令来设置初始姿势:
ros2 topic pub --once /initialpose geometry_msgs/msg/PoseWithCovarianceStamped '{
    "header": { "frame_id": "map" },
    "pose": {
        "pose": {
            "position": { "x": 0.0, "y": 0.0, "z": 0.0 },
            "orientation": { "x": 0.0, "y": 0.0, "z": 0.0, "w": 1.0 }
        }
    }
}'
  • 效果图

请输入图片描述

纠错,疑问,交流: 请进入讨论区点击加入Q群

获取最新文章: 扫一扫右上角的二维码加入“创客智造”公众号


标签: ros2与webots入门教程