#include <roll_pitch_yawrate_thrust_controller_node.h>
Public Member Functions | |
void | InitializeParams () |
void | Publish () |
RollPitchYawrateThrustControllerNode () | |
~RollPitchYawrateThrustControllerNode () | |
Private Member Functions | |
void | OdometryCallback (const nav_msgs::OdometryConstPtr &odometry_msg) |
void | RollPitchYawrateThrustCallback (const mav_msgs::RollPitchYawrateThrustConstPtr &roll_pitch_yawrate_thrust_reference_msg) |
Private Attributes | |
ros::Subscriber | cmd_roll_pitch_yawrate_thrust_sub_ |
ros::Publisher | motor_velocity_reference_pub_ |
std::string | namespace_ |
ros::Subscriber | odometry_sub_ |
RollPitchYawrateThrustController | roll_pitch_yawrate_thrust_controller_ |
Definition at line 40 of file roll_pitch_yawrate_thrust_controller_node.h.
Definition at line 27 of file roll_pitch_yawrate_thrust_controller_node.cpp.
Definition at line 41 of file roll_pitch_yawrate_thrust_controller_node.cpp.
Definition at line 43 of file roll_pitch_yawrate_thrust_controller_node.cpp.
void rotors_control::RollPitchYawrateThrustControllerNode::OdometryCallback | ( | const nav_msgs::OdometryConstPtr & | odometry_msg | ) | [private] |
Definition at line 79 of file roll_pitch_yawrate_thrust_controller_node.cpp.
Definition at line 68 of file roll_pitch_yawrate_thrust_controller_node.cpp.
void rotors_control::RollPitchYawrateThrustControllerNode::RollPitchYawrateThrustCallback | ( | const mav_msgs::RollPitchYawrateThrustConstPtr & | roll_pitch_yawrate_thrust_reference_msg | ) | [private] |
Definition at line 71 of file roll_pitch_yawrate_thrust_controller_node.cpp.
ros::Subscriber rotors_control::RollPitchYawrateThrustControllerNode::cmd_roll_pitch_yawrate_thrust_sub_ [private] |
Definition at line 55 of file roll_pitch_yawrate_thrust_controller_node.h.
ros::Publisher rotors_control::RollPitchYawrateThrustControllerNode::motor_velocity_reference_pub_ [private] |
Definition at line 58 of file roll_pitch_yawrate_thrust_controller_node.h.
std::string rotors_control::RollPitchYawrateThrustControllerNode::namespace_ [private] |
Definition at line 52 of file roll_pitch_yawrate_thrust_controller_node.h.
Definition at line 56 of file roll_pitch_yawrate_thrust_controller_node.h.
RollPitchYawrateThrustController rotors_control::RollPitchYawrateThrustControllerNode::roll_pitch_yawrate_thrust_controller_ [private] |
Definition at line 50 of file roll_pitch_yawrate_thrust_controller_node.h.