moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <math.h>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <moveit/robot_state/conversions.h>
#include <rclcpp/duration.hpp>
#include <rclcpp/logger.hpp>
#include <rclcpp/logging.hpp>
#include <rclcpp/time.hpp>
#include <tf2_eigen/tf2_eigen.hpp>
#include <numeric>
#include <optional>
Go to the source code of this file.
Namespaces | |
robot_trajectory | |
Functions | |
std::ostream & | robot_trajectory::operator<< (std::ostream &out, const RobotTrajectory &trajectory) |
Operator overload for printing trajectory to a stream. More... | |
double | robot_trajectory::path_length (RobotTrajectory const &trajectory) |
Calculate the path length of a given trajectory based on the accumulated robot state distances. The distance between two robot states is calculated based on the sum of active joint distances between the two states (L1 norm). More... | |
std::optional< double > | robot_trajectory::smoothness (RobotTrajectory const &trajectory) |
Calculate the smoothness of a given trajectory. More... | |
std::optional< double > | robot_trajectory::waypoint_density (RobotTrajectory const &trajectory) |
Calculate the waypoint density of a trajectory. More... | |