3 from geometry_msgs.msg
import (Point, Pose, Quaternion, TransformStamped,
16 return Point(x=x, y=y, z=z)
24 return (p.x, p.y, p.z)
30 return Quaternion(x=x, y=y, z=z, w=w)
38 return (o.x, o.y, o.z, o.w)
44 return Vector3(x=x, y=y, z=z)
52 return (v.x, v.y, v.z)
63 t = TransformStamped()
64 t.header.stamp = stamp
65 t.header.frame_id = parent
66 t.child_frame_id = child
67 t.transform.translation =
ToVector3(translation)
def NewQuaternion(x, y, z, w)
Orientation ##.
def NewPoint(x, y, z)
Point ##.
def NewVector3(x, y, z)
Vector3 ##.
def ToTransformStamped(translation, rotation, stamp, child, parent)
def FromTransformStamped(msg)
TransformStamped ##.