Go to the documentation of this file.
18 #ifndef __ROSEE_DUMMY_HAL__
19 #define __ROSEE_DUMMY_HAL__
38 typedef std::shared_ptr<DummyHal>
Ptr;
39 typedef std::shared_ptr<const DummyHal>
ConstPtr;
44 virtual bool sense()
override;
45 virtual bool move()
override;
58 void hal_js_clbk(
const sensor_msgs::JointState::ConstPtr& msg);
65 #endif // __ROSEE_DUMMY_HAL__
std::shared_ptr< const DummyHal > ConstPtr
ros::Subscriber _hal_joint_state_sub
this will subscribe to joint_state_publisher
DummyHal(ros::NodeHandle *nh)
std::shared_ptr< DummyHal > Ptr
Class representing an end-effector.
Class representing an end-effector.
virtual bool move() override
virtual bool sense() override
void hal_js_clbk(const sensor_msgs::JointState::ConstPtr &msg)
#define HAL_CREATE_OBJECT(className)
ros::Publisher _hal_joint_state_pub
this will publish to joint_state_publisher
end-effector
Author(s): Luca Muratore
, Davide Torielli , Liana Bertoni
autogenerated on Sat Dec 14 2024 03:49:26