File geometry.hpp
↰ Parent directory (include/autoware_utils/geometry)
Definition (include/autoware_utils/geometry/geometry.hpp)
Includes
Eigen/Coreautoware_internal_planning_msgs/msg/path_with_lane_id.hppautoware_planning_msgs/msg/path.hppautoware_planning_msgs/msg/trajectory.hppautoware_utils/geometry/boost_geometry.hpp(File boost_geometry.hpp)autoware_utils/math/constants.hpp(File constants.hpp)autoware_utils/math/normalization.hpp(File normalization.hpp)autoware_utils/ros/msg_covariance.hpp(File msg_covariance.hpp)exceptiongeometry_msgs/msg/point32.hppgeometry_msgs/msg/pose_stamped.hppgeometry_msgs/msg/pose_with_covariance_stamped.hppgeometry_msgs/msg/quaternion.hppgeometry_msgs/msg/transform_stamped.hppgeometry_msgs/msg/twist.hppgeometry_msgs/msg/twist_with_covariance.hppgeometry_msgs/msg/vector3.hppstringtf2/utils.htf2_geometry_msgs/tf2_geometry_msgs.hppvector
Included By
Namespaces
Functions
Function autoware_utils::distance(const alt::Point2d&, const alt::Point2d&, const alt::Point2d&)
Function autoware_utils::distance(const alt::Point2d&, const alt::ConvexPolygon2d&)
Template Function autoware_utils::get_longitudinal_velocity(] const T&)
Specialized Template Function autoware_utils::get_point(const geometry_msgs::msg::Point&)
Specialized Template Function autoware_utils::get_point(const geometry_msgs::msg::Pose&)
Specialized Template Function autoware_utils::get_point(const geometry_msgs::msg::PoseStamped&)
Specialized Template Function autoware_utils::get_pose(const geometry_msgs::msg::Pose&)
Specialized Template Function autoware_utils::get_pose(const geometry_msgs::msg::PoseStamped&)
Function autoware_utils::get_rpy(const geometry_msgs::msg::Quaternion&)
Function autoware_utils::get_rpy(const geometry_msgs::msg::Pose&)
Function autoware_utils::get_rpy(const geometry_msgs::msg::PoseStamped&)
Function autoware_utils::get_rpy(const geometry_msgs::msg::PoseWithCovarianceStamped&)
Function autoware_utils::intersects(const alt::ConvexPolygon2d&, const alt::ConvexPolygon2d&)
Function autoware_utils::pose2transform(const geometry_msgs::msg::Pose&)
Function autoware_utils::pose2transform(const geometry_msgs::msg::PoseStamped&, const std::string&)
Template Function autoware_utils::set_longitudinal_velocity(] const float, ] T&)
Template Function autoware_utils::set_pose(] const geometry_msgs::msg::Pose&, ] T&)
Function autoware_utils::transform2pose(const geometry_msgs::msg::Transform&)
Function autoware_utils::transform2pose(const geometry_msgs::msg::TransformStamped&)
Function autoware_utils::transform_point(const Point3d&, const geometry_msgs::msg::Transform&)
Function autoware_utils::transform_point(const Point2d&, const geometry_msgs::msg::Transform&)
Function autoware_utils::transform_point(const Eigen::Vector3d&, const geometry_msgs::msg::Pose&)
Function tf2::fromMsg(const geometry_msgs::msg::PoseStamped&, tf2::Stamped<tf2::Transform>&)