Classes | Functions
joint_trajectory_controller::internal Namespace Reference

Classes

class  IsBeforePoint
 

Functions

std::string getLeafNamespace (const ros::NodeHandle &nh)
 
std::vector< std::string > getStrings (const ros::NodeHandle &nh, const std::string &param_name)
 
urdf::ModelSharedPtr getUrdf (const ros::NodeHandle &nh, const std::string &param_name)
 
std::vector< urdf::JointConstSharedPtr > getUrdfJoints (const urdf::Model &urdf, const std::vector< std::string > &joint_names)
 
template<class T >
std::vector< unsigned int > mapping (const T &t1, const T &t2)
 
template<class Enclosure , class Member >
boost::shared_ptr< Member > share_member (boost::shared_ptr< Enclosure > enclosure, Member &member)
 
ros::Time startTime (const trajectory_msgs::JointTrajectory &msg, const ros::Time &time)
 

Function Documentation

◆ getLeafNamespace()

std::string joint_trajectory_controller::internal::getLeafNamespace ( const ros::NodeHandle nh)

Definition at line 122 of file joint_trajectory_controller_impl.h.

◆ getStrings()

std::vector<std::string> joint_trajectory_controller::internal::getStrings ( const ros::NodeHandle nh,
const std::string &  param_name 
)

Definition at line 48 of file joint_trajectory_controller_impl.h.

◆ getUrdf()

urdf::ModelSharedPtr joint_trajectory_controller::internal::getUrdf ( const ros::NodeHandle nh,
const std::string &  param_name 
)

Definition at line 79 of file joint_trajectory_controller_impl.h.

◆ getUrdfJoints()

std::vector<urdf::JointConstSharedPtr> joint_trajectory_controller::internal::getUrdfJoints ( const urdf::Model urdf,
const std::vector< std::string > &  joint_names 
)

Definition at line 103 of file joint_trajectory_controller_impl.h.

◆ mapping()

template<class T >
std::vector<unsigned int> joint_trajectory_controller::internal::mapping ( const T &  t1,
const T &  t2 
)
inline
Returns
The map between t1 indices (implicitly encoded in return vector indices) to indices. If t1 is "{C, B}" and t2 is "{A, B, C, D}", the associated mapping vector is "{2, 1}".

Definition at line 65 of file init_joint_trajectory.h.

◆ share_member()

template<class Enclosure , class Member >
boost::shared_ptr<Member> joint_trajectory_controller::internal::share_member ( boost::shared_ptr< Enclosure >  enclosure,
Member &  member 
)
inline

Definition at line 41 of file joint_trajectory_controller_impl.h.

◆ startTime()

ros::Time joint_trajectory_controller::internal::startTime ( const trajectory_msgs::JointTrajectory &  msg,
const ros::Time time 
)
inline
Parameters
msgTrajectory message.
timeTrajectory start time, if unspecified in message.
Returns
Start time specified in message. If unspecified (set to zero) return time.

Definition at line 69 of file joint_trajectory_msg_utils.h.



joint_trajectory_controller
Author(s): Adolfo Rodriguez Tsouroukdissian
autogenerated on Fri Feb 3 2023 03:19:15