#include <boost/tuple/tuple.hpp>
#include "robot_model_services/robot_model/impl/MILDRobotModel.hpp"
#include "robot_model_services/typedef.hpp"
#include "geometry_msgs/Pose.h"
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include "robot_model_services/helper/DebugHelper.hpp"
Go to the source code of this file.
Classes | |
class | robot_model_services::MILDRobotModelWithApproximatedIK |
MILDRobotModelWithApproximatedIK implements a model of pan tilt unit robot where the inverse kinematic is defined by an approximation function. More... | |
Namespaces | |
robot_model_services | |
this namespace contains all generally usable classes. | |
Typedefs | |
typedef boost::shared_ptr< MILDRobotModelWithApproximatedIK > | robot_model_services::MILDRobotModelWithApproximatedIKPtr |