#include <cob_omni_drive_controller/UndercarriageCtrlGeomROS.h>#include <urdf/model.h>#include <angles/angles.h>#include <XmlRpcException.h>#include <tf2/LinearMath/Quaternion.h>#include <tf2/LinearMath/Transform.h>#include <tf2/LinearMath/Vector3.h>
Go to the source code of this file.
| bool make_wheel_struct | ( | XmlRpc::XmlRpcValue & | wheel_list | ) |
Definition at line 259 of file param_parser.cpp.
| bool parseCtrlParams | ( | CtrlParams & | params, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 126 of file param_parser.cpp.
| bool parsePosCtrlParams | ( | PosCtrlParams & | params, |
| XmlRpc::XmlRpcValue & | wheel | ||
| ) |
Definition at line 165 of file param_parser.cpp.
| bool parseWheel | ( | W & | params, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| MergedXmlRpcStruct & | merged, | ||
| urdf::Model * | model | ||
| ) |
| bool parseWheel | ( | UndercarriageGeom::WheelParams & | params, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| MergedXmlRpcStruct & | merged, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 247 of file param_parser.cpp.
| bool parseWheel | ( | UndercarriageDirectCtrl::WheelParams & | params, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| MergedXmlRpcStruct & | merged, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 251 of file param_parser.cpp.
| bool parseWheel | ( | UndercarriageCtrl::WheelParams & | params, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| MergedXmlRpcStruct & | merged, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 255 of file param_parser.cpp.
| bool parseWheelGeom | ( | WheelGeom & | geom, |
| XmlRpc::XmlRpcValue & | wheel, | ||
| MergedXmlRpcStruct & | merged, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 179 of file param_parser.cpp.
| bool parseWheels | ( | std::vector< W > & | wheel_params, |
| const ros::NodeHandle & | nh, | ||
| bool | read_urdf | ||
| ) |
Definition at line 273 of file param_parser.cpp.
| bool parseWheelTransform | ( | const std::string & | joint_name, |
| const std::string & | parent_link_name, | ||
| tf2::Transform & | transform, | ||
| urdf::Model * | model | ||
| ) |
Definition at line 82 of file param_parser.cpp.
| bool read | ( | T & | val, |
| const std::string & | name, | ||
| XmlRpc::XmlRpcValue & | wheel | ||
| ) |
Definition at line 74 of file param_parser.cpp.
| bool read_optional | ( | T & | val, |
| const std::string & | name, | ||
| XmlRpc::XmlRpcValue & | wheel | ||
| ) |
Definition at line 54 of file param_parser.cpp.
| T read_typed | ( | XmlRpc::XmlRpcValue & | val | ) |
Definition at line 46 of file param_parser.cpp.
| double read_typed | ( | XmlRpc::XmlRpcValue & | val | ) |
Definition at line 49 of file param_parser.cpp.
| bool read_with_default | ( | T & | val, |
| const std::string & | name, | ||
| XmlRpc::XmlRpcValue & | wheel, | ||
| const T & | def | ||
| ) |
Definition at line 66 of file param_parser.cpp.