39 geometry_msgs::Pose2D
getForwardPose(
const geometry_msgs::Pose2D& pose,
double distance)
41 geometry_msgs::Pose2D forward_pose;
42 forward_pose.x = pose.x + distance * cos(pose.theta);
43 forward_pose.y = pose.y + distance * sin(pose.theta);
44 forward_pose.theta = pose.theta;
geometry_msgs::Pose2D getForwardPose(const geometry_msgs::Pose2D &pose, double distance)
Projects the given pose forward the specified distance in the x direction.