1 #ifndef CONTROLLER_NODE_H 2 #define CONTROLLER_NODE_H 5 #include <geometry_msgs/Twist.h> 6 #include <geometry_msgs/PoseWithCovarianceStamped.h> 7 #include <tuw_nav_msgs/ControllerState.h> 8 #include <nav_msgs/Path.h> 9 #include <std_msgs/String.h> 29 std::unique_ptr<ros::Rate>
rate_;
44 void subPoseCb(
const geometry_msgs::PoseWithCovarianceStampedConstPtr &_pose);
45 void subPathCb(
const nav_msgs::Path::ConstPtr &_path);
46 void subCtrlCb(
const std_msgs::String _cmd);
55 #endif // CONTROLLER_NODE_H
tuw_nav_msgs::ControllerState ctrl_state_
ros::NodeHandle n_param_
Node handler to the current node.
ros::Publisher pubCmdVel_
void subPoseCb(const geometry_msgs::PoseWithCovarianceStampedConstPtr &_pose)
void subPathCb(const nav_msgs::Path::ConstPtr &_path)
std::unique_ptr< ros::Rate > rate_
geometry_msgs::Twist cmd_
void subCtrlCb(const std_msgs::String _cmd)
ControllerNode(ros::NodeHandle &n)
Construct a new Controller Node object.
ros::NodeHandle n_
Node handler to the root node.