This is the complete list of members for pal::Motion, including all inherited members.
| addGroupToGroup(const std::string &group, const std::string &subgroup) | pal::Motion | |
| addJointModel(const std::string &joint_name, const JointModel &joint_model) | pal::Motion | |
| addJointToGroup(const std::string &group, const std::string &joint) | pal::Motion | |
| addKeyFrame(const sensor_msgs::JointStateConstPtr &msg, float time_increment=DEFAULT_TIME) | pal::Motion | |
| changeJoint(int frame, const std::string &joint_name, double position) | pal::Motion | |
| changeTime(int frame, float time_increment) | pal::Motion | |
| copyFrame(int frame, int new_frame_pos=-1) | pal::Motion | |
| DEFAULT_TIME | pal::Motion | static |
| extendFrames(const sensor_msgs::JointStateConstPtr &msg) | pal::Motion | |
| extra_joints_ | pal::Motion | private |
| getAvailableJoints() | pal::Motion | inline |
| getCurrentGroup() | pal::Motion | inline |
| getExtraJoints() | pal::Motion | inline |
| getJointGroups() | pal::Motion | inline |
| getJoints() const | pal::Motion | inline |
| getKeyFrame(int i) const | pal::Motion | inline |
| getKeyframes() const | pal::Motion | inline |
| getLastKeyFrame() const | pal::Motion | inline |
| getParamName() const | pal::Motion | inline |
| group_used_ | pal::Motion | private |
| isJointUsed(const std::string &joint_name) const | pal::Motion | inline |
| joint_groups_ | pal::Motion | private |
| joint_models_ | pal::Motion | private |
| jointsLoaded() | pal::Motion | inline |
| keyframes_ | pal::Motion | private |
| loadFrame(int frame) const | pal::Motion | |
| loadYAML(double downshift) const | pal::Motion | |
| Motion(const std::string &robot_description, const std::string &robot_description_semantic, const std::vector< std::string > &extra_joints) | pal::Motion | |
| Motion(XmlRpc::XmlRpcValue ¶m, const std::string &robot_description, const std::string &robot_description_semantic, const std::vector< std::string > &extra_joints) | pal::Motion | |
| print(double downshift=1.0) const | pal::Motion | |
| print(const std::string &name, const std::string &usage, const std::string &description, double downshift=1.0) const | pal::Motion | |
| removeAllKeyFrames() | pal::Motion | |
| removeKeyFrame(int frame) | pal::Motion | |
| setCurrentGroup(const std::string &group) | pal::Motion | inline |
| setExtraJointUsedState(const std::string &name, bool used) | pal::Motion | inline |
| setMotionGroups(const std::string &robot_description, const std::string &robot_description_semantic) | pal::Motion | |
| setParamName() | pal::Motion | |
| size() const | pal::Motion | inline |
| tmp_name_ | pal::Motion | private |
| updateKeyFrame(const sensor_msgs::JointStateConstPtr &msg, int frame) | pal::Motion |