Questions tagged [gazebo-simu]

For questions about the Gazebo robot simulation tool

For questions about the Gazebo robot simulation tool

215 questions
0
votes
1 answer

Error " invalid -j parameter" while running "make px4_sitl_default gazebo"

I am running command "make px4_sitl_default gazebo" on Ubuntu18.04(VM) to work with px4 and gazebo, I install all dependencies as shown in http://docs.px4.io/master/en/simulation/gazebo.html however, I am getting the below error every time. I…
0
votes
0 answers

How can a ROS Topic has publisher None?

I'm new to ROS and exploring it by using the Husky robot. So when I checked topics after launching it with Gazebo, some of the topics have publisher None: $rostopic info /husky_velocity_controller/odom Type: nav_msgs/Odometry Publishers:…
0
votes
1 answer

How can I choose CPU to run python script?

I want to run 2 different program at the same time. First one is a python script. Other program is a simulation program (Gazebo). Briefly, I want to send command from python script to Gazebo simulation. I already know ROS and multiprocessing but my…
0
votes
1 answer

Gazebo on ubuntu of virtual machine, no response

My gazebo on virtual machine is not stable. Every time I click insert and then add path, the software will have no response.
james_66
  • 1
  • 5
0
votes
1 answer

How can I control and receive video stream from SITL drone using px4,gazebo and C++ without using ROS?

I want to program a drone to fly with a C++ project using image processing analysis in real-time (using OpenCV). I want to do it with PX4, Gazebo simulator. The final goal is to run the project on a real drone using Jetson-Nano and Pixhawk drone. I…
Roy Amoyal
  • 717
  • 4
  • 14
0
votes
1 answer

How can I use a .URDF sensor on a .SDF robot on ROS and Gazebo?

maybe it's a silly question but I am a beginner. I have a Firmware of a flight controller called PX4, here it is: https://github.com/PX4/PX4-Autopilot That Firmware contains SITL Gazebo tools so I can simulate in gazebo some models which are…
Paco Murso
  • 11
  • 4
0
votes
0 answers

Hector Pose Estimation not correct Frames, and how to use it correctly?

Im doing some underwater UUV Gazebo simulation and would like to use the hector_pose_estimation package to fuse IMU and Fluid pressure sensors input for pose estimation. In the gazebo launch file I add this tf transformation
Bob9710
  • 205
  • 3
  • 15
0
votes
1 answer

How to subscribe "/scan" topic, modify the messages and publish to the new topic?

I would like to improve the LDS-01 sensor of the turtlebot3 by subscribing the message.ranges, modify the messange.ranges by applying some algorithm and publish it to the new topic as shown below. But there are an error when I run the coding. The…
AmirulJ
  • 118
  • 1
  • 11
0
votes
1 answer

error : destination path 'gazebo' already exists; when trying to clone model repository for gazebo robotics simulator

i,m using Ubuntu 20.04 and installed Gazebo11 when i tried to download (clone) gazebosim models repository for 1st time after installation (to use them when i,m offline and have no internet connections) using this command in terminal : git clone…
Curious guy
  • 13
  • 1
  • 8
0
votes
1 answer

How to subscribe "/scan" topic, modify the messages and publish it again to the "/scan" topic?

I would like to improve turtlebot3 LDS-01 sensor by applying some algorithm to the sensor. So my strategy is to improve and modify the value of Laserscan.ranges (which is the distance between the sensor to the obstacles) by subscribing the “/scan”…
AmirulJ
  • 118
  • 1
  • 11
0
votes
1 answer

How to comunicate the Raspberry Pi 4 with a PC (runing Gazebo) and get sensors topic on the Pi?

I have running some UUV simulator on Gazebo 9 and ROS melodic and Ubuntu 18.04 in a PC. So i like to connect the rasppbery Pi 4 with the PC (running the Gazebo UUV Simulator) and develop a node in the Rasppbery Pi that give me for example the Camera…
Bob9710
  • 205
  • 3
  • 15
0
votes
1 answer

How to set the real time factor on gazebo to 1?

I got a question regarding the timing in Gazebo and ROS. I have a car robot (with velodyne vlp16 LiDAR) which uses Gazebo plugins and some ROS packages. I'm aiming to detect the position of obstacle by moving the car and i would like to synchronize…
Stivmab
  • 1
  • 1
0
votes
1 answer

xacro prase the value from YAML by giving variable

Environment: ROS Noetic, Gazebo11 I try to use xacro with YAML, but there is a problem about argument of variable: My yaml: --- color_0: "1 1 1 1.0" color_1: "0 0 0 1.0" color_2: "0.84 0 0 1.0" color_3: "0.55 0.24 1 1.0" color_4: "0.01…
NEET
  • 61
  • 1
  • 2
  • 11
0
votes
1 answer

Ground Plane Image Contrast Improvement

I have been trying to add this image into the gazebo for the drone to scan. I followed this tutorial (https://magiccvs.byu.edu/wiki/#!gazeb...), but the image inside the gazebo appeared to be darker than the original. I've tried changing the…
0
votes
1 answer

Co-simulation between MatLab and Gazebo

I want to control a robotic manipulator using co-simulation between Simulink and Gazebo. I created a Gazebo plugin package by running the packageGazeboPlugin command in Matlab and then compiled it in the user/home directory. I copied…
maria
  • 1
  • 2