27 #ifndef _MOVEMENT_PUBLISHER_HPP_ 28 #define _MOVEMENT_PUBLISHER_HPP_ 31 #include <boost/thread.hpp> 35 #include <std_msgs/Float64.h> 37 #include <control_msgs/JointControllerState.h> 38 #include <sr_robot_msgs/JointControllerState.h> 40 #include <sr_hand/hand_commander.hpp> 62 HandCommander* hand_commander = NULL);
65 double rate = 100.0,
unsigned int repetition = 1,
93 void execute_step(
int index_mvt_step,
int index_partial_movement);
MovementPublisher(std::string joint_name, double rate=100.0, unsigned int repetition=1, unsigned int nb_mvt_step=1000, std::string controller_type="", bool testing=false, HandCommander *hand_commander=NULL)
void execute_step(int index_mvt_step, int index_partial_movement)
virtual ~MovementPublisher()
void set_subscriber(ros::Subscriber subscriber)
void add_movement(PartialMovement mvt)
boost::shared_ptr< HandCommander > hand_commander_
void subscribe_and_default_pub_(std::string input)
void calculateErrorCallback(const control_msgs::JointControllerState::ConstPtr &msg)
std::string controller_type
std::string get_subscriber_topic()
std::vector< PartialMovement > partial_movements
void set_publisher(ros::Publisher publisher)
This is the main class from which all the different types of movement will inherit.
std::vector< sr_robot_msgs::joint > joint_vector_
void sr_calculateErrorCallback(const sr_robot_msgs::JointControllerState::ConstPtr &msg)
ros::Rate publishing_rate