示例#1
0
            public override bool Equals(RosMessage ____other)
            {
                if (____other == null)
                {
                    return(false);
                }

                bool ret = true;

                xamlamoveit_msgs.SetCollisionObjectWorldView.Request other = (Messages.xamlamoveit_msgs.SetCollisionObjectWorldView.Request)____other;

                ret &= collision_object.Equals(other.collision_object);
                ret &= transient == other.transient;
                ret &= element_path == other.element_path;
                ret &= display_name == other.display_name;
                return(ret);
            }
            public override bool Equals(RosMessage ____other)
            {
                if (____other == null)
                {
                    return(false);
                }

                bool ret = true;

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

                ret &= collision_object.Equals(other.collision_object);
                ret &= success == other.success;
                ret &= error == other.error;
                // for each SingleType st:
                //    ret &= {st.Name} == other.{st.Name};
                return(ret);
            }