-
Notifications
You must be signed in to change notification settings - Fork 1
Commit
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
- Loading branch information
1 parent
a047556
commit 7ace33d
Showing
2 changed files
with
28 additions
and
0 deletions.
There are no files selected for viewing
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
27 changes: 27 additions & 0 deletions
27
moveit_studio_msgs/moveit_pro_controllers_msgs/msg/VelocityForceControllerState.msg
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,27 @@ | ||
# This message contains information about the internal state of the VelocityForceController. | ||
|
||
# Timestamps associated to this state. | ||
std_msgs/Header header | ||
|
||
# Joint names associated to the controller. | ||
# The order of the names is the same as the order of the joint positions, velocities and accelerations. | ||
string[] joint_names | ||
|
||
# The reference joint-space positions, velocities and accelerations, as computed by the setpoint generator. | ||
float64[] reference_joint_positions | ||
float64[] reference_joint_velocities | ||
float64[] reference_joint_accelerations | ||
|
||
# The current joint-space positions, velocities and accelerations, reported by the HW interface, or estimated internally. | ||
float64[] joint_positions | ||
float64[] joint_velocities | ||
float64[] joint_accelerations | ||
|
||
# The reference Cartesian pose, velocity and acceleration, as computed by the setpoint generator. | ||
geometry_msgs/Pose reference_cartesian_pose | ||
geometry_msgs/Twist reference_cartesian_velocity | ||
geometry_msgs/Twist reference_cartesian_acceleration | ||
|
||
# The current Cartesian pose and velocity, reported by the HW interface, or estimated internally. | ||
geometry_msgs/Pose cartesian_pose | ||
geometry_msgs/Twist cartesian_velocity |