Namespaces |
namespace | track_utils |
namespace | transform_datatypes |
Classes |
class | GenericModel |
class | GenericModelFactory |
class | MultiModelFactory |
class | PCAGPModel |
class | PrismaticModel |
class | RigidModel |
class | RotationalModel |
class | SingleModelFactory |
Typedefs |
typedef boost::shared_ptr
< GenericModel const > | GenericModelConstPtr |
typedef boost::shared_ptr
< GenericModel > | GenericModelPtr |
typedef std::vector
< GenericModelPtr > | GenericModelVector |
typedef Eigen::MatrixXd | M_CartesianJacobian |
typedef Eigen::VectorXd | V_Configuration |
Functions |
bool | check_values (const tf::Vector3 &vec) |
bool | check_values (const tf::Quaternion &vec) |
bool | check_values (double v) |
bool | check_values (float v) |
geometry_msgs::Point | eigenToPoint (Eigen::VectorXd v) |
articulation_msgs::TrackMsg | flipTrack (articulation_msgs::TrackMsg input, int corner=0) |
double | getParam (std::vector< articulation_msgs::ParamMsg > &vec, std::string name) |
bool | hasParam (std::vector< articulation_msgs::ParamMsg > &vec, std::string name) |
void | my_df (const gsl_vector *v, void *params, gsl_vector *df) |
double | my_f (const gsl_vector *v, void *params) |
void | my_fdf (const gsl_vector *x, void *params, double *f, gsl_vector *df) |
int | openChannel (articulation_msgs::TrackMsg &track, std::string name, bool autocreate=true) |
tf::Quaternion | orientationToQuaternion (geometry_msgs::Quaternion orientation) |
Eigen::VectorXd | pointToEigen (geometry_msgs::Point p) |
tf::Transform | poseToTransform (geometry_msgs::Pose pose) |
tf::Vector3 | positionToVector (geometry_msgs::Point position) |
geometry_msgs::Quaternion | quaternionToOrientation (tf::Quaternion quat) |
void | readParamsFromModel () |
void | setParam (std::vector< articulation_msgs::ParamMsg > &vec, std::string name, double value, uint8_t type=articulation_msgs::ParamMsg::PRIOR) |
void | setParamIfNotDefined (std::vector< articulation_msgs::ParamMsg > &vec, std::string name, double value, uint8_t type=articulation_msgs::ParamMsg::PRIOR) |
geometry_msgs::Pose | transformToPose (tf::Transform transform) |
geometry_msgs::Point | vectorToPosition (tf::Vector3 point) |
void | writeParamsToModel () |