Classes | Namespaces | Macros
EEHal.h File Reference
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <string>
#include <vector>
#include <memory>
#include <unordered_map>
#include <fstream>
#include <Eigen/Dense>
#include <yaml-cpp/yaml.h>
#include <end_effector/Utils.h>
#include <end_effector/UtilsEigen.h>
#include <end_effector/UtilsYAML.h>
#include <rosee_msg/HandInfo.h>
#include <rosee_msg/MotorPhalangePressure.h>
Include dependency graph for EEHal.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  ROSEE::EEHal
 Class representing an end-effector. More...
 

Namespaces

 ROSEE
 

Macros

#define HAL_CREATE_OBJECT(className)
 

Macro Definition Documentation

◆ HAL_CREATE_OBJECT

#define HAL_CREATE_OBJECT (   className)
Value:
extern "C" ::ROSEE::EEHal* create_object_##className ( ros::NodeHandle* nh) { \
return new className(nh); \
} \

Definition at line 42 of file EEHal.h.

ROSEE::EEHal
Class representing an end-effector.
Definition: EEHal.h:54
ros::NodeHandle


end-effector
Author(s): Luca Muratore , Davide Torielli , Liana Bertoni
autogenerated on Sat Dec 14 2024 03:49:27