#include <move_omni_base.h>
Public Member Functions | |
| void | BaseLaserCB (const sensor_msgs::LaserScan::ConstPtr &scan) | 
| double | distance (const geometry_msgs::PoseStamped &p1, const geometry_msgs::PoseStamped &p2) | 
| void | executeCb (const move_base_msgs::MoveBaseGoalConstPtr &move_base_goal) | 
| void | goalCB (const geometry_msgs::PoseStamped::ConstPtr &goal) | 
| geometry_msgs::PoseStamped | goalToLocalFrame (const geometry_msgs::PoseStamped &goal_pose_msg) | 
| MoveOmniBase (std::string name, tf::TransformListener &tf) | |
Public Attributes | |
| ros::Publisher | action_goal_pub_ | 
| MoveBaseActionServer * | as_ | 
| ros::Subscriber | base_scan_sub_ | 
| bool | enableLaser | 
| bool | front_collision | 
| ros::Subscriber | goal_sub_ | 
| bool | left_collision | 
| ros::NodeHandle | nh | 
| bool | right_collision | 
| tf::TransformListener & | tf_ | 
| ros::Publisher | vel_pub_ | 
Definition at line 17 of file move_omni_base.h.
| MoveOmniBase::MoveOmniBase | ( | std::string | name, | 
| tf::TransformListener & | tf | ||
| ) | 
Definition at line 5 of file move_omni_base.cpp.
| void MoveOmniBase::BaseLaserCB | ( | const sensor_msgs::LaserScan::ConstPtr & | scan | ) | 
Definition at line 29 of file move_omni_base.cpp.
| double MoveOmniBase::distance | ( | const geometry_msgs::PoseStamped & | p1, | 
| const geometry_msgs::PoseStamped & | p2 | ||
| ) | 
Definition at line 89 of file move_omni_base.cpp.
| void MoveOmniBase::executeCb | ( | const move_base_msgs::MoveBaseGoalConstPtr & | move_base_goal | ) | 
Definition at line 95 of file move_omni_base.cpp.
| void MoveOmniBase::goalCB | ( | const geometry_msgs::PoseStamped::ConstPtr & | goal | ) | 
Definition at line 61 of file move_omni_base.cpp.
| geometry_msgs::PoseStamped MoveOmniBase::goalToLocalFrame | ( | const geometry_msgs::PoseStamped & | goal_pose_msg | ) | 
Definition at line 70 of file move_omni_base.cpp.
Definition at line 39 of file move_omni_base.h.
Definition at line 30 of file move_omni_base.h.
Definition at line 42 of file move_omni_base.h.
Definition at line 43 of file move_omni_base.h.
Definition at line 44 of file move_omni_base.h.
Definition at line 41 of file move_omni_base.h.
Definition at line 45 of file move_omni_base.h.
Definition at line 19 of file move_omni_base.h.
Definition at line 46 of file move_omni_base.h.
Definition at line 29 of file move_omni_base.h.
Definition at line 38 of file move_omni_base.h.