ROS-UVS  1.0.0
A Minimalistic ROS Library for Visual Constraint Minimization through Uncalibrated Visual Servoing
 All Classes Files Functions Variables
MatlabController Class Reference

#include <matlab_controller.h>

Inheritance diagram for MatlabController:
Collaboration diagram for MatlabController:

Public Member Functions

 MatlabController (std::string robot_ns, ros::NodeHandle nh)
 
bool delta_move (const Eigen::VectorXd &delta)
 
bool rt_delta_move (const Eigen::VectorXd &delta)
 
bool joint_move (const Eigen::VectorXd &target_jnt_state)
 
geometry_msgs::PoseStamped get_pose ()
 
Eigen::VectorXd get_jnt_state ()
 
Eigen::VectorXd get_used_jnt_state ()
 
size_t get_dof ()
 
std::vector< int > get_used_joints ()
 
void set_used_joints (std::string)
 
void set_used_joints (std::vector< int > new_joints)
 
void set_target_joint_pose (Eigen::VectorXd target)
 
Eigen::VectorXd map_joints (const Eigen::VectorXd &delta)
 

Public Attributes

double max_rate = 0.01
 

Constructor & Destructor Documentation

MatlabController::MatlabController ( std::string  robot_ns,
ros::NodeHandle  nh 
)

Member Function Documentation

bool MatlabController::delta_move ( const Eigen::VectorXd &  delta)
virtual

Implements RobotController.

Here is the call graph for this function:

Here is the caller graph for this function:

size_t MatlabController::get_dof ( )
inlinevirtual

Reimplemented from RobotController.

Here is the caller graph for this function:

Eigen::VectorXd MatlabController::get_jnt_state ( )
virtual

Implements RobotController.

Here is the caller graph for this function:

geometry_msgs::PoseStamped MatlabController::get_pose ( )
inline
Eigen::VectorXd MatlabController::get_used_jnt_state ( )
virtual

Implements RobotController.

std::vector<int> MatlabController::get_used_joints ( )
inlinevirtual

Implements RobotController.

Here is the caller graph for this function:

bool MatlabController::joint_move ( const Eigen::VectorXd &  target_jnt_state)

Here is the caller graph for this function:

Eigen::VectorXd MatlabController::map_joints ( const Eigen::VectorXd &  delta)
virtual

Implements RobotController.

Here is the call graph for this function:

Here is the caller graph for this function:

bool MatlabController::rt_delta_move ( const Eigen::VectorXd &  delta)
virtual

Implements RobotController.

Here is the call graph for this function:

void MatlabController::set_target_joint_pose ( Eigen::VectorXd  target)
virtual

Implements RobotController.

void MatlabController::set_used_joints ( std::string  new_joints)
virtual

Implements RobotController.

void MatlabController::set_used_joints ( std::vector< int >  new_joints)
virtual

Implements RobotController.

Member Data Documentation

double MatlabController::max_rate = 0.01

The documentation for this class was generated from the following files: