#include "geometry_msgs/Twist.h"#include "ros/ros.h"#include "sensor_msgs/Joy.h"#include "teleop_twist_joy/teleop_twist_joy.h"#include <map>#include <string>
Go to the source code of this file.
Classes | |
| struct | teleop_twist_joy::TeleopTwistJoy::Impl |
Namespaces | |
| teleop_twist_joy | |
Functions | |
| double | teleop_twist_joy::getVal (const sensor_msgs::Joy::ConstPtr &joy_msg, const std::map< std::string, int > &axis_map, const std::map< std::string, double > &scale_map, const std::string &fieldname) |