$search
Scales the time intervals stretching them if necessary so that the trajectory conforms to velocity limits. More...
#include <unnormalize_joint_trajectory.h>

Public Member Functions | |
| virtual bool | smooth (const T &trajectory_in, T &trajectory_out) const |
| UnNormalizeJointTrajectory () | |
| virtual | ~UnNormalizeJointTrajectory () |
Private Attributes | |
| ros::NodeHandle | nh_ |
| The node handle. | |
| urdf::Model | robot_model_ |
| A model of the robot to see which joints wrap around. | |
| bool | robot_model_initialized_ |
| Flag that tells us if the robot model was initialized successfully. | |
Scales the time intervals stretching them if necessary so that the trajectory conforms to velocity limits.
Definition at line 53 of file unnormalize_joint_trajectory.h.
| joint_normalization_filters::UnNormalizeJointTrajectory< T >::UnNormalizeJointTrajectory | ( | ) | [inline] |
Definition at line 74 of file unnormalize_joint_trajectory.h.
| joint_normalization_filters::UnNormalizeJointTrajectory< T >::~UnNormalizeJointTrajectory | ( | ) | [inline, virtual] |
Definition at line 91 of file unnormalize_joint_trajectory.h.
| bool joint_normalization_filters::UnNormalizeJointTrajectory< T >::smooth | ( | const T & | trajectory_in, | |
| T & | trajectory_out | |||
| ) | const [inline, virtual] |
Implements spline_smoother::SplineSmoother< T >.
Definition at line 96 of file unnormalize_joint_trajectory.h.
ros::NodeHandle joint_normalization_filters::UnNormalizeJointTrajectory< T >::nh_ [private] |
The node handle.
Definition at line 57 of file unnormalize_joint_trajectory.h.
urdf::Model joint_normalization_filters::UnNormalizeJointTrajectory< T >::robot_model_ [private] |
A model of the robot to see which joints wrap around.
Definition at line 60 of file unnormalize_joint_trajectory.h.
bool joint_normalization_filters::UnNormalizeJointTrajectory< T >::robot_model_initialized_ [private] |
Flag that tells us if the robot model was initialized successfully.
Definition at line 63 of file unnormalize_joint_trajectory.h.