Function mppi::utils::posePointAngle(const geometry_msgs::msg::Pose&, double, double, double)

Function Documentation

inline float mppi::utils::posePointAngle(const geometry_msgs::msg::Pose &pose, double point_x, double point_y, double point_yaw)

evaluate angle from pose (have angle) to point (no angle)

Parameters:
  • pose – pose

  • point_x – Point to find angle relative to X axis

  • point_y – Point to find angle relative to Y axis

  • point_yaw – Yaw of the point to consider along Z axis

Returns:

Angle between two points