VEEROBOT Docs
StoreBlogWiki
  • 🌐Introduction
  • ROS Based Robots
    • 🐺Wolf Robot
      • ROS Introduction
      • Getting Started with ROS 2
      • Introduction to Wolf Robot
      • ROS 2 Setup
      • ROS Concepts
      • Using Wolf Examples
      • Creating a URDF File
      • Visualising in Gazebo
      • Controlling motors from ROS
      • LiDAR Basics & Control
      • Using a Camera with ROS2
      • ROS 2 Cleanup
      • ROS 2 Controller
      • Teleoperation
      • Slam Navigation
      • Wolf : Conclusion
  • Arduino Based Robots
    • 🚜Micro:Xbot
      • Preparations before First Use
      • Programming the Board
      • Powering the Board
      • Pin Mapping
      • Basic Programs
        • Blinking LED
        • Buzzer Program
        • Fading LED
        • RGB LED
        • Light Detection
        • Battery Voltage
        • Line Follower Module
        • Ultrasonic Sensor
        • Infrared Remote Control
        • Motor Control
        • Bluetooth Control
        • Display Test
        • Test Me
      • Robot Assembly
      • Advanced Programs
        • Bluetooth Controlled Robot
        • Obstacle Avoidance Robot
        • Line Follower Robot
  • ROS2 Repo
    • Introduction
    • Page 1
      • Sub Page 1
    • Page 2
Powered by GitBook
On this page
  1. ROS Based Robots
  2. Wolf Robot

ROS 2 Controller

Install the below on development machine

sudo apt install ros-foxy-ros2-control ros-foxy-ros2-controllers ros-foxy-gazebo-ros2-control
ros2 launch wolf-robot launch_sim.launch.py world:=./src/wolf-robot/worlds/construction.world

ros2 control list_hardware_interfaces 

ros2 run teleop_twist_keyboard teleop_twist_keyboard --ros-args -r /cmd_vel:=diff_cont/cmd_vel_unstamped

rviz2 # To visualize robot in rviz

Installing ROS2 Control and ROS2 Controllers on Pi

sudo apt install ros-foxy-ros2-control ros-foxy-ros2-controllers 
git clone https://github.com/VEEROBOT/diffdrive_arduino.git
git clone https://github.com/VEEROBOT/serial.git

Serial is used to connect to serial port, diff drive is used to control the hardware

sudo apt install ros-foxy-xacro ros-foxy-joint-state-publisher ros-foxy-joint-state-publisher-gui

To change between gazebo and real robot, change between ros2 control and sim_mode in robot.urdf.xacro file

To Launch Simulation:

ros2 launch wolf-robot launch_sim.launch.py world:=./src/wolf-robot/worlds/construction.world

To Launch Real Robot

ros2 launch wolf-robot launch_robot.launch.py 

To Start Teleop Twist Keyboard

ros2 run teleop_twist_keyboard teleop_twist_keyboard --ros-args -r /cmd_vel:=/diff_cont/cmd_vel_unstamped
PreviousROS 2 CleanupNextTeleoperation

Last updated 1 year ago

🐺