Hi all,
I need to describe a cartesian trajectory using messages. This trajectory description should contain:
and each waypoint should contain:
The closest I could find in MoveIt is moveit_msgs/RobotTrajectory, but this describes configuration space, not the cartesian space. In common_msgs, I have stumbled accross:
Should I use any of the above messages? Another message not mentioned in my mail? Or a custom message?
Thanks,
Antoine.
There were a bunch of discussions about standardizing a Cartesian trajectory message specification about a year ago. If you're interested in restarting the conversion it would definitely benefit the community.
Check out the thread here:
https://groups.google.com/forum/m/#!forum/ros-sig-robot-control
-j
On Fri, Nov 7, 2014, 12:26 Moises Estrada <moi...@gmail.com> wrote:
Hi,
I use std::vector<geometry_msgs::Pose> waypoints to create my Cartesian trajectories, however it does not specify information about velocity or acceleration.
Then I use: group.computeCartesianPath(waypoints,
0.05, // eef_step
0.0, // jump_threshold
trajectory);To create the trajectory. However in my case the trajectory is incomplete as it does not contain time, velocity nor acceleration. So I use this to add it:
// Adding time parametrization to the "trajectory"
robot_trajectory::RobotTrajectory rt(group.getCurrentState()->getRobotModel(), "arm_gp");
rt.setRobotTrajectoryMsg(*group.getCurrentState(), trajectory);
trajectory_processing::IterativeParabolicTimeParameterization iptp;
bool success = iptp.computeTimeStamps(rt);
ROS_INFO("Computed time stamp %s",success?"SUCCEDED":"FAILED");
rt.getRobotTrajectoryMsg(trajectory);No I have the my trajectory well defined.
Hope that works out for you.
Moises.
On 11/07/2014 04:38 AM, Antoine Rennuit wrote:
Hi all,
I need to describe a cartesian trajectory using messages. This trajectory description should contain:
a reference framean array of waypoints
and each waypoint should contain:
a timea cartesian position (i.e. a transform or say a frame)a cartesian velocitya cartesian acceleration
The closest I could find in MoveIt is moveit_msgs/RobotTrajectory, but this describes configuration space, not the cartesian space. In common_msgs, I have stumbled accross:
trajectory_msgs/MultiDOFJointTrajectory: which does what I want but for (multiple) joints, I could use it for my case but this would be kind of a hack as this is supposed to describe joints, no?nav_msgs/Path: only includes positions (no speed, nor acceleration)