Quantcast
Channel: Gazebo: Q&A Forum - RSS feed
↧

URI paths to packages in the SDF model file?

Hi All, I'm trying to create a SDF from COLLADA files I have already. However, the files I'm trying to link to are located in different files (I'm trying to load a sensor on the robot). In URDFs I...

View Article


Tricycle drive plugin: Impossible to control linear and angular speed at the...

Hello, I believe there is a bug in the tricycle plugin. I'm testing the ROS2 Galactic version of the plugin:...

View Article


How to generate a 3D occupancy map for a Gazebo world

Given a Gazebo world, is there a way to generate a 3D occupancy map? I want a 3D matrix of 0s/1s so that I can use it for path planning algorithms.

View Article

Gazebo allows one model to be inserted and then it freezes

Hello, I am trying to insert a custom model into gazebo but most of the time upon inserting the first model it sits on the floor and then when inserting another of the same model nothing happens. If I...

View Article

Create voxel map from a gazebo world

Hello, Is there a way to generate a Voxel map of a Gazebo world without using mapping algorithms & robotic sensors?

View Article


Can I apply zero gravity on .urdf models?

HI there. I am trying to implement Gazebo simulation for space environment using International Space Station(ISS) urdf model. I wants to ISS urdf model apply zero gravity but it doesn`t work. Can I...

View Article

Contact Sensor Plugin does not Provide all information

When trying to include a contact sensor plugin, the plugin only publishes the contact positions but does not publish contact wrenches or depth. This is also the case when you run the...

View Article

include model in world 2023

What is the procedure to add a custom model to a .world file (using Gazebo Fortress)? I installed Gazebo Fortress on Ubuntu 22.04 using the Fortress binary at https://gazebosim.org/docs. I also have...

View Article


[gazebo-1]; process has died [pid 3631, exit code 139

After running my launch file I got this error: gazebo has problem INFO] [1690533387.960548, 0.695000]: Controller Spawner: Loaded controllers: joint_state_controller, robot_arm_controller,...

View Article


How to add multiple HWSim instances in gazebo?

I am simulating a [franka panda arm](https://frankaemika.github.io/docs/) mounted with [shadowhand](https://shadow-robot-company-dexterous-hand.readthedocs-hosted.com/en/latest/index.html) in Gazebo....

View Article

How to communicate Gazebo in Ubuntu with ROS Melodic and Unity 3d in Windows

I need to make a demo where I can see how the robot in Gazebo moves in the same way the robot in Unity. I'm using in this case a turtlebot3 burger. For the communication between ROS and Unity i'm using...

View Article

Cannot locate rosdep definition for gz-transport12 and gz-math7 after...

Hi, my question is similar to [this](https://answers.gazebosim.org/question/28756/why-install-rolling-sources-for-rosdep-when-using-humble-for-ros_gz/). The difference is I am building Gazebo Garden...

View Article

Close-loop kinematics in URDF and SDF

Hello everyone, I am trying to find a working solution to close some joints sharing the same child link. Particularly, I'm trying to describe in URDF and SDF an Ackermann suspension:...

View Article


How to simulate a "Vaccum" or a suction action?

Hi, I'm new to gazebo and ROS, I apolagize if my question may not make sens, I'm currently looking for a way to simulate suction or vacuum like effect , (not to pick object) it's more of a vaccuming...

View Article

help for installing lidar on a drone

Hi all, I'm trying to install a lidar on a drone (x500, model provided by PX4 repo). I found several examples, but all seems outdated. For the plugin, an example give the name of...

View Article


Start actor trajectory from plugin

Hello, I'm new to plugin development in Gazebo, i am trying to start an Actor trajectory from a Plugin during simulation execution. I added a simple actor in my world description (sdf file). Like this...

View Article

Gazebo sim code concepts

Dear all, I was looking into the conveyor demo and specifically [why it didn't work](https://github.com/gazebosim/gz-sim/issues/1662#issuecomment-1485840870). As it turns out it is due to a patch not...

View Article


Gazebo garden : Plugin for FOV distortion model

Hi! I see that gazebo garden is using the Brown Conrady radian distortion model. For my research however, I would need to use the FOV distortion model from "Devernay, F., Faugeras, O. Straight lines...

View Article

HOW TO CREATE QR CODE IN GAZEBO11

I want to create QR Code model in Gazebo11. I read many blog for this problem but i cannot solve. I want to give detail about my project, i want to add and scan qr code and using mobile robot such as...

View Article

Failed to load gz-sim-diff-drive-system

I'm trying to use gz-sim-diff-drive-system plugin like this:Revolute 10Revolute 90.20.041cmd_vel but receiving the following error when starting gazebo: [ruby $(which ign) gazebo-2] [Err]...

View Article

Mesh optimization for "fast" simulation

Hi, i created a robot model with some links. All links are meshes, like the UR10 from Universal Robotics has its shoulder_link, elbow_link and so on. For example the simulation for the UR-10 uses the...

View Article


How to get colliding entities with gpu_lidar sensor (ray)

Good morning, I open this question as I have not found a way to get the `model_entity` that collides with the `gpu_lidar` sensor. I would like to be able to attach with such entity, but I can't know...

View Article


How to get information between entities in contact with disabled physical...

Good morning, everyone, I am trying to get some information between two links in contact. These two links need to be able to interpenetrate into each other, so to do this I set the `` to get a bitwise...

View Article

Vibration in Gazebo model.

Hi, I am trying to create a sdf file for two wheel robot. I can see in gazebo window that my model is vibrating constantly, When I only run the base or wheel alone they don't vibrate. I am sharing my...

View Article

Gazebo Fortress Custom plugins causing scene to not load

Ubuntu 22.04 Gazebo: Ignition Fortress gazebo plugin: 1 Context, I've been trying to get a force sensor plugin working in gazebo fortress, however all the ones I've found are either for gazebo classic,...

View Article


Explain 'Exporting model paths from a package.xml section' of 'Using...

I was going through [this](https://classic.gazebosim.org/tutorials?tut=ros_roslaunch) tutorial on Gazebo-classic & wasn't able to understand...

View Article

How to access contact Information form via the EntityComponentManager?

I want to create a plugin that publishes the contact forces a specific link experiences along a particular local axis to a specific topic in order to simulate something similar to a pressure sensor. My...

View Article

Ground truth map for a gazebo world like the willowgarage model

Hi all, I use the turtlebot in the willowgarage world to create a semantic mapping system. As the actual mapping (using gmapping for example) is not the most important part of this effort, I would like...

View Article

Spawning multiple models causes error

I am working on spawning a custom farm where there are 5 types of crops. I am using python spawn code. When i load around 49 plants it goes very well (No error). but when i try to load more than that...

View Article



Spawning multiple models causes error

I am working on spawning a custom farm where there are 5 types of crops. I am using python spawn code. When i load around 49 plants it goes very well (No error). but when i try to load more than that...

View Article