exact rotational speed of a wheel
hello there, i was wondering if there is a way of calculating or extracting the exact rotational speed of each wheel of a jackal from ROS or Gazebo. is there a topic containing this information? i need...
View Articlepublishing to /cmd_vel gives error
hey everyone, i am trying to let my jackal drive with this custom node : #! /usr/bin/env python import rospy from geometry_msgs.msg import Twist from sensor_msgs.msg import LaserScan def...
View Articleextract, alter, publish
hey everyone, im forever trying to subscribe to a topic (gazebo/link_states) alter the info and publish it again so i can use it for other nodes. however. i cant get it to work with a seperate...
View Articlegazebo set joint angles by ROS
Hi everyone! I have a robot arm model in Gazebo with several "revolute" joints. I simply want to set the angles of the joints by a ROS service, topic or whatever WITHOUT any closed-loop controller....
View ArticleCostmap2D: Observation layer's laser scan callback is never called with a low...
Hi, I'm facing an issue (that seem to be) related to the navigation stack's costmap. Summary of the problem: The obstacle layer's laser scanner callback is never called with a low publication...
View Articleunknown_publisher: Ignoring transform for child_frame_id "link1"
Hello. Currently I want to simulate random robot, which not provide ROS related files at all, to ROS environment. Most of manufacturer provide 3D cad file(.step). And I do some search to make urdf file...
View ArticleUse gazebo world file objects for planning with Moveit
Hello, I was wondering if there is a way to use the gazebo world objects in the .world file for planning with Moveit in code? When I write them as collision objects within C++ code, they appear in rviz...
View ArticleHow to add ROS topic to the Intel Realsense plugin ?
Hi everyone, I am trying to get the topics that are published by my [simulated Realsense camera](https://github.com/intel/gazebo-realsense) back to ROS, but I haven't been successful yet. I tried by...
View ArticlePanda robot falls in gazebo
Hello, I'm following [ROS_Control tutorial](http://gazebosim.org/tutorials/?tut=ros_control) and adapting all the instructions for panda robot. I have generated the Gazebo compatible of URDF of panda...
View ArticlePanda robot oscillates in gazebo after spawning
Hello, I'm following [ROS_Control tutorial](http://gazebosim.org/tutorials/?tut=ros_control) and adapting all the instructions for panda robot. I have generated the Gazebo compatible of URDF of panda...
View Articlehow to include dynamics to robots
I am working with Gazebo and Rviz with motion planning plugin. I am trying to work out motion planning for a robot I designed. How do I include the dynamics of the robot to simulate the motion...
View ArticleError: Joint is missing a parent and/or child
Hi all, I'm trying to build a robotic arm, but I'm having troubles when I create the macro to simplify the code. I have the next error: Failed to build tree: Joint [module_1_length_yaw_joint] is...
View ArticleNo shadows or lights in Gazebo
Hi there! I'm having trouble setting up a light in Gazebo. I tried with sunlight, directional light and spot light, and the results of each of those are quite similar, something like this. ![image...
View ArticleQOBJECTS TIMMERS CANNOT BE STOPPED FROM ANOTHER THREAD
HI guys , im coding a multi-robot , in ros kinetic with python and gazebo, MY mission is make one robot find a yellow cube in scenario. then get that location and send to second robot im trying to...
View ArticleUnmet dependencies: ros-kinetic-gazebo-ros-control : Depends:...
I am using Ubuntu 16.04 ROS kinetic. Trying to install gazebo_ros pkgs, but gets the following error. J@VRL:~/catkin_ws$ sudo apt-get install ros-kinetic-gazebo-ros-pkgs ros-kinetic-gazebo-ros-control...
View ArticleMoveit Gazebo Integration for trajectory execution of panda robot
Hello, I want to view the trajectory generated by moveit in gazebo. I have done motion planning using moveit c++ interface and i'm observing the robot movement in Rviz. The code moveit c++ interface...
View ArticlePart of the robot (UR5 with robotiq gripper) not showing up in gazebo
Hi, I'm working on a simulation combining the UR5 arm and a robotiq 2-finger gripper together. The arm shows up completely in gazebo, but the base of the gripper does not show up despite added...
View ArticleWhere is the File Menu in Gazebo 7?
I installed Gazebo 7 on my Jetson TX2, and it has no File menu. Is this just how Gazebo 7 is, or have I got some funny glitch? I can't find a way to return back to the simulation after editing an...
View ArticleI want to change the topic frame of hokuyo node from laser to map.
Hello. I am a ROS beginner. I am doing SLAM of turtlebot 2 in the ubuntu 14.04, ros (indigo) personal computer environment. I would like to install a URG because I want the sensor to send close range...
View ArticleHow to get gazebo world frame in rviz and add to tf tree
Hello, i am using ROS Kinetic and gazebo version 7.12.0. I am trying to validate how well my robot is moving and my performance specs. I would like to compare the data of the robot's pose with the...
View Article