3 #ifndef MOVER_CONTROLLER_H_ 4 #define MOVER_CONTROLLER_H_ 9 #include <geometry_msgs/PoseStamped.h> 10 #include <geometry_msgs/Twist.h> 11 #include <nav_msgs/Odometry.h> 13 #include <geometry_msgs/PoseWithCovarianceStamped.h> 17 #include <move_base_msgs/MoveBaseAction.h> 22 #include "seed_r7_ros_controller/LedControl.h" 23 #include "seed_r7_ros_controller/SetInitialPose.h" 47 void cmdVelCallback(
const geometry_msgs::TwistConstPtr& _cmd_vel);
50 void velocityToWheel(
double _linear_x,
double _linear_y,
double _angular_z, std::vector<int16_t>& _wheel_vel);
51 bool setInitialPoseCallback(seed_r7_ros_controller::SetInitialPose::Request& _req, seed_r7_ros_controller::SetInitialPose::Response& _res);
52 bool ledControlCallback(seed_r7_ros_controller::LedControl::Request& _req, seed_r7_ros_controller::LedControl::Response& _res);
53 void moveBaseStatusCallBack(
const actionlib_msgs::GoalStatusArray::ConstPtr &status);
71 double vx_, vy_, vth_, x_,
y_, th_;
std::vector< std::string > wheel_names_
tf::TransformBroadcaster odom_broadcaster_
ros::Subscriber cmd_vel_sub_
std::vector< int > aero_index_
actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction > * move_base_action_
robot_hardware::RobotHW * hw_
ros::ServiceServer set_initialpose_server_
ros::ServiceServer led_control_server_