Goal Checker plugin that checks the position difference and velocity.
More...
#include <stopped_goal_checker.h>
Goal Checker plugin that checks the position difference and velocity.
Definition at line 48 of file stopped_goal_checker.h.
◆ StoppedGoalChecker()
dwb_plugins::StoppedGoalChecker::StoppedGoalChecker |
( |
| ) |
|
◆ initialize()
void dwb_plugins::StoppedGoalChecker::initialize |
( |
const ros::NodeHandle & |
nh | ) |
|
|
overridevirtual |
◆ isGoalReached()
bool dwb_plugins::StoppedGoalChecker::isGoalReached |
( |
const geometry_msgs::Pose2D & |
query_pose, |
|
|
const geometry_msgs::Pose2D & |
goal_pose, |
|
|
const nav_2d_msgs::Twist2D & |
velocity |
|
) |
| |
|
overridevirtual |
◆ rot_stopped_velocity_
double dwb_plugins::StoppedGoalChecker::rot_stopped_velocity_ |
|
protected |
◆ trans_stopped_velocity_
double dwb_plugins::StoppedGoalChecker::trans_stopped_velocity_ |
|
protected |
The documentation for this class was generated from the following files: