| addPrefixWayPoint(const moveit::core::RobotState &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| addPrefixWayPoint(const moveit::core::RobotStatePtr &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| addSuffixWayPoint(const moveit::core::RobotState &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| addSuffixWayPoint(const moveit::core::RobotStatePtr &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| append(const RobotTrajectory &source, double dt, size_t start_index=0, size_t end_index=std::numeric_limits< std::size_t >::max()) | robot_trajectory::RobotTrajectory | |
| clear() | robot_trajectory::RobotTrajectory | inline |
| duration_from_previous_ | robot_trajectory::RobotTrajectory | private |
| empty() const | robot_trajectory::RobotTrajectory | inline |
| findWayPointIndicesForDurationAfterStart(const double duration, int &before, int &after, double &blend) const | robot_trajectory::RobotTrajectory | |
| getAverageSegmentDuration() const | robot_trajectory::RobotTrajectory | |
| getDuration() const | robot_trajectory::RobotTrajectory | |
| getFirstWayPoint() const | robot_trajectory::RobotTrajectory | inline |
| getFirstWayPointPtr() | robot_trajectory::RobotTrajectory | inline |
| getGroup() const | robot_trajectory::RobotTrajectory | inline |
| getGroupName() const | robot_trajectory::RobotTrajectory | |
| getLastWayPoint() const | robot_trajectory::RobotTrajectory | inline |
| getLastWayPointPtr() | robot_trajectory::RobotTrajectory | inline |
| getRobotModel() const | robot_trajectory::RobotTrajectory | inline |
| getRobotTrajectoryMsg(moveit_msgs::RobotTrajectory &trajectory, const std::vector< std::string > &joint_filter=std::vector< std::string >()) const | robot_trajectory::RobotTrajectory | |
| getStateAtDurationFromStart(const double request_duration, moveit::core::RobotStatePtr &output_state) const | robot_trajectory::RobotTrajectory | |
| getWayPoint(std::size_t index) const | robot_trajectory::RobotTrajectory | inline |
| getWayPointCount() const | robot_trajectory::RobotTrajectory | inline |
| getWayPointDurationFromPrevious(std::size_t index) const | robot_trajectory::RobotTrajectory | inline |
| getWayPointDurationFromStart(std::size_t index) const | robot_trajectory::RobotTrajectory | |
| getWaypointDurationFromStart(std::size_t index) const | robot_trajectory::RobotTrajectory | |
| getWayPointDurations() const | robot_trajectory::RobotTrajectory | inline |
| getWayPointPtr(std::size_t index) | robot_trajectory::RobotTrajectory | inline |
| group_ | robot_trajectory::RobotTrajectory | private |
| insertWayPoint(std::size_t index, const moveit::core::RobotState &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| insertWayPoint(std::size_t index, const moveit::core::RobotStatePtr &state, double dt) | robot_trajectory::RobotTrajectory | inline |
| operator=(const RobotTrajectory &)=default | robot_trajectory::RobotTrajectory | |
| reverse() | robot_trajectory::RobotTrajectory | |
| robot_model_ | robot_trajectory::RobotTrajectory | private |
| RobotTrajectory(const moveit::core::RobotModelConstPtr &robot_model) | robot_trajectory::RobotTrajectory | explicit |
| RobotTrajectory(const moveit::core::RobotModelConstPtr &robot_model, const std::string &group) | robot_trajectory::RobotTrajectory | |
| RobotTrajectory(const moveit::core::RobotModelConstPtr &robot_model, const moveit::core::JointModelGroup *group) | robot_trajectory::RobotTrajectory | |
| RobotTrajectory(const RobotTrajectory &other, bool deepcopy=false) | robot_trajectory::RobotTrajectory | |
| setGroupName(const std::string &group_name) | robot_trajectory::RobotTrajectory | inline |
| setRobotTrajectoryMsg(const moveit::core::RobotState &reference_state, const trajectory_msgs::JointTrajectory &trajectory) | robot_trajectory::RobotTrajectory | |
| setRobotTrajectoryMsg(const moveit::core::RobotState &reference_state, const moveit_msgs::RobotTrajectory &trajectory) | robot_trajectory::RobotTrajectory | |
| setRobotTrajectoryMsg(const moveit::core::RobotState &reference_state, const moveit_msgs::RobotState &state, const moveit_msgs::RobotTrajectory &trajectory) | robot_trajectory::RobotTrajectory | |
| setWayPointDurationFromPrevious(std::size_t index, double value) | robot_trajectory::RobotTrajectory | inline |
| swap(robot_trajectory::RobotTrajectory &other) | robot_trajectory::RobotTrajectory | |
| unwind() | robot_trajectory::RobotTrajectory | |
| unwind(const moveit::core::RobotState &state) | robot_trajectory::RobotTrajectory | |
| waypoints_ | robot_trajectory::RobotTrajectory | private |