Classes | |
class | IsBeforePoint |
Typedefs | |
typedef boost::shared_ptr < const urdf::Joint > | UrdfJointConstPtr |
Functions | |
std::string | getLeafNamespace (const ros::NodeHandle &nh) |
std::vector< std::string > | getStrings (const ros::NodeHandle &nh, const std::string ¶m_name) |
boost::shared_ptr< urdf::Model > | getUrdf (const ros::NodeHandle &nh, const std::string ¶m_name) |
std::vector< UrdfJointConstPtr > | getUrdfJoints (const urdf::Model &urdf, const std::vector< std::string > &joint_names) |
template<class T > | |
std::vector< unsigned int > | permutation (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) |
typedef boost::shared_ptr<const urdf::Joint> joint_trajectory_controller::internal::UrdfJointConstPtr |
Definition at line 103 of file joint_trajectory_controller_impl.h.
std::string joint_trajectory_controller::internal::getLeafNamespace | ( | const ros::NodeHandle & | nh | ) |
Definition at line 123 of file joint_trajectory_controller_impl.h.
std::vector<std::string> joint_trajectory_controller::internal::getStrings | ( | const ros::NodeHandle & | nh, |
const std::string & | param_name | ||
) |
Definition at line 49 of file joint_trajectory_controller_impl.h.
boost::shared_ptr<urdf::Model> 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.
std::vector<UrdfJointConstPtr> joint_trajectory_controller::internal::getUrdfJoints | ( | const urdf::Model & | urdf, |
const std::vector< std::string > & | joint_names | ||
) |
Definition at line 104 of file joint_trajectory_controller_impl.h.
std::vector<unsigned int> joint_trajectory_controller::internal::permutation | ( | const T & | t1, |
const T & | t2 | ||
) | [inline] |
t1
is "{A, B, C, D}"
and t2
is "{B, D, A, C}"
, the associated permutation vector is "{2, 0, 3, 1}"
. Definition at line 65 of file init_joint_trajectory.h.
boost::shared_ptr<Member> joint_trajectory_controller::internal::share_member | ( | boost::shared_ptr< Enclosure > | enclosure, |
Member & | member | ||
) | [inline] |
Definition at line 42 of file joint_trajectory_controller_impl.h.
ros::Time joint_trajectory_controller::internal::startTime | ( | const trajectory_msgs::JointTrajectory & | msg, |
const ros::Time & | time | ||
) | [inline] |
msg | Trajectory message. |
time | Trajectory start time, if unspecified in message. |
time
. Definition at line 69 of file joint_trajectory_msg_utils.h.