18 #ifndef __ROSEE_UNIVERSAL_ROS_END_EFFECTOR_EXECUTOR_ 19 #define __ROSEE_UNIVERSAL_ROS_END_EFFECTOR_EXECUTOR_ 24 #include <ros/console.h> 25 #include <actionlib/server/simple_action_server.h> 27 #include <sensor_msgs/JointState.h> 39 #include <rosee_msg/HandInfo.h> 53 typedef std::shared_ptr<UniversalRosEndEffectorExecutor>
Ptr;
54 typedef std::shared_ptr<const UniversalRosEndEffectorExecutor>
ConstPtr;
73 bool readOptionalCommands(std::vector<std::string> motors_names, std::vector<double> motors_commands);
131 #endif //__ROSEE_UNIVERSAL_ROS_END_EFFECTOR_EXECUTOR_ std::map< std::set< std::string >, ROSEE::ActionPrimitive::Ptr > _pinchLooseParsedMap
std::shared_ptr< EEInterface > Ptr
ROSEE::EEInterface::Ptr _ee
void timer_callback(const ros::TimerEvent &timer_ev)
std::map< std::set< std::string >, ROSEE::ActionPrimitive::Ptr > _fingFlexParsedMap
std::map< std::set< std::string >, ROSEE::ActionPrimitive::Ptr > _pinchParsedMap
std::map< std::string, std::vector< double > > JointPos
The map to describe the position of all actuated joints.
std::map< std::string, unsigned int > JointsInvolvedCount
The map to describe, how many times a joint is set by the action.
ros::Publisher _motor_reference_pub
std::shared_ptr< RosServiceHandler > _ros_service_handler
std::shared_ptr< RosActionServer > _ros_action_server
std::shared_ptr< ROSEE::ActionGeneric > _graspParsed
bool publish_motor_reference()
ros::Subscriber _joint_state_sub
std::shared_ptr< ActionPrimitive > Ptr
ROSEE::JointPos _motor_position_goal
std::map< std::set< std::string >, ROSEE::ActionPrimitive::Ptr > _tipFlexParsedMap
ROSEE::Utils::SecondOrderFilter< Eigen::VectorXd > _filt_q
sensor_msgs::JointState _mr_msg
MapActionHandler::Ptr mapActionHandlerPtr
Class representing the ROS executor implementing the unviversal ROS EE concept.
double sendFeedbackGoal(std::string currentAction="")
std::shared_ptr< UniversalRosEndEffectorExecutor > Ptr
std::shared_ptr< const UniversalRosEndEffectorExecutor > ConstPtr
void joint_state_clbk(const sensor_msgs::JointStateConstPtr &msg)
std::shared_ptr< MapActionHandler > Ptr
std::vector< std::string > _motors_names
std::shared_ptr< ROSEE::ActionTimed > timedAction
virtual ~UniversalRosEndEffectorExecutor()
void init_joint_state_sub()
ROSEE::JointsInvolvedCount _motor_involved_mask
bool init_motor_reference_pub()
bool updateRefGoal(double percentage=1.0)
Eigen::VectorXd _qref_filtered
bool init_grasping_primitive()
ROSEE::JointPos _joint_actual_pos
bool readOptionalCommands(std::vector< std::string > motors_names, std::vector< double > motors_commands)
UniversalRosEndEffectorExecutor(std::string ns="")
ROSEE::Utils::Timer timer
Eigen::VectorXd _qref_optional
std::map< std::set< std::string >, ROSEE::ActionPrimitive::Ptr > _trigParsedMap
std::string folderForActions
double normGoalFromInitialPos