Questions tagged [gazebo-simu]

For questions about the Gazebo robot simulation tool

For questions about the Gazebo robot simulation tool

215 questions
1
vote
0 answers

Pressure topic is not published when add barometric pressure Sensor with geometry_msgs/PointStamped

To use http://wiki.ros.org/hector_pose_estimation?distro=noetic hector_pose_estimation package i need to fuse IMU and barometric pressure Sensor with geometry_msgs/PointStamped So I add such barometric pressure Sensor with geometry_msgs/PointStamped…
Bob9710
  • 205
  • 3
  • 15
1
vote
1 answer

How to get robot's pose estimation data from the SLAM algorithm?

I would like to do an evaluation of the localization of the robot which is pose estimation between the SLAM algorithm (gmapping package) and the ground truth. I've acquired the ground truth data from the /ground_truth/state topic and I got the data…
AmirulJ
  • 118
  • 1
  • 11
1
vote
1 answer

How do I get my robot coordinates in (x,y,z) using hector_gazebo_plugin and python2?

I have a quadrotor, and I want to read its position in (x,y,z) using hector_gazebo_plugin and python. For now I am using libhector_gazebo_ros_gps.so file to get the latitude and longitude of the quadrotor. But I would like to have the position of…
Monojit Sarkar
  • 657
  • 1
  • 5
  • 15
1
vote
1 answer

How to publish a new topic to slam gmapping package in multiple-robot

I have used this command in the terminal to publish /scan_new topic to the gmapping package in tb3_0 robot ROS_NAMESPACE=tb3_0 rosrun gmapping slam_gmapping scan:=scan_new set_base_frame:=tb3_0/base_footprint set_odom_frame:=tb3_0/odom…
AmirulJ
  • 118
  • 1
  • 11
1
vote
0 answers

Error while building px4_sitl in Ubuntu 18.04 LTS

Error while building px4_sitl gazebo... please help me I referenced this link. input command : make px4_sitl gazebo os : Ubuntu 18.04 lts Here's my terminal log : xxxx@xxxx-OMEN-30L-Desktop-GT13-1xxx:~/PX4-Autopilot$ make px4_sitl gazebo --- skip…
eungbin
  • 23
  • 4
1
vote
2 answers

Message received by subscriber only after input() command

My gazebo model can move to a given goal destination. so far the goal was given by user input as such: goal_pose.x = float(input("Set your x goal: ")) goal_pose.y = float(input("Set your y goal: ")) I want to send the goal destination through a…
oferb
  • 91
  • 5
1
vote
0 answers

Gazebo Node::Advertise(): Error advertising a topic. Did you forget to start the discovery service?

When I insert a box in ModelEditor, and change some pose parameter in link tab, but the box is not changed by the parameters. Then I checked the teminator and it printed error Node::Advertise(): Error advertising a topic. Did you forget to start the…
FuBao Nie
  • 11
  • 1
  • 5
1
vote
0 answers

Cannot install gazebojs. Getting NPM errors during installation

I have been trying to use the Gazebo simulator on Mac. I have been able to install the prerequisites as mentioned here: Gazebo installation on Mac I am just not able to install GazeboJs. When I use the following command in terminal: npm install…
Schubi
  • 11
  • 1
1
vote
0 answers

Error using Rviz and Gazebo in Docker container

I'm having some problems to use GUI Applications in my docker container. I am using a docker image based on the nvidia/cuda:10.2-runtime-ubuntu18.04 . Everything apparently works correctly inside mi docker container, but when I try to run gazebo, I…
oramos
  • 31
  • 1
  • 2
1
vote
1 answer

ROS and Gazebo: model problems when loading joint controllers

I'm trying to control a gazebo robot using ros control but I have some problems after I load the controllers. This is the robot model before I load the joint controllers, the model is correct. When I load the joint controllers I get this result, the…
1
vote
1 answer

Change parameters during robot learning using simulators (Webots, Gazebo, etc)

I am searching a simulator for my robot learning research. In the learning process, I need to change parameters of both environment (friction coefficients, terrain height in the world) and robot itself (mass, inertia). How can simulators like Gazebo…
1
vote
2 answers

Use specific protobuf version when multiple versions are installed

I am trying to compile the gazebo example provided by PX4, according to PX4's instructions. I am working on Ubuntu-18.04. When running the command: make px4_sitl gazebo, following error occurs: ... In file included from Range.pb.h:27:0, …
LoW
  • 582
  • 7
  • 15
1
vote
2 answers

How to convert a Gazebo world to a point cloud?

I am using the PX4 toolchain to build an autonomous UAV. I am using it through the Gazebo simulator, using ROS and MAVROS. For now, I need to work on path finding algorithms, not sensors, so I would like a "ground truth" map of a Gazebo simulation.…
R. Hidra
  • 21
  • 6
1
vote
0 answers

Turtlebot3 Ros1 Windows setup issue

This is the console output for command catkin_make I am currently trying to setup a virtual environment for the turtlebot3 based on the windows variation: https://emanual.robotis.com/docs/en/platform/turtlebot3/pc_setup/ Setting up Ros1 under…
1
vote
1 answer

Getting 3D world coordinate from (x,y) pixel coordinates

I'm absolutely new to ROS/Gazebo world; this is probably a simple question, but I cannot find a good answer. I have a simulated depth camera (Kinect) in a Gazebo scene. After some elaborations, I get a point of interest in the RGB image in pixel…
tuixte
  • 23
  • 1
  • 5