19 #ifndef FETCH_AUTO_DOCK_CONTROLLER_H 20 #define FETCH_AUTO_DOCK_CONTROLLER_H 24 #include <geometry_msgs/Twist.h> 25 #include <nav_msgs/Path.h> 38 bool approach(
const geometry_msgs::PoseStamped& target);
47 bool backup(
double distance,
double rotate_distance);
84 #endif // FETCH_AUTO_DOCK_CONTROLLER_H bool approach(const geometry_msgs::PoseStamped &target)
Implements something loosely based on "A Smooth Control Law for Graceful Motion of Differential Wheel...
void stop()
send stop command to robot base
bool backup(double distance, double rotate_distance)
Back off dock, then rotate. Robot is first reversed by the prescribed distance, and then rotates with...
ros::Publisher cmd_vel_pub_
double max_angular_velocity_
bool getCommand(geometry_msgs::Twist &command)
Get the last command sent.
tf::TransformListener listener_
ROSLIB_DECL std::string command(const std::string &cmd)
geometry_msgs::PoseStamped start_
BaseController(ros::NodeHandle &nh)
geometry_msgs::Twist command_