Questions tagged [gazebo-simu]

For questions about the Gazebo robot simulation tool

For questions about the Gazebo robot simulation tool

215 questions
0
votes
0 answers

PIONEER 3DX for gazebo ,ros noetic

I am new to ROS. My goal is to implement a slam algorithm on a pioneer 3dx robot. Where can I find a package for the PIONEER p3dx robot for ros noetic? Any assistance is appreciated I found a package for the aforementioned robot IN A git…
0
votes
0 answers

URDF Model joints fusing in Gazebo on launching controller

I simply need to simulate a revolute joint between a servo part and a beam part. The model was imported from Fusion360 using fusion2urdf plugin on github. model simulates fine on launching but when controller node is launched to control angle of…
0
votes
0 answers

ros2_control: No parameter file provided. Configuration might be wrong. failed to parse input yaml file(s)

I am trying to build a 4 wheel differential drive robot. But i am getting error when using ros2_control. I am getting the following error "No parameter file provided. Configuration might be wrong. failed to parse input yaml file(s)" in terminal. …
0
votes
0 answers

No module name 'rosgraph' error when i try to run a simulation in ros2

import os from ament_index_python.packages import get_package_share_directory from launch import LaunchDescription from launch.substitutions import LaunchConfiguration, Command from launch.actions import DeclareLaunchArgument from…
0
votes
2 answers

Parser error Couldn't parse params file - Trying to load YAML file

I have been searching for a solution to my problem but am unable to find any solutions for my problem that are also using Python. I am trying to run Universal Robot's UR10e in gazebo and control it using ROS2_control. I am running ROS2 Iron and…
0
votes
2 answers

Gazebo crashes immediately on startup on Ubuntu 22.04 ARM VM on parallels desktop in MacBook Air M1

So I'm working with ROS2 on my MacBook air M1 and need gazebo for simulations. The OS I'm working with is Ubuntu 22.04 ARM on Parallels Desktop 18. I'm running ros2 Humble, and its gazebo counterpart Gazebo Gardens. Rviz is running just fine, but…
Nike Lepz
  • 485
  • 2
  • 12
0
votes
0 answers

ROS-Noetic OpenCV/AR Tag Detection

I found this code in blog about OpenCV and i rewrite for using ROS gazebo simulation. I got many error about marker`finding. I will add the error below. #!/usr/bin/env python3 # -*- coding: utf-8 -*- from imutils import paths import numpy as…
duygud
  • 1
0
votes
0 answers

Control an arm mounted on a mobile platform using moveit

In my project, have an urdf file of a robotic arm as well as of a mobile platform. I am able to spawn them together in Gazebo simulation. I now want to use moveit to control both of them. For this I opened the MoveIt Setup Assitant and was able to…
wittn
  • 298
  • 5
  • 16
0
votes
1 answer

How to fixate to models to each other in Gazebo?

I have a project, in which I want to include two models a mir (https://github.com/DFKI-NI/mir_robot) and a ur10 (https://github.com/ros-industrial/universal_robot). My goal is, to fixate the ur10 on top of the mir. What I have done so far: Opened…
wittn
  • 298
  • 5
  • 16
0
votes
1 answer

In RViz and Gazebo, STL is displaced

I am following ROS2 example for robotic arm. The arm has couple of parts, represented by STL. Now, when I use the STL file that comes with the example, the arm is perfectly aligned. But when I use Tinkercad (tinkercad.com), which is probably the…
Steve Brown
  • 369
  • 1
  • 3
  • 12
0
votes
0 answers

conda ROS gazebo ardupilot gazebo

I use mac os m1. I installed anaconda and I create an envoirement ROS. I installed ROS, and gazebo was installed ROS. so I did not do anything to install gazebo. because after ros installing gazebo is ready. I want to use ardupilot_gazebo. and I…
0
votes
0 answers

VSCode intellisense says boost::shared_ptr requires 2 args gazebo transport

I am working with the c++ gazebo transport library (Ros2 Galactic, Gazebo 11 classic). I was confused as to why gazebo::transport::NodePtr gives the error namespace "gazebo::transport" has no member "NodePtr"C/C++(135) I traced the error to…
AFLEM
  • 1
  • 2
0
votes
0 answers

ImportError: No module named gym_gazebo

I am trying to install gym_gazebo on my Ubuntu 18.04 LTS system according to https://github.com/erlerobot/gym-gazebo Everything is getting installed correctly, however, while trying to run python circuit2_turtlebot_lidar_qlearn.py , I get error…
0
votes
0 answers

STUCK IN PYBULLET SIMULATION( FORCE CONTROL)

i am new to pybullet and wanted to simulate a UR5 bot doing ultrasound on humans. For that i've loaded a ur5 bot and a soccerball{example for human) , i want the end effector to apply a constant 2N force on the surface of the Soccer while moving and…
0
votes
0 answers

Gazebo Kinect Plugin Point Transformation for RayShape

I'm trying to simulate a stackingbox with some elements and create a PointCloud with the kinect camera and now im trying to label these points with the ids of the elements with an rayshape The cam is at "0.0 0.0 1.9 0.0 1.5707963267948966 0.0" so i…
kingingo
  • 29
  • 5