Exemplo n.º 1
0
            public override bool Equals(RosMessage ____other)
            {
                if (____other == null)
					return false;

                bool ret = true;
                xamlamoveit_msgs.GetMoveItJointPath.Response other = (Messages.xamlamoveit_msgs.GetMoveItJointPath.Response)____other;

                if (path.Length != other.path.Length)
                    return false;
                for (int __i__=0; __i__ < path.Length; __i__++)
                {
                    ret &= path[__i__].Equals(other.path[__i__]);
                }
                if (joint_names.Length != other.joint_names.Length)
                    return false;
                for (int __i__=0; __i__ < joint_names.Length; __i__++)
                {
                    ret &= joint_names[__i__] == other.joint_names[__i__];
                }
                ret &= error_code.Equals(other.error_code);
                // for each SingleType st:
                //    ret &= {st.Name} == other.{st.Name};
                return ret;
            }
            public override bool Equals(RosMessage ____other)
            {
                if (____other == null)
                {
                    return(false);
                }

                bool ret = true;

                xamlamoveit_msgs.GetLinearCartesianTrajectory.Response other = (Messages.xamlamoveit_msgs.GetLinearCartesianTrajectory.Response)____other;

                ret &= solution.Equals(other.solution);
                ret &= error_code.Equals(other.error_code);
                // for each SingleType st:
                //    ret &= {st.Name} == other.{st.Name};
                return(ret);
            }
Exemplo n.º 3
0
            public override bool Equals(RosMessage ____other)
            {
                if (____other == null)
                {
                    return(false);
                }

                bool ret = true;

                xamlamoveit_msgs.GetLinearCartesianPath.Response other = (Messages.xamlamoveit_msgs.GetLinearCartesianPath.Response)____other;

                if (path.Length != other.path.Length)
                {
                    return(false);
                }
                for (int __i__ = 0; __i__ < path.Length; __i__++)
                {
                    ret &= path[__i__].Equals(other.path[__i__]);
                }
                ret &= error_code.Equals(other.error_code);
                // for each SingleType st:
                //    ret &= {st.Name} == other.{st.Name};
                return(ret);
            }