All Projects → boschresearch → pcg_gazebo

boschresearch / pcg_gazebo

Licence: Apache-2.0 license
Procedural Generation for Gazebo

Programming Languages

python
139335 projects - #7 most used programming language
Jinja
831 projects

Projects that are alternatives of or similar to pcg gazebo

linorobot2
Autonomous mobile robots (2WD, 4WD, Mecanum Drive)
Stars: ✭ 97 (+94%)
Mutual labels:  gazebo
turtlebot rrt
Rapidly Exploring Random Tree (RRT) global path planning plugin for ROS Kinetic Kame
Stars: ✭ 86 (+72%)
Mutual labels:  gazebo
ZeroSimROSUnity
Robotic simulation in Unity with ROS integration.
Stars: ✭ 112 (+124%)
Mutual labels:  gazebo
Autonomus Indoor Drone
Final year project, autonomus indoor drone developed in ROS using DWM1001 dev-board
Stars: ✭ 26 (-48%)
Mutual labels:  gazebo
Autonomous-Drifting
Autonomous Drifting using Reinforcement Learning
Stars: ✭ 83 (+66%)
Mutual labels:  gazebo
diffbot
DiffBot is an autonomous 2wd differential drive robot using ROS Noetic on a Raspberry Pi 4 B. With its SLAMTEC Lidar and the ROS Control hardware interface it's capable of navigating in an environment using the ROS Navigation stack and making use of SLAM algorithms to create maps of unknown environments.
Stars: ✭ 172 (+244%)
Mutual labels:  gazebo
ardupilot gazebo
Repository for ArduPilot & Gazebo Software In Loop Simulation Interfaces, Models
Stars: ✭ 52 (+4%)
Mutual labels:  gazebo
motion-planner-reinforcement-learning
End to end motion planner using Deep Deterministic Policy Gradient (DDPG) in gazebo
Stars: ✭ 99 (+98%)
Mutual labels:  gazebo
summit xl sim
Packages for the simulation of the Summit XL, Summit XL HL and Summit-X (including X-WAM) robots
Stars: ✭ 32 (-36%)
Mutual labels:  gazebo
pcg gazebo pkgs
[DEPRECATED] Procedural generation library for Gazebo (please refer to https://github.com/boschresearch/pcg_gazebo)
Stars: ✭ 39 (-22%)
Mutual labels:  gazebo
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+220%)
Mutual labels:  gazebo
ur-reaching-reinforcement-learning
Reinforcement learning using rlkit, UR5, Robotiq gripper on ROS(Robot Operating System)
Stars: ✭ 53 (+6%)
Mutual labels:  gazebo
dockerfiles
Dockerfiles I use for development
Stars: ✭ 64 (+28%)
Mutual labels:  gazebo
ar-tu-do
ROS & Gazebo project for 1/10th scale self-driving race cars
Stars: ✭ 65 (+30%)
Mutual labels:  gazebo
curio
ROS packages to control a version of Roger Chen's Sawppy Rover.
Stars: ✭ 38 (-24%)
Mutual labels:  gazebo
smart grasping sandbox
A public sandbox for Shadow's Smart Grasping System
Stars: ✭ 69 (+38%)
Mutual labels:  gazebo
open manipulator simulations
ROS Simulation for OpenManipulator
Stars: ✭ 15 (-70%)
Mutual labels:  gazebo
iq sim
example gazebo ardupilot simulation package
Stars: ✭ 60 (+20%)
Mutual labels:  gazebo
ign-rendering
C++ library designed to provide an abstraction for different rendering engines. It offers unified APIs for creating 3D graphics applications.
Stars: ✭ 34 (-32%)
Mutual labels:  gazebo
Autonomous-Parking-System
Automatic Parking is an autonomous car maneuvering system (part of ADAS) that moves a vehicle from a traffic lane into a parking spot to perform parallel parking. The automatic parking system aims to enhance the comfort and safety of driving in constrained environments where much attention and experience is required to steer the car. The parking…
Stars: ✭ 39 (-22%)
Mutual labels:  gazebo

pcg_gazebo: A Python package for rapid-prototyping and scripting of simulations for Gazebo

Python application Discord GitHub issues License PyPI PyPI - Python Version

The pcg_gazebo Python package is an Open Source Project extending the simulation capabilities of the robotics simulator Gazebo for automation and scripting of Gazebo simulations.

Visit the documentation page for more information.

Purpose of the project

This software is a research prototype.

The software is not ready for production use. It has neither been developed nor tested for a specific use case. However, the license conditions of the applicable Open Source licenses allow you to adapt the software to your needs. Before using it in a safety relevant setting, make sure that the software fulfills your requirements and adjust it according to any applicable safety standards (e.g. ISO 26262).

Installation

Using pip

You can install the pcg-gazebo package using pip as follows

pip install pcg-gazebo

you still might need to install some extra dependencies that cannot be handled by pip as

sudo apt install libspatialindex-dev pybind11-dev libgeos-dev

Give some issues with the package rtree on pip, it would also be recommended to install it from apt. Please install python-rtree if you are using Python 2.x or python3-rtree for Python 3.x.

The default installation does not include rospy dependencies that are not available as a pip package. They have to be installed separately for certain submodules to work, such as pcg_gazebo.task_manager.

From source

First install some non-Python dependencies

sudo apt install libspatialindex-dev pybind11-dev libgeos-dev libfcl-dev liboctomap-dev

Then clone the repository and install it using pip

git clone https://github.com/boschresearch/pcg_gazebo.git
cd pcg_gazebo
pip install .

Using the package with ROS and Gazebo

Certain functionalities as the Gazebo proxy, task manager and model spawning are only available if rospy is installed. The lack of Gazebo and rospy only restricts functionalities related to interaction with the simulation in runtime and the creation of ROS-related tasks.

At the moment, ROS 2 is not supported for this purpose. To install ROS melodic, follow these installation instructions and install ros-melodic-desktop-full or separately install Gazebo and its ROS bindings as

sudo apt install gazebo9 libgazebo9-dev ros-melodic-gazebo-*

License

Procedural Generation for Gazebo is open-sourced under the Apache-2.0 license. See the LICENSE file for details.

For a list of other open source components included in Procedural Generation for Gazebo package, see the file 3rd-party-licenses.

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].