(!) Please ask about problems and questions regarding this tutorial on answers.ros.org. Don't forget to include in your question the link to this page, the versions of your OS & ROS, and also add appropriate tags.

Installing Ubuntu with ROS + TIAGO

Description: This tutorial describes the steps needed to get a proper Unbuntu and ROS installation to have a system up and running for the TIAGo tutorials.

Tutorial Level: BEGINNER

Next Tutorial: Testing_simulation Robots/TIAGo/Tutorials/Installation/Testing_simulation Robots/TIAGo/Tutorials/Installation/Installing_Tiago_tutorial_docker

Author: Job van Dieten < job.1994@gmail.com >, Sai Kishor Kothakota < sai.kishor@pal-robotics.com >

Maintainer: Jordi Pages < jordi.pages@pal-robotics.com >, Thomas Peyrucain < thomas.peyrucain@pal-robotics.com >

Source: https://github.com/pal-robotics/tiago_tutorials.git

  Show EOL distros: 

  • Not supported. Currently supported ROS LTS: Melodic.

  • Not supported. Currently supported ROS LTS: Melodic.

Ubuntu installation

In order to run the public simulation of TIAGo it is preferable to get a fresh installation of Ubuntu 16.04.4 LTS as follows

wget http://releases.ubuntu.com/16.04/ubuntu-16.04.6-desktop-amd64.iso

Use this ISO to install a fresh Ubuntu OS in your development computer. Afterwards, you can proceed installing ROS as explained in the next section.

ROS + Tiago installation

Set up ROS packages sources

In order to install the required ROS packages for running TIAGo's simulation first, as explained in ROS Kinetic installation, it is required to include packages.ros.org in the debian sources:

Configure your Ubuntu repositories

Configure your Ubuntu repositories to allow "restricted," "universe," and "multiverse." You can follow the Ubuntu guide for instructions on doing this.

Setup your sources.list

Setup your computer to accept software from packages.ros.org.

sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu $(lsb_release -sc) main" > /etc/apt/sources.list.d/ros-latest.list'

Set up your keys

The set up the required keys to access the debian sources:

sudo apt install curl # if you haven't already installed curl
curl -s https://raw.githubusercontent.com/ros/rosdistro/master/ros.asc | sudo apt-key add -

ROS packages installation

install use the following instruction

  • sudo apt-get update
    sudo apt-get install git python-rosinstall ros-kinetic-desktop-full python-catkin-tools ros-kinetic-joint-state-controller ros-kinetic-twist-mux ros-kinetic-ompl ros-kinetic-controller-manager ros-kinetic-moveit-core ros-kinetic-moveit-ros-perception ros-kinetic-moveit-ros-move-group ros-kinetic-moveit-kinematics ros-kinetic-moveit-ros-planning-interface ros-kinetic-moveit-simple-controller-manager ros-kinetic-moveit-planners-ompl ros-kinetic-joy ros-kinetic-joy-teleop ros-kinetic-teleop-tools ros-kinetic-control-toolbox ros-kinetic-sound-play ros-kinetic-navigation ros-kinetic-eband-local-planner ros-kinetic-depthimage-to-laserscan  ros-kinetic-openslam-gmapping ros-kinetic-gmapping ros-kinetic-moveit-commander ros-kinetic-humanoid-nav-msgs ros-kinetic-urdf-geometry-parser ros-kinetic-four-wheel-steering-msgs

Append the following command to ~/.bashrc to allow any console to use the catkin commands

  • source /opt/ros/kinetic/setup.bash

Source-based installation

These instructions assume that you are comfortable with ROS and the catkin build system. Please familiarize yourself using the ROS and catkin tutorials.

First of all open a terminal and create an empty workspace:

  • mkdir ~/tiago_public_ws
    cd ~/tiago_public_ws

Download the file tiago_public.rosinstall. Copy the rosinstall file in ~/tiago_public_ws. Then run the following instruction in order to clone all the required repositories within the workspace:

  • rosinstall src /opt/ros/kinetic tiago_public.rosinstall

Set up rosdep

  • sudo rosdep init
    rosdep update

Then you may run the following instruction to make sure that all dependencies referenced in the workspace are installed

  • rosdep install --from-paths src --ignore-src -y --rosdistro kinetic --skip-keys="opencv2 opencv2-nonfree pal_laser_filters speed_limit_node sensor_to_cloud hokuyo_node libdw-dev python-graphitesend-pip python-statsd pal_filters pal_vo_server pal_usb_utils pal_pcl pal_pcl_points_throttle_and_filter pal_karto pal_local_joint_control camera_calibration_files pal_startup_msgs pal-orbbec-openni2 dummy_actuators_manager pal_local_planner gravity_compensation_controller current_limit_controller dynamic_footprint dynamixel_cpp tf_lookup opencv3 joint_impedance_trajectory_controller urdf_test uvc_camera range_sensor_layer teb_local_planner pointcloud_to_laserscan octomap_server spatio_temporal_voxel_layer openni2_launch moveit_ros_visualization slam_toolbox sick_tim libuvc_camera"

Then, you may proceed building the workspace:

  • source /opt/ros/kinetic/setup.bash
    catkin build -DCATKIN_ENABLE_TESTING=0

Once you compiled all packages and sourced the environment (source devel/setup.bash) it's all ready to go.

To check that everything is properly installed run the TIAGo simulation tutorial

  • Not supported. Currently supported ROS LTS: Melodic.

  • Not supported. Currently supported ROS LTS: Melodic.

Ubuntu installation

In order to run the public simulation of TIAGo it is preferable to get a fresh installation of Ubuntu 18.04.2 LTS as follows

  • wget http://releases.ubuntu.com/18.04/ubuntu-18.04.2-desktop-amd64.iso

Use this ISO to install a fresh Ubuntu OS in your development computer. Afterwards, you can proceed installing ROS as explained in the next section.

ROS + Tiago installation

Set up ROS packages sources

In order to install the required ROS packages for running TIAGo's simulation first, as explained in ROS Melodic installation, it is required to include packages.ros.org in the debian sources:

  • sudo apt update
    sudo apt install lsb-release # if you haven't already installed lsb-release

Configure your Ubuntu repositories

Configure your Ubuntu repositories to allow "restricted," "universe," and "multiverse." You can follow the Ubuntu guide for instructions on doing this.

Setup your sources.list

Setup your computer to accept software from packages.ros.org.

  • sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu $(lsb_release -sc) main" > /etc/apt/sources.list.d/ros-latest.list'

Mirrors

Source Debs are also available

Set up your keys

  • sudo apt install curl # if you haven't already installed curl
    curl -s https://raw.githubusercontent.com/ros/rosdistro/master/ros.asc | sudo apt-key add -

ROS packages installation

install use the following instruction

  • sudo apt-get update
    sudo apt-get install git python-rosinstall ros-melodic-desktop-full python-catkin-tools ros-melodic-joint-state-controller ros-melodic-twist-mux ros-melodic-ompl ros-melodic-controller-manager ros-melodic-moveit-core ros-melodic-moveit-ros-perception ros-melodic-moveit-ros-move-group ros-melodic-moveit-kinematics ros-melodic-moveit-ros-planning-interface ros-melodic-moveit-simple-controller-manager ros-melodic-moveit-planners-ompl ros-melodic-joy ros-melodic-joy-teleop ros-melodic-teleop-tools ros-melodic-control-toolbox ros-melodic-sound-play ros-melodic-navigation ros-melodic-depthimage-to-laserscan ros-melodic-moveit-commander

Append the following command to ~/.bashrc to allow any console to use the catkin commands

  • source /opt/ros/melodic/setup.bash

Source-based installation

These instructions assume that you are comfortable with ROS and the catkin build system. Please familiarize yourself using the ROS and catkin tutorials.

First of all open a terminal and create an empty workspace:

  • mkdir ~/tiago_public_ws
    cd ~/tiago_public_ws

Then run the following instruction in order download tiago_public-melodic.rosinstall and to clone all the required repositories within the workspace:

  • wget https://raw.githubusercontent.com/pal-robotics/tiago_tutorials/kinetic-devel/tiago_public-melodic.rosinstall
    rosinstall src /opt/ros/melodic tiago_public-melodic.rosinstall

Set up rosdep

  • sudo rosdep init
    rosdep update

Then you may run the following instruction to make sure that all dependencies referenced in the workspace are installed

  • rosdep install --from-paths src --ignore-src -y --rosdistro melodic --skip-keys="opencv2 opencv2-nonfree pal_laser_filters speed_limit_node sensor_to_cloud hokuyo_node libdw-dev python-graphitesend-pip python-statsd pal_filters pal_vo_server pal_usb_utils pal_pcl pal_pcl_points_throttle_and_filter pal_karto pal_local_joint_control camera_calibration_files pal_startup_msgs pal-orbbec-openni2 dummy_actuators_manager pal_local_planner gravity_compensation_controller current_limit_controller dynamic_footprint dynamixel_cpp tf_lookup opencv3 joint_impedance_trajectory_controller cartesian_impedance_controller omni_base_description omni_drive_controller pal_moveit_capabilities pal_moveit_plugins pal_loc_measure pal_map_manager ydlidar_ros_driver"

Then, you may proceed building the workspace:

  • source /opt/ros/melodic/setup.bash
    catkin build -DCATKIN_ENABLE_TESTING=0 -j $(expr `nproc` / 2)

Once you compiled all packages and sourced the environment (source devel/setup.bash) it's all ready to go.

To check that everything is properly installed run the TIAGo simulation tutorial

Ubuntu installation

In order to run the public simulation of TIAGo it is preferable to get a fresh installation of Ubuntu 20.04.5 LTS as follows

  • wget http://releases.ubuntu.com/20.04/ubuntu-20.04.5-desktop-amd64.iso

Use this ISO to install a fresh Ubuntu OS on your development computer. Afterwards, you can proceed to install ROS as explained in the next section.

ROS installation

Set up ROS packages sources

In order to install the required ROS packages for running TIAGo's simulation first, as explained in ROS Noetic installation, it is required to include packages.ros.org in the debian sources:

  • sudo apt update
    sudo apt install lsb-release # if you haven't already installed lsb-release
    sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu $(lsb_release -sc) main" > /etc/apt/sources.list.d/ros-latest.list'

The set up the required keys to access the debian sources:

  • sudo apt install curl gnupg # if you haven't already installed curl or gnupg
    curl -s https://raw.githubusercontent.com/ros/rosdistro/master/ros.asc | sudo apt-key add -

ROS packages installation

install use the following instruction

  • sudo apt-get update
    sudo apt-get install git wget ipython3 python3-rosinstall ros-noetic-desktop-full python3-catkin-tools python3-rosdep python-is-python3 ros-noetic-actionlib-tools ros-noetic-moveit-commander

Append the following command to ~/.bashrc to allow any console to use the catkin commands

  • source /opt/ros/noetic/setup.bash

Source-based installation

Currently source-based installation is provided.

These instructions assume that you are comfortable with ROS and the catkin build system. Please familiarize yourself using the ROS and catkin tutorials.

First of all, open a terminal and create an empty workspace:

  • mkdir ~/tiago_public_ws
    cd ~/tiago_public_ws

Then run the following instruction in order to download tiago_public-noetic.rosinstall and to clone all the required repositories within the workspace:

  • wget https://raw.githubusercontent.com/pal-robotics/tiago_tutorials/noetic-devel/tiago_public-noetic.rosinstall
    rosinstall src /opt/ros/noetic tiago_public-noetic.rosinstall

Then run this command to make sure that all dependencies are installed.

  • sudo rosdep init
    rosdep update

Then you may run the following instruction to make sure that all dependencies referenced in the workspace are installed

  • rosdep install -y --from-paths src --ignore-src --rosdistro noetic --skip-keys "urdf_test omni_drive_controller orocos_kdl pal_filters libgazebo9-dev pal_usb_utils speed_limit_node camera_calibration_files pal_moveit_plugins pal_startup_msgs pal_local_joint_control pal_pcl_points_throttle_and_filter current_limit_controller hokuyo_node dynamixel_cpp pal_moveit_capabilities pal_pcl dynamic_footprint gravity_compensation_controller pal-orbbec-openni2 pal_loc_measure pal_map_manager ydlidar_ros_driver"

Then, you may proceed building the workspace:

  • source /opt/ros/noetic/setup.bash
    catkin build -DCATKIN_ENABLE_TESTING=0 -j $(expr `nproc` / 2)

Once you compiled all packages and source the environment (source ~/tiago_public_ws/devel/setup.bash) and it's all ready to go.

Wiki: Robots/TIAGo/Tutorials/Installation/InstallUbuntuAndROS (last edited 2023-02-07 15:15:38 by thomaspeyrucain)