Public Member Functions | |
| void | cmdVelCallBack (const geometry_msgs::Twist::ConstPtr &cmd_msg) |
| DiffDrive () | |
| ~DiffDrive () | |
Public Attributes | |
| libgazebo::PositionIface * | posIface |
| ros::Publisher | pub_ |
| ros::NodeHandle * | rnh_ |
| ros::Subscriber | sub_ |
Definition at line 39 of file gazebo_ros_diffdrive.cpp.
| DiffDrive::DiffDrive | ( | ) | [inline] |
Connect to the libgazebo server
Open the Simulation Interface
Open the Position interface
Definition at line 57 of file gazebo_ros_diffdrive.cpp.
| DiffDrive::~DiffDrive | ( | ) | [inline] |
Definition at line 155 of file gazebo_ros_diffdrive.cpp.
| void DiffDrive::cmdVelCallBack | ( | const geometry_msgs::Twist::ConstPtr & | cmd_msg | ) | [inline] |
Definition at line 41 of file gazebo_ros_diffdrive.cpp.
| libgazebo::PositionIface* DiffDrive::posIface |
Definition at line 36 of file gazebo_ros_diffdrive.cpp.
| ros::Publisher DiffDrive::pub_ |
Definition at line 39 of file gazebo_ros_diffdrive.cpp.
| ros::NodeHandle* DiffDrive::rnh_ |
Definition at line 37 of file gazebo_ros_diffdrive.cpp.
| ros::Subscriber DiffDrive::sub_ |
Definition at line 38 of file gazebo_ros_diffdrive.cpp.