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

what is the correct format of JointTrajectoryPoint? #115

Closed inksci closed 6 years ago

inksci commented 6 years ago

I always get such error: error: field points[] must be of type [trajectory_msgs/JointTrajectoryPoint] I do not know the correct format of JointTrajectoryPoint, can anybody give me an example?

tfoote commented 6 years ago

Please ask questions on https://answers.ros.org following our support guidelines: http://wiki.ros.org/Support

We look to keep the issue trackers focused on development.