Helpers for performing geometric transformations on geometry_msgs messages. More...
Functions | |
def | matrix_from_point_msg |
Get a translation matrix from a geometry_msgs/Point. | |
def | matrix_from_pose_msg |
Get a transformation matrix from a geometry_msgs/Pose. | |
def | matrix_from_quaternion_msg |
Get a rotation matrix from a geometry_msgs/Quaternion. | |
def | point_msg_from_matrix |
Get a geometry_msgs/Point from a transformation matrix. | |
def | pose_msg_from_matrix |
Get a geometry_msgs/Pose from a transformation matrix. | |
def | quaternion_msg_from_matrix |
Get a geometry_msgs/Quaternion from a transformation matrix. | |
def | rotate_pose_msg_about_origin |
Rotate a geometry_msgs/Pose. | |
def | rotate_pose_msg_by_euler_angles |
Rotate a geometry_msgs/Pose. | |
def | translate_pose_msg |
Translate a geometry_msgs/Pose. |
Helpers for performing geometric transformations on geometry_msgs messages.
def moveit_python.geometry.matrix_from_point_msg | ( | point | ) |
Get a translation matrix from a geometry_msgs/Point.
point | geometry_msgs/Point to turn into matrix |
Definition at line 36 of file geometry.py.
def moveit_python.geometry.matrix_from_pose_msg | ( | pose | ) |
Get a transformation matrix from a geometry_msgs/Pose.
pose | geometry_msgs/Pose to turn into matrix |
Definition at line 47 of file geometry.py.
def moveit_python.geometry.matrix_from_quaternion_msg | ( | quaternion | ) |
Get a rotation matrix from a geometry_msgs/Quaternion.
quaternion | geometry_msgs/Quaternion to turn into matrix |
Definition at line 41 of file geometry.py.
def moveit_python.geometry.point_msg_from_matrix | ( | transformation | ) |
Get a geometry_msgs/Point from a transformation matrix.
transformation | The matrix to convert to a point |
Definition at line 54 of file geometry.py.
def moveit_python.geometry.pose_msg_from_matrix | ( | transformation | ) |
Get a geometry_msgs/Pose from a transformation matrix.
transformation | The matrix to convert to a pose |
Definition at line 74 of file geometry.py.
def moveit_python.geometry.quaternion_msg_from_matrix | ( | transformation | ) |
Get a geometry_msgs/Quaternion from a transformation matrix.
transformation | The matrix to convert to a quaternion |
Definition at line 63 of file geometry.py.
def moveit_python.geometry.rotate_pose_msg_about_origin | ( | pose, | |
r, | |||
p, | |||
y | |||
) |
Rotate a geometry_msgs/Pose.
pose | The pose to rotate |
r | The roll |
p | The pitch |
y | The yaw |
Definition at line 105 of file geometry.py.
def moveit_python.geometry.rotate_pose_msg_by_euler_angles | ( | pose, | |
r, | |||
p, | |||
y | |||
) |
Rotate a geometry_msgs/Pose.
pose | The pose to rotate |
r | The roll |
p | The pitch |
y | The yaw |
Definition at line 95 of file geometry.py.
def moveit_python.geometry.translate_pose_msg | ( | pose, | |
x, | |||
y, | |||
z | |||
) |
Translate a geometry_msgs/Pose.
pose | The pose to translate |
x | The displacement in X coordinate axis |
y | The displacement in Y coordinate axis |
z | The displacement in Z coordinate axis |
Definition at line 85 of file geometry.py.