Public Member Functions | Public Attributes
descartes_trajectory_test::CartesianRobot Class Reference

Cartesian Robot used for test purposes. This is a simple robot with simple kinematics. Each joint corresponds to a cartesian direction (i.e. x, y, R, P, Y) (don't ask me how this is built, it just works). More...

#include <cartesian_robot.h>

Inheritance diagram for descartes_trajectory_test::CartesianRobot:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 CartesianRobot ()
 CartesianRobot (double pos_range, double orient_range, int dof=6)
virtual bool getAllIK (const Eigen::Affine3d &pose, std::vector< std::vector< double > > &joint_poses) const
virtual int getDOF () const
virtual bool getFK (const std::vector< double > &joint_pose, Eigen::Affine3d &pose) const
virtual bool getIK (const Eigen::Affine3d &pose, const std::vector< double > &seed_state, std::vector< double > &joint_pose) const
virtual bool initialize (const std::string &robot_description, const std::string &group_name, const std::string &world_frame, const std::string &tcp_frame)
virtual bool isValid (const std::vector< double > &joint_pose) const
virtual bool isValid (const Eigen::Affine3d &pose) const
virtual bool isValidMove (const std::vector< double > &from_joint_pose, const std::vector< double > &to_joint_pose, double dt) const

Public Attributes

int dof_
double orient_range_
double pos_range_

Detailed Description

Cartesian Robot used for test purposes. This is a simple robot with simple kinematics. Each joint corresponds to a cartesian direction (i.e. x, y, R, P, Y) (don't ask me how this is built, it just works).

Definition at line 31 of file cartesian_robot.h.


Constructor & Destructor Documentation

Definition at line 27 of file cartesian_robot.cpp.

descartes_trajectory_test::CartesianRobot::CartesianRobot ( double  pos_range,
double  orient_range,
int  dof = 6 
)

Definition at line 39 of file cartesian_robot.cpp.


Member Function Documentation

bool descartes_trajectory_test::CartesianRobot::getAllIK ( const Eigen::Affine3d &  pose,
std::vector< std::vector< double > > &  joint_poses 
) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 70 of file cartesian_robot.cpp.

Implements descartes_core::RobotModel.

Definition at line 99 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::getFK ( const std::vector< double > &  joint_pose,
Eigen::Affine3d &  pose 
) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 78 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::getIK ( const Eigen::Affine3d &  pose,
const std::vector< double > &  seed_state,
std::vector< double > &  joint_pose 
) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 46 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::initialize ( const std::string &  robot_description,
const std::string &  group_name,
const std::string &  world_frame,
const std::string &  tcp_frame 
) [virtual]

Implements descartes_core::RobotModel.

Definition at line 33 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::isValid ( const std::vector< double > &  joint_pose) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 104 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::isValid ( const Eigen::Affine3d &  pose) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 129 of file cartesian_robot.cpp.

bool descartes_trajectory_test::CartesianRobot::isValidMove ( const std::vector< double > &  from_joint_pose,
const std::vector< double > &  to_joint_pose,
double  dt 
) const [virtual]

Implements descartes_core::RobotModel.

Definition at line 150 of file cartesian_robot.cpp.


Member Data Documentation

Definition at line 60 of file cartesian_robot.h.

Definition at line 59 of file cartesian_robot.h.

Definition at line 58 of file cartesian_robot.h.


The documentation for this class was generated from the following files:


descartes_trajectory
Author(s): Jorge Nicho
autogenerated on Wed Aug 26 2015 11:21:27