ros / common_msgs

Commonly used messages in ROS. Includes messages for actions (actionlib_msgs), diagnostics (diagnostic_msgs), geometric primitives (geometry_msgs), robot navigation (nav_msgs), and common sensors (sensor_msgs), such as laser range finders, cameras, point clouds.
http://wiki.ros.org/common_msgs
179 stars 191 forks source link

MultiDOFJointTrajectoryPoint message does not make sense #123

Closed adamconkey closed 6 years ago

adamconkey commented 6 years ago

By its name, the MultiDOFJointTrajectoryPoint should be encoding joint positions, velocities, and accelerations for an n-DOF manipulator. But it is using Cartesian space messages (Transform and Twist). This seems like it was a hack to get multi-DOF and can only go up to 6-DOF.

This message should probably not exist, MultiDOFJointTrajectory should accumulate JointTrajectory msgs along with the list of joint names, and there should be a CartesianTrajectory message, along with CartesianTrajectoryPoint, the latter having poses, twists, and wrenches.

adamconkey commented 6 years ago

Actually, I notice now that JointTrajectory is a multi-DOF trajectory, it has joint names and each JointTrajectoryPoint specifies a time instance of multiple DOFs. So I don't know what MultiDOFJointTrajectory(Point) is trying to achieve.

tfoote commented 6 years ago

This is specifically different from the JointTrajectoryPoint in that is supports MultiDOF Joints that cannot be represented by single DOF representations. In particular it's often used for expressing freespace trajectories.

adamconkey commented 6 years ago

Are you saying then that this is for single joints, with multiple degrees of freedom? I'm not sure I understand the use case. It still seems like this package lacks support for Cartesian trajectories where I want a list of poses, twists, and wrenches.

tfoote commented 6 years ago

The MultiDOFJointTrajectory specifically supports cartesian trajectories with poses, velocities, and accelerations expressed per "joint" as a time series. If you have more questions please use answers.ros.org following our Support Guidelines

adamconkey commented 6 years ago

Fair enough, I think it's misleading to put Joint in the message name though when it's not in joint space.