#include <auto_dock.h>
Public Member Functions | |
AutoDock () | |
void | cal_docker_pose () |
void | go_direct () |
void | go_middlepose () |
void | heading_docker () |
void | init () |
bool | is_vertical () |
void | laser_scanCB (const sensor_msgs::LaserScan) |
void | launch_autodockCB (const std_msgs::Bool) |
void | pub_autodock_state () |
void | search_docker () |
~AutoDock () | |
Private Attributes | |
xbot_navi::AutodockState | autodock_state_msg |
ros::Publisher | autodock_state_pub |
geometry_msgs::Twist | cmd_vel_msg |
float | distance [3] |
bool | found_docker |
bool | get_middlepose |
boost::thread * | heading_docker_thread |
ros::Subscriber | laser_scan_sub |
ros::Subscriber | launch_autodock_sub |
int | p [3] |
bool | reached_docker |
boost::thread * | search_dock_thread |
boost::thread * | state_pub_thread |
float | theta [3] |
float | theta_diff |
float | vertical_theta_thresh |
ros::Publisher | xbot_cmd_vel_pub |
Definition at line 23 of file auto_dock.h.
xbot::AutoDock::AutoDock | ( | ) |
Definition at line 16 of file auto_dock.cpp.
xbot::AutoDock::~AutoDock | ( | ) |
Definition at line 21 of file auto_dock.cpp.
void xbot::AutoDock::cal_docker_pose | ( | ) |
Definition at line 65 of file auto_dock.cpp.
void xbot::AutoDock::go_direct | ( | ) |
Definition at line 122 of file auto_dock.cpp.
void xbot::AutoDock::go_middlepose | ( | ) |
Definition at line 134 of file auto_dock.cpp.
void xbot::AutoDock::heading_docker | ( | ) |
Definition at line 153 of file auto_dock.cpp.
void xbot::AutoDock::init | ( | ) |
Definition at line 32 of file auto_dock.cpp.
bool xbot::AutoDock::is_vertical | ( | ) |
Definition at line 69 of file auto_dock.cpp.
void xbot::AutoDock::laser_scanCB | ( | const sensor_msgs::LaserScan | msg | ) |
Definition at line 190 of file auto_dock.cpp.
void xbot::AutoDock::launch_autodockCB | ( | const std_msgs::Bool | msg | ) |
Definition at line 176 of file auto_dock.cpp.
void xbot::AutoDock::pub_autodock_state | ( | ) |
Definition at line 54 of file auto_dock.cpp.
void xbot::AutoDock::search_docker | ( | ) |
Definition at line 74 of file auto_dock.cpp.
|
private |
Definition at line 55 of file auto_dock.h.
|
private |
Definition at line 54 of file auto_dock.h.
|
private |
Definition at line 56 of file auto_dock.h.
|
private |
Definition at line 44 of file auto_dock.h.
|
private |
Definition at line 48 of file auto_dock.h.
|
private |
Definition at line 49 of file auto_dock.h.
|
private |
Definition at line 61 of file auto_dock.h.
|
private |
Definition at line 51 of file auto_dock.h.
|
private |
Definition at line 52 of file auto_dock.h.
|
private |
Definition at line 45 of file auto_dock.h.
|
private |
Definition at line 50 of file auto_dock.h.
|
private |
Definition at line 60 of file auto_dock.h.
|
private |
Definition at line 59 of file auto_dock.h.
|
private |
Definition at line 43 of file auto_dock.h.
|
private |
Definition at line 46 of file auto_dock.h.
|
private |
Definition at line 47 of file auto_dock.h.
|
private |
Definition at line 53 of file auto_dock.h.