Function nav2_util::geometry_utils::euclidean_distance(const geometry_msgs::msg::PoseStamped&, const geometry_msgs::msg::PoseStamped&, const bool)

Function Documentation

inline double nav2_util::geometry_utils::euclidean_distance(const geometry_msgs::msg::PoseStamped &pos1, const geometry_msgs::msg::PoseStamped &pos2, const bool is_3d = false)

Get the L2 distance between 2 geometry_msgs::PoseStamped.

Parameters:
  • pos1 – First pose

  • pos1 – Second pose

  • is_3d – True if a true L2 distance is desired (default false)

Returns:

double L2 distance