#include <string>
#include <boost/shared_ptr.hpp>
#include <boost/thread/mutex.hpp>
#include <ros/ros.h>
#include <robot_controllers_interface/controller.h>
#include <robot_controllers_interface/controller_manager.h>
#include <robot_controllers_interface/joint_handle.h>
#include <tf/transform_broadcaster.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/LaserScan.h>
Go to the source code of this file.
Classes | |
class | robot_controllers::DiffDriveBaseController |
ROS-aware controller to manage a differential drive mobile base. This subcribes to cmd_vel topic, publishes odom and tf, and manages the two wheel joints. More... | |
Namespaces | |
namespace | robot_controllers |
Typedefs | |
typedef boost::shared_ptr < DiffDriveBaseController > | robot_controllers::DiffDriveBaseControllerPtr |