Installation
The following describes how to install the ROS-PyBullet Interface.
Requirements
ROS Noetic
Melodic, and past version should work fine (only Melodic has been tested) so long as you configure ROS to use Python 3
ROS2 is currently unsupported, however this is in-development
Ubuntu 20.04
Other versions should work, provided Python 3 is installed
Python 3
urdf_parser_py
, see here.
From binaries
Currently, this is in-progress.
From source
Create a catkin workspace or use an existing workspace. catkin_tools is the preferred build system.
cd
to thesrc
directory of your catkin workspace.Clone this repository:
$ git clone https://github.com/ros-pybullet/ros_pybullet_interface.git
Install source dependencies:
$ rosinstall . --catkin --nobuild
Install binary dependencies:
$ rosdep update ; rosdep install --from-paths ./ -iry
Compile the workspace:
$ catkin build -s
Source the workspace:
$ source $(catkin locate)/devel/setup.bash
Now you should be able to run the examples.