Function as2::tf::getTransformation

Function Documentation

geometry_msgs::msg::TransformStamped as2::tf::getTransformation(const std::string &_frame_id, const std::string &_child_frame_id, double _translation_x, double _translation_y, double _translation_z, double _roll, double _pitch, double _yaw)

Generate a Transform message from translation and rotation in Euler angles.

Parameters:
  • _frame_id

  • _child_frame_id

  • _translation_x

  • _translation_y

  • _translation_z

  • _roll

  • _pitch

  • _yaw

Returns:

geometry_msgs::msg::TransformStamped