Go to the documentation of this file.
7 #include <geometry_msgs/Vector3.h>
8 #include <std_msgs/Float32.h>
16 #include <unordered_map>
19 #include <boost/optional.hpp>
74 boost::optional<geometry_msgs::Vector3::ConstPtr>
base_vel_;
hardware_interface::JointStateInterface state_interface_
std::size_t max_device_joints_
boost::optional< geometry_msgs::Vector3::ConstPtr > base_vel_
virtual void read(const ros::Time &time, const ros::Duration &period)
void on_base_vel_status_(const geometry_msgs::Vector3::ConstPtr &msg)
std::vector< Joint::Ptr > joints_
std::vector< SerialDevice::Ptr > devices_
hardware_interface::PositionJointInterface position_interface_
ros::Publisher base_vel_pub_
std::map< SerialDevice::Ptr, quori::message::States > device_states_
std::unordered_map< std::string, std::size_t > joint_indices_
std::map< SerialDevice::Ptr, std::vector< std::size_t > > device_joints_
void on_base_turret_pos_(const std_msgs::Float32::ConstPtr &msg)
Quori(ros::NodeHandle &nh, const std::vector< SerialDevice::Ptr > &devices)
ros::Publisher base_offset_pub_
std::shared_ptr< Joint > Ptr
double * device_joint_buffer_
ros::Publisher base_holo_vel_pub_
ros::Subscriber base_turret_pos_
ros::Subscriber base_vel_status_
hardware_interface::VelocityJointInterface velocity_interface_