Class KeyFrame

Class Documentation

class KeyFrame

The KeyFrame class represents a specific joint configuration at a given time

Public Functions

KeyFrame(const rclcpp::Logger &logger, float time_increment)
explicit KeyFrame(const KeyFrame &k)
KeyFrame &operator=(const KeyFrame &other) = default
void addPosition(const std::string &name, double position)
double getJointPosition(const std::string &joint) const
void cleanUnused(const std::map<std::string, bool> &used_joints)
Point get_point(double basetime, double downshift, const std::vector<std::string> &names) const
PrintMotion print(const std::vector<std::string> &names) const
inline float getTime() const
inline void setTime(float time_increment)
inline const std::vector<JointPosition> &getJoints() const
inline std::vector<JointPosition> &getJoints()