29 #include <geometry_msgs/Accel.h> 30 #include <geometry_msgs/Pose.h> 31 #include <geometry_msgs/Twist.h> 52 CartesianStateHandle(
const std::string& ref_frame_id,
const std::string& frame_id,
const geometry_msgs::Pose* pose,
53 const geometry_msgs::Twist* twist,
const geometry_msgs::Accel* accel,
54 const geometry_msgs::Accel* jerk)
60 "'. Pose data pointer is null.");
65 "'. Twist data pointer is null.");
70 "'. Accel data pointer is null.");
75 "'. Jerk data pointer is null.");
std::string ref_frame_id_
geometry_msgs::Accel getAccel() const
std::string getName() const
const geometry_msgs::Accel * accel_
geometry_msgs::Accel getJerk() const
const geometry_msgs::Twist * twist_
A Cartesian state interface for hardware_interface::RobotHW abstractions.
geometry_msgs::Twist getTwist() const
CartesianStateHandle(const std::string &ref_frame_id, const std::string &frame_id, const geometry_msgs::Pose *pose, const geometry_msgs::Twist *twist, const geometry_msgs::Accel *accel, const geometry_msgs::Accel *jerk)
const geometry_msgs::Accel * jerk_
A state handle for Cartesian hardware interfaces.
CartesianStateHandle()=default
geometry_msgs::Pose getPose() const
virtual ~CartesianStateHandle()=default
const geometry_msgs::Pose * pose_