#include <controller_interface/multi_interface_controller.h>
#include <hardware_interface/joint_command_interface.h>
#include <pluginlib/class_list_macros.hpp>
#include <nav_msgs/Odometry.h>
#include <four_wheel_steering_msgs/FourWheelSteeringStamped.h>
#include <tf/tfMessage.h>
#include <realtime_tools/realtime_buffer.h>
#include <realtime_tools/realtime_publisher.h>
#include <four_wheel_steering_controller/odometry.h>
#include <four_wheel_steering_controller/speed_limiter.h>
Go to the source code of this file.
Namespaces | |
four_wheel_steering_controller | |
Functions | |
four_wheel_steering_controller::PLUGINLIB_EXPORT_CLASS (four_wheel_steering_controller::FourWheelSteeringController, controller_interface::ControllerBase) | |