force_compensator.h
Go to the documentation of this file.
1 
24 #include <ros/ros.h>
25 #include <heron_msgs/Drive.h>
26 #include <geometry_msgs/Wrench.h>
28 
30 {
31  private:
35  public:
38  }
39 
40  double calculate_motor_setting (double thrust);
41  double saturate_thrusters (double thrust);
42  void pub_thrust_cmd (geometry_msgs::Wrench output);
43  void pub_effective_wrench(double left_thrust,double right_thrust);
44 
45 };
void pub_thrust_cmd(geometry_msgs::Wrench output)
ros::NodeHandle node_
double saturate_thrusters(double thrust)
double calculate_motor_setting(double thrust)
ros::Publisher cmd_pub_
void pub_effective_wrench(double left_thrust, double right_thrust)
ForceCompensator(ros::NodeHandle &n)
ros::Publisher eff_pub_


heron_controller
Author(s): Prasenjit Mukherjee
autogenerated on Sun Mar 14 2021 02:31:50