ROS_ERROR("IriBTBasicNodes::is_variable_true-> Incorrect or missing input. It needs the following input ports: variable (bool)");
ROS_ERROR_STREAM("IriBTBasicNodes::is_variable_true ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: variable (bool)");
ROS_ERROR("IriBTBasicNodes::is_variable_false-> Incorrect or missing input. It needs the following input ports: variable (bool)");
ROS_ERROR_STREAM("IriBTBasicNodes::is_variable_false ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: variable (bool)");
ROS_ERROR("IriBTBasicNodes::transform_pose-> Incorrect or missing input. It needs the following input ports: pose_in (geometry_msgs::PoseStamped) target_frame (std::string) pose_out (geometry_msgs::PoseStamped)");
ROS_ERROR_STREAM("IriBTBasicNodes::transform_pose ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: pose_in (geometry_msgs::PoseStamped) target_frame (std::string) pose_out (geometry_msgs::PoseStamped)");
ROS_ERROR("IriBTBasicNodes::compute_distance-> Incorrect or missing input. It needs the following input ports: pose1 (geometry_msgs::PoseStamped) pose2 (geometry_msgs::PoseStamped) distance (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compute_distance ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: pose1 (geometry_msgs::PoseStamped) pose2 (geometry_msgs::PoseStamped) distance (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compute_distance-> Points with different frame ids: pose1="<<pose1_value.header.frame_id<<"; pose2="<<pose1_value.header.frame_id);
ROS_ERROR_STREAM("IriBTBasicNodes::compute_distance ("<<self.name()<<") -> Points with different frame ids: pose1="<<pose1_value.header.frame_id<<"; pose2="<<pose1_value.header.frame_id);
ROS_ERROR("IriBTBasicNodes::compute_y_distance-> Incorrect or missing input. It needs the following input ports: pose1 (geometry_msgs::PoseStamped) pose2 (geometry_msgs::PoseStamped) distance (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compute_y_distance ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: pose1 (geometry_msgs::PoseStamped) pose2 (geometry_msgs::PoseStamped) distance (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compute_y_distance-> Points with different frame ids: pose1="<<pose1_value.header.frame_id<<"; pose2="<<pose1_value.header.frame_id);
ROS_ERROR_STREAM("IriBTBasicNodes::compute_y_distance ("<<self.name()<<") -> Points with different frame ids: pose1="<<pose1_value.header.frame_id<<"; pose2="<<pose1_value.header.frame_id);
ROS_ERROR("IriBTBasicNodes::compare_bigger-> Incorrect or missing input. It needs the following input ports: value1 (double) value2 (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compare_bigger ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: value1 (double) value2 (double)");
ROS_ERROR("IriBTBasicNodes::compare_smaller-> Incorrect or missing input. It needs the following input ports: value1 (double) value2 (double)");
ROS_ERROR_STREAM("IriBTBasicNodes::compare_smaller ("<<self.name()<<") -> Incorrect or missing input. It needs the following input ports: value1 (double) value2 (double)");