40 #include <boost/math/constants/constants.hpp> 43 #include <pr2_controllers_msgs/PointHeadAction.h> 77 si.
x_angle = boost::math::constants::pi<double>() / 3.0;
78 si.
y_angle = boost::math::constants::pi<double>() / 3.0;
81 ROS_ERROR(
"Unknown sensor: '%s'", name.c_str());
90 virtual bool pointSensorTo(
const std::string &name,
const geometry_msgs::PointStamped &target, moveit_msgs::RobotTrajectory &sensor_trajectory)
94 ROS_ERROR(
"Unknown sensor: '%s'", name.c_str());
99 ROS_ERROR(
"Head action server is not connected");
103 sensor_trajectory = moveit_msgs::RobotTrajectory();
105 pr2_controllers_msgs::PointHeadGoal goal;
107 goal.max_velocity = 1.0;
108 goal.pointing_axis.x = 0.0;
109 goal.pointing_axis.y = 0.0;
110 goal.pointing_axis.z = 1.0;
111 goal.target = target;
virtual void getSensorsList(std::vector< std::string > &names) const
std::string head_pointing_frame_
virtual ~Pr2MoveItSensorManager()
PLUGINLIB_EXPORT_CLASS(pr2_moveit_sensor_manager::Pr2MoveItSensorManager, moveit_sensor_manager::MoveItSensorManager)
std::string toString() const
ros::NodeHandle node_handle_
virtual bool pointSensorTo(const std::string &name, const geometry_msgs::PointStamped &target, moveit_msgs::RobotTrajectory &sensor_trajectory)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
boost::shared_ptr< actionlib::SimpleActionClient< pr2_controllers_msgs::PointHeadAction > > head_action_client_
std::string getText() const
#define ROS_WARN_STREAM(args)
virtual moveit_sensor_manager::SensorInfo getSensorInfo(const std::string &name) const
virtual bool hasSensors() const