ompl_ros_projection_evaluator.cpp
Go to the documentation of this file.
00001 /*********************************************************************
00002 * Software License Agreement (BSD License)
00003 *
00004 *  Copyright (c) 2008, Willow Garage, Inc.
00005 *  All rights reserved.
00006 *
00007 *  Redistribution and use in source and binary forms, with or without
00008 *  modification, are permitted provided that the following conditions
00009 *  are met:
00010 *
00011 *   * Redistributions of source code must retain the above copyright
00012 *     notice, this list of conditions and the following disclaimer.
00013 *   * Redistributions in binary form must reproduce the above
00014 *     copyright notice, this list of conditions and the following
00015 *     disclaimer in the documentation and/or other materials provided
00016 *     with the distribution.
00017 *   * Neither the name of Willow Garage, Inc. nor the names of its
00018 *     contributors may be used to endorse or promote products derived
00019 *     from this software without specific prior written permission.
00020 *
00021 *  THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
00022 *  "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
00023 *  LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
00024 *  FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
00025 *  COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
00026 *  INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
00027 *  BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
00028 *  LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
00029 *  CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
00030 *  LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
00031 *  ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
00032 *  POSSIBILITY OF SUCH DAMAGE.
00033 *********************************************************************/
00034 
00035 #include <ompl_ros_interface/ompl_ros_projection_evaluator.h>
00036 
00037 namespace ompl_ros_interface
00038 { 
00039  
00040 OmplRosProjectionEvaluator::OmplRosProjectionEvaluator(const ompl::base::StateSpace *state_space, 
00041                                                        const std::string &evaluator_name) : ompl::base::ProjectionEvaluator(state_space)
00042 {
00043   if(!state_space->as<ompl::base::CompoundStateSpace>()->hasSubspace(evaluator_name) && 
00044      !(evaluator_name == "joint_state"))
00045   {
00046     ROS_ERROR("Evaluator name %s does not match any state space name",evaluator_name.c_str());
00047     return;
00048   }
00049 
00050   if(evaluator_name == "joint_state")
00051   {
00052     if(!state_space->as<ompl::base::CompoundStateSpace>()->hasSubspace("real_vector"))
00053     {      
00054       ROS_ERROR("Could not find subspace for defining projection evaluator");
00055       throw new OMPLROSException();
00056     }
00057     mapping_index_ = state_space->as<ompl::base::CompoundStateSpace>()->getSubspaceIndex("real_vector");
00058     dimension_ = std::min<unsigned int>(state_space->as<ompl::base::CompoundStateSpace>()->as<ompl::base::RealVectorStateSpace>(mapping_index_)->getDimension(),2);
00059     cellSizes_.resize(dimension_);
00060     const ompl::base::RealVectorBounds &b = state_space->as<ompl::base::CompoundStateSpace>()->as<ompl::base::RealVectorStateSpace>(mapping_index_)->getBounds();
00061     for(unsigned int i=0; i < dimension_; i++)
00062       cellSizes_[i] = (b.high[i] - b.low[i]) / 10.0;
00063     mapping_type_ = ompl_ros_interface::REAL_VECTOR;
00064     ROS_DEBUG("Choosing projection evaluator for real vector joints with dimension %d",dimension_);
00065     return;
00066   }
00067 
00068   mapping_index_ = state_space->as<ompl::base::CompoundStateSpace>()->getSubspaceIndex(evaluator_name);
00069   mapping_type_ = ompl_ros_interface::getMappingType(state_space->as<ompl::base::CompoundStateSpace>()->getSubspace(mapping_index_).get());
00070 
00071   if(mapping_type_ == ompl_ros_interface::SO2)
00072   {
00073     dimension_ = 1;
00074     cellSizes_.resize(1);
00075     cellSizes_[0] = boost::math::constants::pi<double>() / 10.0;
00076     ROS_DEBUG("Choosing projection evaluator for SO2 state space %s",evaluator_name.c_str());
00077   }
00078   else if(mapping_type_ == ompl_ros_interface::SE2)
00079   {
00080     dimension_ = 2;
00081     cellSizes_.resize(2);
00082     const ompl::base::RealVectorBounds &b = state_space->as<ompl::base::CompoundStateSpace>()->as<ompl::base::SE2StateSpace>(mapping_index_)->as<ompl::base::RealVectorStateSpace>(0)->getBounds();
00083     cellSizes_[0] = (b.high[0] - b.low[0]) / 10.0;
00084     cellSizes_[1] = (b.high[1] - b.low[1]) / 10.0;      
00085     ROS_INFO("Choosing projection evaluator for SE2 state space %s",evaluator_name.c_str());
00086   }
00087   else if(mapping_type_ == ompl_ros_interface::SO3)
00088   {
00089     dimension_ = 3;
00090     cellSizes_.resize(3);
00091     cellSizes_[0] = boost::math::constants::pi<double>() / 10.0;
00092     cellSizes_[1] = boost::math::constants::pi<double>() / 10.0;
00093     cellSizes_[2] = boost::math::constants::pi<double>() / 10.0;
00094     ROS_INFO("Choosing projection evaluator for SO3 state space %s",evaluator_name.c_str());
00095   }
00096   else if(mapping_type_ == ompl_ros_interface::SE3)
00097   {
00098     dimension_ = 3;
00099     cellSizes_.resize(3);
00100     const ompl::base::RealVectorBounds &b = state_space->as<ompl::base::CompoundStateSpace>()->as<ompl::base::SE3StateSpace>(mapping_index_)->as<ompl::base::RealVectorStateSpace>(0)->getBounds();
00101     cellSizes_[0] = (b.high[0] - b.low[0]) / 10.0;
00102     cellSizes_[1] = (b.high[1] - b.low[1]) / 10.0;
00103     cellSizes_[2] = (b.high[2] - b.low[2]) / 10.0;
00104     ROS_INFO("Choosing projection evaluator for SE3 state space %s",evaluator_name.c_str());
00105   }
00106   else
00107   {
00108     ROS_ERROR("Could not initialize projection evaluator. A projection evaluator needs to be defined as either a combination of revolute joints with joint limits, or a continuous, spherical, planar of floating joint. ");
00109     throw new OMPLROSException();
00110   }
00111 };
00112         
00113 unsigned int OmplRosProjectionEvaluator::getDimension(void) const
00114 {
00115   return dimension_;
00116 };
00117         
00118 void OmplRosProjectionEvaluator::project(const ompl::base::State *state, ompl::base::EuclideanProjection &projection) const
00119 {
00120   if(mapping_type_ == ompl_ros_interface::REAL_VECTOR)
00121   {
00122     for(unsigned int i=0; i < dimension_; i++)
00123       projection[i] = state->as<ompl::base::CompoundState>()->as<ompl::base::RealVectorStateSpace::StateType>(mapping_index_)->values[i];
00124   }
00125   if(mapping_type_ == ompl_ros_interface::SO2)
00126   {
00127     projection[0] = state->as<ompl::base::CompoundState>()->as<ompl::base::SO2StateSpace::StateType>(mapping_index_)->value;
00128   }
00129   else if(mapping_type_ == ompl_ros_interface::SE2)
00130   {
00131     const double *se2_vals = state->as<ompl::base::CompoundState>()->as<ompl::base::SE2StateSpace::StateType>(mapping_index_)->as<ompl::base::RealVectorStateSpace::StateType>(0)->values;
00132     projection[0] = se2_vals[0];
00133     projection[1] = se2_vals[1];
00134   }
00135   else if(mapping_type_ == ompl_ros_interface::SO3)
00136   {
00137     projection[0] = state->as<ompl::base::CompoundState>()->as<ompl::base::SO3StateSpace::StateType>(mapping_index_)->x;
00138     projection[1] = state->as<ompl::base::CompoundState>()->as<ompl::base::SO3StateSpace::StateType>(mapping_index_)->y;
00139     projection[2] = state->as<ompl::base::CompoundState>()->as<ompl::base::SO3StateSpace::StateType>(mapping_index_)->z;
00140   }
00141   else if(mapping_type_ == ompl_ros_interface::SE3)
00142   {
00143     const double *se3_vals = state->as<ompl::base::CompoundState>()->as<ompl::base::SE3StateSpace::StateType>(mapping_index_)->as<ompl::base::RealVectorStateSpace::StateType>(0)->values;
00144     projection[0] = se3_vals[0];
00145     projection[1] = se3_vals[1];
00146     projection[2] = se3_vals[2];
00147   }
00148 };
00149 
00150 }


ompl_ros_interface
Author(s): Sachin Chitta
autogenerated on Thu Dec 12 2013 11:10:58