Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed
Browsing latest articles
Browse All 89 View Live

How to plot position(x y z) and velocity of fixed frames(end-effector) in rqt ??

hi . i want plot position and velocity of end effector that have fixed joint using rqt. How to plot position(x y z) and velocity of fixed frames(end-effector) in rqt ??

View Article


How to plot position(x y z) of frames(end-effector) in rqt ??

hi . i have a arm robot like this. ![image description](http://teaching.csse.uwa.edu.au/units/CITS3241/Labs/lab1diag.gif) how can i plot position(x y z) for end-effector in rqt ??

View Article


sensor position amcl

Hey everyone, how i can tell AMCL the position of my laserscanner? the sensor is not in the centre of the robot. so everytime the robot turns, the amcl loses the orientation. Thank you very much! Link

View Article

How to get joint position(x,y,z) of a robotic arm

I know that I can get joint angles of each joint from /joint_state topic of a urdf robotics arm. How to get a joint position(x,y,z) of each joint.Whether there is any other topic publishing it?

View Article

How can I get a certern link's position not in rviz?

I want write a certern link position(x,y,z) to a txt file.Which function do i need? Where does the date of link's position store?THX!!

View Article


position and orientation of an object relatively to camera

Hey there, I am trying to determine the exact position and orientation of an object relatively to a camera. The camera shall take a picture of a checkerboard marker and by evaluating it, I want to find...

View Article

move baxter end effector position regardless of orientation

I downloaded these codes from the link https://groups.google.com/a/rethinkrobotics.com/forum/#!topic/brr-users first code ik_solver.py import argparse import sys import rospy from geometry_msgs.msg...

View Article

How to relate the variation of force on an axis as a function of time to...

Hello, If we have the variation of the force as a function of time, how we can make a direct relation with the variation of the position.

View Article


Turtlebot's position doesn't make sense on gmapping

Hi everyone, I have turtlebot2 and I am using the gampping package to implement SLAM. When I remote turtlebot to use kinect to scan the environment, I watch the RVIZ to check the map result. But even...

View Article


How to pass the position values (xyz) to the inverse kinematics server in C++?

I am trying to make an Inverse Kinematics service which gets the xyz manually and respond with joint angles. The problem I am facing is the way I could pass these X Y Z values. How do I deal with...

View Article

Position and orientation of arrow

Dear Ros User, as information I have a marker ARROW defined as starting point and end point. I would like to represent the same information as geometry_msgs::Pose, so basically I would need to get...

View Article

using JointState.position in transformations

Hi all, Can I directly use the joinstate.position[i] for rotation or should there be some processing when rotating successive joints other than the first one? This is with reference to forward...

View Article

roscanopen + cyclic position mode + nanotec controller

Hello all, I have a nanotec integrated servo controller (the PD6-CB87S048030-E-09), with support for CanOpen in DS402 profile. I am wondering about the cyclic synchronous position mode, which is...

View Article


Get Modelstate Information for Turlebot

Hello Guys, I run ros Kinetic with gazebo 7.0. My project is a turtlebot who should drive to several objects and try to push them away after a try he should drive to the middle of the room again and...

View Article

Canopen Position Control Without Mode 7

I tried to control my own robot arm using moveit by canopen protocol, but my driver is not supported to use interpolate position mode, which is mode 7. It only has profiled position mode, profiled...

View Article


Turtlebot2 with Gmapping;How do I let the position jump to the position I want

As we all know. Gmapping uses /odom and /scan information to create a map. But when the robot is walking. It will encounter some pits causing odom error. Because the odom error, robot's position will...

View Article

ardrone2.0s coordinate system

Hy community! I am writing my thesis at the university about **Localization and navigation of ARDrone 2.0**. I have read all of the available topics and documentations for the ros support of ardrone,...

View Article


How can I find the index of the cell from map coordinates ?

Hi I have the (x,y,z) position of the map. From that information, how can I find the cell index and also costmap value(free, obstacle ...) related to this coordinates ? thanks

View Article

pointcloud2 and path planning

currently running ubuntu 16.04, ros kinetic, using gazebo 7 simulation with a sawyer (intera 5.2), running kinect camera. I want to take a point from a point cloud (type `PointCloud2`) taken from the...

View Article

Calculate position of robot

Hi, I would like to know if there is a method to calculate the position of a robot based on angular velocity and accelerations. I would like, from a start position, to move my robot and, based on...

View Article

CANopen - Maxon MCD Epos Error 6061sub0

Hi all, I'm trying to control the robot described in [q#292882](https://answers.ros.org/question/292882/how-to-control-maxon-mcd-epos-with-ros_canopen-and-ixxat-adapter/), as that question is more...

View Article


Hector Quadrotor Demo: Take Off Not Working.

Hello, I am trying to use the `hector_quadrotor_demo`, but the UAV is not taking off. I followed the [wiki](http://wiki.ros.org/hector_quadrotor/Tutorials/Quadrotor%20outdoor%20flight%20demo "Quadrotor...

View Article


Ros gazebo elevator

Hello eveyrone, I am trying to implement an elevator in my world file. For that I am using the file elevator.world, but the problem is that I would like to put the elevator in another position instead...

View Article

Turtle_sim go_to_goal loop, keeps going in circle

Hi I would like to tell the turtle sim to go to random coordinates from 0 to 10 in loop. For instance go to x,y then pause for a few seconds then go to a different x and y. I tried changing the script...

View Article

Change URDF link position

Hi, I have a lab setup in urdf, which I am using in RViz / MoveIt!. Based on the real world calibration, I would like to move some objects a bit (a table with an offset). The link is connected to the...

View Article


How to respawn kobuki or turtlebot on Gazebo

I'm trying reinforcement learning on Gazebo. If robot hit the wall,bumper sensor reaction. So, I wanna respawn robot in start position. Sorry my poor English.Do you have any idea?

View Article

Navigation of robot to goal point/Turning until robot faces goal-direction

Hey there, I'm currently working on a project about navigating a robot to a goal point. I already wrote some code to tackle this task. The code uses the gazebo/modelstates topic to get the position and...

View Article

Getting odom transform same as RVIZ (Python)

Hi, I'm trying to get the XYZ position of the odom frame. In particular I just want the xy position, not fussed about height change (z). As you can see in the picture, only one of the values is close,...

View Article

`tf static_transform_publisher` removes link instead of linking two tf trees

When using `static_transform_publisher`, attempting to link to coordinate systems via a common frame the publisher removes the link from one tree and places it in the other. This happens both with `tf`...

View Article



GAZEBO usage of set_model_state (to set object position)

Dear community, COARSE PROBLEM DEFINITION: I want to use the system (ROS+GAZEBO) as simulation environment for image based machine learning. Therefore I tried both having a camera on a robot and having...

View Article
Browsing latest articles
Browse All 89 View Live


<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>