Go to the documentation of this file.
19 #ifndef DYNAMIXEL_WORKBENCH_CONTROLLERS_H
20 #define DYNAMIXEL_WORKBENCH_CONTROLLERS_H
24 #include <yaml-cpp/yaml.h>
26 #include <sensor_msgs/JointState.h>
27 #include <geometry_msgs/Twist.h>
28 #include <trajectory_msgs/JointTrajectory.h>
29 #include <trajectory_msgs/JointTrajectoryPoint.h>
32 #include <dynamixel_workbench_msgs/DynamixelStateList.h>
33 #include <dynamixel_workbench_msgs/DynamixelCommand.h>
38 #define SYNC_WRITE_HANDLER_FOR_GOAL_POSITION 0
39 #define SYNC_WRITE_HANDLER_FOR_GOAL_VELOCITY 1
42 #define SYNC_READ_HANDLER_FOR_PRESENT_POSITION_VELOCITY_CURRENT 0
104 bool initWorkbench(
const std::string port_name,
const uint32_t baud_rate);
128 dynamixel_workbench_msgs::DynamixelCommand::Response &res);
131 #endif //DYNAMIXEL_WORKBENCH_CONTROLLERS_H
std::map< std::string, uint32_t > dynamixel_
ros::Publisher joint_states_pub_
void trajectoryMsgCallback(const trajectory_msgs::JointTrajectory::ConstPtr &msg)
ros::Subscriber trajectory_sub_
ros::Subscriber cmd_vel_sub_
ros::Publisher dynamixel_state_list_pub_
void readCallback(const ros::TimerEvent &)
JointTrajectory * jnt_tra_
std::vector< WayPoint > pre_goal_
void commandVelocityCallback(const geometry_msgs::Twist::ConstPtr &msg)
double getPublishPeriod()
std::vector< std::pair< std::string, ItemValue > > dynamixel_info_
bool initDynamixels(void)
bool dynamixelCommandMsgCallback(dynamixel_workbench_msgs::DynamixelCommand::Request &req, dynamixel_workbench_msgs::DynamixelCommand::Response &res)
dynamixel_workbench_msgs::DynamixelStateList dynamixel_state_list_
ros::NodeHandle priv_node_handle_
bool is_joint_state_topic_
bool loadDynamixels(void)
ros::NodeHandle node_handle_
bool initWorkbench(const std::string port_name, const uint32_t baud_rate)
bool getDynamixelsInfo(const std::string yaml_file)
void writeCallback(const ros::TimerEvent &)
bool getPresentPosition(std::vector< std::string > dxl_name)
bool initControlItems(void)
void publishCallback(const ros::TimerEvent &)
trajectory_msgs::JointTrajectory * jnt_tra_msg_
void initSubscriber(void)
sensor_msgs::JointState joint_state_msg_
bool initSDKHandlers(void)
ros::ServiceServer dynamixel_command_server_
std::map< std::string, const ControlItem * > control_items_
DynamixelWorkbench * dxl_wb_