#include "ros/ros.h"#include <stdio.h>#include "std_msgs/Float64.h"#include "std_msgs/Float32.h"#include "corobot_msgs/MotorCommand.h"#include "corobot_gazebo/ModelStates.h"#include "nav_msgs/Odometry.h"#include <tf/transform_broadcaster.h>#include "math.h"
Go to the source code of this file.
Functions | |
| void | getModelState (const corobot_gazebo::ModelStates &msg) |
| int | main (int argc, char **argv) |
| void | setLeftWheelVelocity (const std_msgs::Float32 &msg) |
| void | setRightWheelVelocity (const std_msgs::Float32 &msg) |
| void | setVelocity (const corobot_msgs::MotorCommand &msg) |
Variables | |
| ros::Publisher | left_front_wheel_pub |
| ros::Publisher | left_rear_wheel_pub |
| ros::Publisher | odom_pub |
| ros::Publisher | right_front_wheel_pub |
| ros::Publisher | right_rear_wheel_pub |
| void getModelState | ( | const corobot_gazebo::ModelStates & | msg | ) |
Definition at line 52 of file gazebo_control.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 111 of file gazebo_control.cpp.
| void setLeftWheelVelocity | ( | const std_msgs::Float32 & | msg | ) |
Definition at line 30 of file gazebo_control.cpp.
| void setRightWheelVelocity | ( | const std_msgs::Float32 & | msg | ) |
Definition at line 41 of file gazebo_control.cpp.
| void setVelocity | ( | const corobot_msgs::MotorCommand & | msg | ) |
Definition at line 14 of file gazebo_control.cpp.
Definition at line 12 of file gazebo_control.cpp.
Definition at line 12 of file gazebo_control.cpp.
Definition at line 12 of file gazebo_control.cpp.
Definition at line 12 of file gazebo_control.cpp.
Definition at line 12 of file gazebo_control.cpp.