1 #ifndef CONTROLLER_NODE_H 2 #define CONTROLLER_NODE_H 5 #include <geometry_msgs/Twist.h> 6 #include <geometry_msgs/PoseWithCovarianceStamped.h> 7 #include <nav_msgs/Path.h> 8 #include <std_msgs/String.h> 28 std::unique_ptr<ros::Rate>
rate_;
46 void subPoseCb(
const geometry_msgs::PoseWithCovarianceStampedConstPtr &_pose);
47 void subPathCb(
const nav_msgs::Path::ConstPtr &_path);
48 void subCtrlCb(
const std_msgs::String _cmd);
53 #endif // CONTROLLER_NODE_H
ros::NodeHandle n_param_
Node handler to the current node.
ros::Publisher pubCmdVel_
std::unique_ptr< ros::Rate > rate_
void subPoseCb(const geometry_msgs::PoseWithCovarianceStampedConstPtr &_pose)
std::string topic_cmdVel_
void subPathCb(const nav_msgs::Path::ConstPtr &_path)
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.