controller_node.h
Go to the documentation of this file.
1 #ifndef CONTROLLER_NODE_H
2 #define CONTROLLER_NODE_H
3 
4 #include <ros/ros.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>
10 
12 #include <memory>
13 
14 namespace velocity_controller
15 {
17 {
18  //special class-member functions.
19 public:
26 
29  std::unique_ptr<ros::Rate> rate_;
30 
31 private:
37  float max_vel_v_;
38  float max_vel_w_;
39  float goal_r_;
40  float Kp_val_;
41  float Ki_val_;
42  float Kd_val_;
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);
47  void publishState();
48 
49  geometry_msgs::Twist cmd_;
50  tuw_nav_msgs::ControllerState ctrl_state_;
51 };
52 
53 } // namespace velocity_controller
54 
55 #endif // CONTROLLER_NODE_H
tuw_nav_msgs::ControllerState ctrl_state_
ros::NodeHandle n_param_
Node handler to the current node.
void subPoseCb(const geometry_msgs::PoseWithCovarianceStampedConstPtr &_pose)
void subPathCb(const nav_msgs::Path::ConstPtr &_path)
std::unique_ptr< ros::Rate > rate_
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.


tuw_multi_robot_ctrl
Author(s): Benjamin Binder
autogenerated on Mon Feb 28 2022 23:57:38