ee_cart_imped_msgs/StiffPoint Message

File: ee_cart_imped_msgs/StiffPoint.msg

Raw Message Definition

Header header
#The pose to achieve in the stiffness directions
geometry_msgs/Pose pose
#Wrench or stiffness for each dimension
geometry_msgs/Wrench wrench_or_stiffness
#The following are True if a force/torque should
#be exerted and False if a stiffness should be used.
bool isForceX
bool isForceY
bool isForceZ
bool isTorqueX
bool isTorqueY
bool isTorqueZ
#The time from the start of the trajectory that this
#point should be achieved.
duration time_from_start

Compact Message Definition

std_msgs/Header header
geometry_msgs/Pose pose
geometry_msgs/Wrench wrench_or_stiffness
bool isForceX
bool isForceY
bool isForceZ
bool isTorqueX
bool isTorqueY
bool isTorqueZ
duration time_from_start