multi agent reinforcement learning 을 하려고 한다.

현재 시점에서 내 환경과 설치사항은 다음과 같다.

  • ubuntu 22.04 (dual booting)
  • nvidia 4080 -> drivers 525
  • ros2 humble
  • anaconda -> python 3.11
  • vscode

ubuntu 환경은 새롭게 구성할 때가 많은데 이 때마다 위 항목들을 기본적으로 설치하고 공부를 시작하는 편이다.

gazebo install

$ sudo apt install ros-humble-gazebo-ros-pkgs

ros2 sourcing

$ source /opt/ros/humble/setup.bash

check core tools install

$ sudo apt install ros-humble-ros-core ros-humble-geometry2

ros2 sourcing

$ gazebo –verbose /opt/ros/humble/share/gazebo_plugins/worlds/gazebo_ros_diff_drive_demo.world

Screenshot from 2024 03 08 20 55 35

움직이게 하기

새로운 터미널을 열고

$ source /opt/ros/humble/setup.bash
$ ros2 topic pub /demo/cmd_demo geometry_msgs/Twist ‘{linear: {x: 1.0}}’ -1


0 Comments

Leave a Reply