Public Member Functions | Public Attributes | List of all members
trajectory_tracker::Pose2D Class Reference

#include <path2d.h>

Public Member Functions

 Pose2D ()
 
 Pose2D (const Eigen::Vector2d &p, float y, float velocity)
 
 Pose2D (const geometry_msgs::Pose &pose, float velocity)
 
 Pose2D (const geometry_msgs::PoseStamped &pose)
 
 Pose2D (const trajectory_tracker_msgs::PoseStampedWithVelocity &pose)
 
void rotate (const float ang)
 
void toMsg (geometry_msgs::PoseStamped &pose) const
 
void toMsg (trajectory_tracker_msgs::PoseStampedWithVelocity &pose) const
 

Public Attributes

Eigen::Vector2d pos_
 
float velocity_
 
float yaw_
 

Detailed Description

Definition at line 52 of file path2d.h.

Constructor & Destructor Documentation

◆ Pose2D() [1/5]

trajectory_tracker::Pose2D::Pose2D ( )
inline

Definition at line 59 of file path2d.h.

◆ Pose2D() [2/5]

trajectory_tracker::Pose2D::Pose2D ( const Eigen::Vector2d &  p,
float  y,
float  velocity 
)
inline

Definition at line 65 of file path2d.h.

◆ Pose2D() [3/5]

trajectory_tracker::Pose2D::Pose2D ( const geometry_msgs::Pose &  pose,
float  velocity 
)
inline

Definition at line 71 of file path2d.h.

◆ Pose2D() [4/5]

trajectory_tracker::Pose2D::Pose2D ( const geometry_msgs::PoseStamped &  pose)
inlineexplicit

Definition at line 77 of file path2d.h.

◆ Pose2D() [5/5]

trajectory_tracker::Pose2D::Pose2D ( const trajectory_tracker_msgs::PoseStampedWithVelocity &  pose)
inlineexplicit

Definition at line 83 of file path2d.h.

Member Function Documentation

◆ rotate()

void trajectory_tracker::Pose2D::rotate ( const float  ang)
inline

Definition at line 89 of file path2d.h.

◆ toMsg() [1/2]

void trajectory_tracker::Pose2D::toMsg ( geometry_msgs::PoseStamped &  pose) const
inline

Definition at line 104 of file path2d.h.

◆ toMsg() [2/2]

void trajectory_tracker::Pose2D::toMsg ( trajectory_tracker_msgs::PoseStampedWithVelocity &  pose) const
inline

Definition at line 110 of file path2d.h.

Member Data Documentation

◆ pos_

Eigen::Vector2d trajectory_tracker::Pose2D::pos_

Definition at line 55 of file path2d.h.

◆ velocity_

float trajectory_tracker::Pose2D::velocity_

Definition at line 57 of file path2d.h.

◆ yaw_

float trajectory_tracker::Pose2D::yaw_

Definition at line 56 of file path2d.h.


The documentation for this class was generated from the following file:


trajectory_tracker
Author(s): Atsushi Watanabe
autogenerated on Fri May 16 2025 02:15:20