|
ROS-UVS
1.0.0
A Minimalistic ROS Library for Visual Constraint Minimization through Uncalibrated Visual Servoing
|
#include <ros/ros.h>#include <Eigen/Core>#include "sensor_msgs/JointState.h"#include "geometry_msgs/PoseStamped.h"#include "visual_servoing/robot_controller.h"#include <std_srvs/Empty.h>#include "wam_srvs/BHandSpreadPos.h"#include "wam_srvs/BHandGraspPos.h"#include "wam_srvs/BHandPinchPos.h"#include "wam_srvs/BHandFingerPos.h"#include "wam_srvs/Play.h"#include "wam_srvs/Hold.h"#include "wam_srvs/JointMove.h"#include "wam_msgs/RTJointPos.h"

Go to the source code of this file.
Classes | |
| class | WamController |