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 Articlesensor 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 ArticleHow 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 ArticleHow 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 Articleposition 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 Articlemove 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 ArticleHow 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 ArticleTurtlebot'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 ArticleHow 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 ArticlePosition 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 Articleusing 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 Articleroscanopen + 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 ArticleGet 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 ArticleCanopen 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 ArticleTurtlebot2 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 Articleardrone2.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 ArticleHow 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 Articlepointcloud2 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 ArticleCalculate 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 ArticleCANopen - 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